/Zephyr-latest/subsys/usb/usb_c/ |
D | usbc_prl.h | 4 * SPDX-License-Identifier: Apache-2.0 20 * See Table 6-63 Counter parameters 44 const struct device *dev; member 47 /** last packet type we transmitted */ 49 /** Current message type to transmit */ 77 const struct device *dev; member 90 * @param dev Pointer to the device structure for the driver instance. 92 void prl_subsys_init(const struct device *dev); 96 * Type-C state machine. 98 * @param dev Pointer to the device structure for the driver instance [all …]
|
D | usbc_prl.c | 4 * SPDX-License-Identifier: Apache-2.0 109 static void prl_tx_construct_message(const struct device *dev); 110 static void prl_rx_wait_for_phy_message(const struct device *dev); 111 static void prl_hr_set_state(const struct device *dev, const enum usbc_prl_hr_state_t state); 112 static void prl_tx_set_state(const struct device *dev, const enum usbc_prl_tx_state_t state); 113 static void prl_init(const struct device *dev); 114 static enum usbc_prl_hr_state_t prl_hr_get_state(const struct device *dev); 120 void prl_subsys_init(const struct device *dev) in prl_subsys_init() argument 122 struct usbc_port_data *data = dev->data; in prl_subsys_init() 123 struct protocol_layer_tx_t *prl_tx = data->prl_tx; in prl_subsys_init() [all …]
|
D | usbc_tc_common_internal.h | 4 * SPDX-License-Identifier: Apache-2.0 20 * sub-state runs 28 * @brief Type-C States 70 const struct device *dev; member 101 * @brief Sets a Type-C State 103 * @param dev Pointer to the device structure for the driver instance 104 * @param state next Type-C State to enter 106 void tc_set_state(const struct device *dev, const enum tc_state_t state); 109 * @brief Get current Type-C State 111 * @param dev Pointer to the device structure for the driver instance [all …]
|
/Zephyr-latest/subsys/net/l2/ethernet/ |
D | ethernet_mgmt.c | 4 * SPDX-License-Identifier: Apache-2.0 16 static inline bool is_hw_caps_supported(const struct device *dev, in is_hw_caps_supported() argument 19 const struct ethernet_api *api = dev->api; in is_hw_caps_supported() 21 if (!api || !api->get_capabilities) { in is_hw_caps_supported() 25 return ((api->get_capabilities(dev) & caps) != 0); in is_hw_caps_supported() 33 const struct device *dev = net_if_get_device(iface); in ethernet_set_config() local 34 const struct ethernet_api *api = dev->api; in ethernet_set_config() 36 enum ethernet_config_type type; in ethernet_set_config() local 39 return -ENOENT; in ethernet_set_config() 42 if (!api->set_config) { in ethernet_set_config() [all …]
|
/Zephyr-latest/subsys/sensing/ |
D | sensing_sensor.c | 4 * SPDX-License-Identifier: Apache-2.0 18 struct sensing_sensor *sensor = (struct sensing_sensor *)iodev_sqe->sqe.userdata; in sensing_iodev_submit() 19 const struct device *dev = sensor->dev; in sensing_iodev_submit() local 20 const struct sensor_driver_api *api = dev->api; in sensing_iodev_submit() 22 if (api->submit != NULL) { in sensing_iodev_submit() 23 api->submit(dev, iodev_sqe); in sensing_iodev_submit() 25 LOG_ERR("submit function not supported for device %p %s!\n", dev, dev->name); in sensing_iodev_submit() 26 rtio_iodev_sqe_err(iodev_sqe, -ENOTSUP); in sensing_iodev_submit() 34 int sensing_sensor_get_reporters(const struct device *dev, int type, in sensing_sensor_get_reporters() argument 38 struct sensing_sensor *sensor = get_sensor_by_dev(dev); in sensing_sensor_get_reporters() [all …]
|
/Zephyr-latest/dts/bindings/input/ |
D | zephyr,input-longpress.yaml | 2 # SPDX-License-Identifier: Apache-2.0 5 Input longpress pseudo-device 15 #include <zephyr/dt-bindings/input/input-event-codes.h> 19 compatible = "zephyr,input-longpress"; 20 input-codes = <INPUT_KEY_0>, <INPUT_KEY_1>; 21 short-codes = <INPUT_KEY_A>, <INPUT_KEY_B>; 22 long-codes = <INPUT_KEY_X>, <INPUT_KEY_Y>; 23 long-delay-ms = <1000>; 29 input event: dev=buttons SYN type= 1 code= 11 value=1 # INPUT_KEY_0 press 31 input event: dev=buttons SYN type= 1 code= 11 value=0 # INPUT_KEY_0 release [all …]
|
/Zephyr-latest/drivers/mipi_dsi/ |
D | mipi_dsi.c | 4 * SPDX-License-Identifier: Apache-2.0 11 ssize_t mipi_dsi_generic_read(const struct device *dev, uint8_t channel, in mipi_dsi_generic_read() argument 24 msg.type = MIPI_DSI_GENERIC_READ_REQUEST_0_PARAM; in mipi_dsi_generic_read() 28 msg.type = MIPI_DSI_GENERIC_READ_REQUEST_1_PARAM; in mipi_dsi_generic_read() 32 msg.type = MIPI_DSI_GENERIC_READ_REQUEST_2_PARAM; in mipi_dsi_generic_read() 36 return -EINVAL; in mipi_dsi_generic_read() 39 return mipi_dsi_transfer(dev, channel, &msg); in mipi_dsi_generic_read() 42 ssize_t mipi_dsi_generic_write(const struct device *dev, uint8_t channel, in mipi_dsi_generic_write() argument 52 msg.type = MIPI_DSI_GENERIC_SHORT_WRITE_0_PARAM; in mipi_dsi_generic_write() 56 msg.type = MIPI_DSI_GENERIC_SHORT_WRITE_1_PARAM; in mipi_dsi_generic_write() [all …]
|
/Zephyr-latest/tests/subsys/edac/ibecc/src/ |
D | ibecc.c | 4 * SPDX-License-Identifier: Apache-2.0 26 const struct device *dev; in ZTEST() local 30 dev = DEVICE_DT_GET(DT_NODELABEL(ibecc)); in ZTEST() 31 zassert_true(device_is_ready(dev), "Device is not ready"); in ZTEST() 49 error_type = error_data->type; in callback() 50 error_address = error_data->address; in callback() 51 error_syndrome = error_data->syndrome; in callback() 56 const struct device *dev; in ZTEST() local 64 dev = DEVICE_DT_GET(DT_NODELABEL(ibecc)); in ZTEST() 65 zassert_true(device_is_ready(dev), "Device is not ready"); in ZTEST() [all …]
|
/Zephyr-latest/drivers/usb/uhc/ |
D | uhc_virtual.c | 4 * SPDX-License-Identifier: Apache-2.0 31 const struct device *dev; member 53 enum uhc_vrt_event_type type; member 60 static void vrt_event_submit(const struct device *dev, in vrt_event_submit() argument 61 const enum uhc_vrt_event_type type, in vrt_event_submit() argument 64 struct uhc_vrt_data *priv = uhc_get_private(dev); in vrt_event_submit() 71 event->type = type; in vrt_event_submit() 72 event->pkt = (struct uvb_packet *const)data; in vrt_event_submit() 73 k_fifo_put(&priv->fifo, event); in vrt_event_submit() 74 k_work_submit(&priv->work); in vrt_event_submit() [all …]
|
/Zephyr-latest/drivers/w1/ |
D | w1_shell.c | 5 * SPDX-License-Identifier: Apache-2.0 17 #define W1DEV_X_NOT_FOUND "1-Wire device not found: \"%s\"" 19 #define OPTION_HELP_RESET "-r Perform bus reset before executing cmd." 31 if (arg[0] != '-') { in read_io_options() 42 return -EINVAL; in read_io_options() 49 /* 1-Wire reset bus <device> */ 52 const struct device *dev; in cmd_w1_reset_bus() local 55 dev = shell_device_get_binding(argv[1]); in cmd_w1_reset_bus() 56 if (!dev) { in cmd_w1_reset_bus() 58 return -EINVAL; in cmd_w1_reset_bus() [all …]
|
/Zephyr-latest/include/zephyr/drivers/ |
D | cellular.h | 5 * SPDX-License-Identifier: Apache-2.0 56 /** Cellular signal type */ 63 /** Cellular modem info type */ 89 typedef int (*cellular_api_configure_networks)(const struct device *dev, 94 typedef int (*cellular_api_get_supported_networks)(const struct device *dev, 99 typedef int (*cellular_api_get_signal)(const struct device *dev, 100 const enum cellular_signal_type type, int16_t *value); 103 typedef int (*cellular_api_get_modem_info)(const struct device *dev, 104 const enum cellular_modem_info_type type, 108 typedef int (*cellular_api_get_registration_status)(const struct device *dev, [all …]
|
D | edac.h | 4 * SPDX-License-Identifier: Apache-2.0 28 * @brief EDAC error type 31 /** Correctable error type */ 33 /** Uncorrectable error type */ 43 typedef void (*edac_notify_callback_f)(const struct device *dev, void *data); 52 int (*inject_set_param1)(const struct device *dev, uint64_t value); 53 int (*inject_get_param1)(const struct device *dev, uint64_t *value); 54 int (*inject_set_param2)(const struct device *dev, uint64_t value); 55 int (*inject_get_param2)(const struct device *dev, uint64_t *value); 56 int (*inject_set_error_type)(const struct device *dev, uint32_t value); [all …]
|
/Zephyr-latest/drivers/sensor/tdk/icm42605/ |
D | icm42605_trigger.c | 4 * SPDX-License-Identifier: Apache-2.0 18 int icm42605_trigger_set(const struct device *dev, in icm42605_trigger_set() argument 22 struct icm42605_data *drv_data = dev->data; in icm42605_trigger_set() 23 const struct icm42605_config *cfg = dev->config; in icm42605_trigger_set() 25 if (trig->type != SENSOR_TRIG_DATA_READY in icm42605_trigger_set() 26 && trig->type != SENSOR_TRIG_TAP in icm42605_trigger_set() 27 && trig->type != SENSOR_TRIG_DOUBLE_TAP) { in icm42605_trigger_set() 28 return -ENOTSUP; in icm42605_trigger_set() 31 gpio_pin_interrupt_configure_dt(&cfg->gpio_int, GPIO_INT_DISABLE); in icm42605_trigger_set() 34 icm42605_turn_off_sensor(dev); in icm42605_trigger_set() [all …]
|
/Zephyr-latest/drivers/ethernet/ |
D | eth_test.c | 4 * SPDX-License-Identifier: Apache-2.0 17 struct net_stats_eth *vnd_ethernet_get_stats(const struct device *dev); 19 ARG_UNUSED(dev); 25 int vnd_ethernet_start(const struct device *dev) in vnd_ethernet_start() argument 27 ARG_UNUSED(dev); in vnd_ethernet_start() 29 return -ENOTSUP; in vnd_ethernet_start() 32 int vnd_ethernet_stop(const struct device *dev) in vnd_ethernet_stop() argument 34 ARG_UNUSED(dev); in vnd_ethernet_stop() 36 return -ENOTSUP; in vnd_ethernet_stop() 39 enum ethernet_hw_caps vnd_ethernet_get_capabilities(const struct device *dev) in vnd_ethernet_get_capabilities() argument [all …]
|
/Zephyr-latest/include/zephyr/usb_c/ |
D | usbc.h | 3 * SPDX-License-Identifier: Apache-2.0 8 * @brief USB-C Device APIs 10 * This file contains the USB-C Device APIs. 26 * @brief USB-C Device APIs 27 * @defgroup _usbc_device_api USB-C Device API 56 /** Request Type-C layer to transition to Disabled State */ 58 /** Request Type-C layer to transition to Error Recovery State */ 60 /** End of Type-C requests */ 178 * @brief Callback type used to get the Sink Capabilities 180 * @param dev USB-C Connector Instance [all …]
|
/Zephyr-latest/drivers/clock_control/ |
D | clock_control_nrf.c | 2 * Copyright (c) 2016-2020 Nordic Semiconductor ASA 5 * SPDX-License-Identifier: Apache-2.0 37 #define CLOCK_LOG(lvl, dev, subsys, ...) \ argument 39 get_sub_config(dev, (enum clock_control_nrf_type)subsys)->name \ 46 #define ERR(dev, subsys, ...) CLOCK_LOG(ERR, dev, subsys, __VA_ARGS__) argument 47 #define WRN(dev, subsys, ...) CLOCK_LOG(WRN, dev, subsys, __VA_ARGS__) argument 48 #define INF(dev, subsys, ...) CLOCK_LOG(INF, dev, subsys, __VA_ARGS__) argument 49 #define DBG(dev, subsys, ...) CLOCK_LOG(DBG, dev, subsys, __VA_ARGS__) argument 83 static struct nrf_clock_control_sub_data *get_sub_data(const struct device *dev, in get_sub_data() argument 84 enum clock_control_nrf_type type) in get_sub_data() argument [all …]
|
D | clock_control_sam_pmc.c | 4 * SPDX-License-Identifier: Apache-2.0 21 static int atmel_sam_clock_control_on(const struct device *dev, in atmel_sam_clock_control_on() argument 24 ARG_UNUSED(dev); in atmel_sam_clock_control_on() 30 return -ENXIO; in atmel_sam_clock_control_on() 33 LOG_DBG("Type: %x, Id: %d", cfg->clock_type, cfg->peripheral_id); in atmel_sam_clock_control_on() 35 switch (cfg->clock_type) { in atmel_sam_clock_control_on() 37 soc_pmc_peripheral_enable(cfg->peripheral_id); in atmel_sam_clock_control_on() 40 LOG_ERR("The PMC clock type is not implemented."); in atmel_sam_clock_control_on() 41 return -ENODEV; in atmel_sam_clock_control_on() 47 static int atmel_sam_clock_control_off(const struct device *dev, in atmel_sam_clock_control_off() argument [all …]
|
/Zephyr-latest/drivers/bluetooth/hci/ |
D | h4.c | 1 /* h4.c - H:4 UART based Bluetooth driver */ 4 * Copyright (c) 2015-2016 Intel Corporation 6 * SPDX-License-Identifier: Apache-2.0 48 uint8_t type; member 58 uint8_t type; member 73 static inline void h4_get_type(const struct device *dev) in h4_get_type() argument 75 const struct h4_config *cfg = dev->config; in h4_get_type() 76 struct h4_data *h4 = dev->data; in h4_get_type() 78 /* Get packet type */ in h4_get_type() 79 if (uart_fifo_read(cfg->uart, &h4->rx.type, 1) != 1) { in h4_get_type() [all …]
|
/Zephyr-latest/drivers/coredump/ |
D | coredump_impl.c | 4 * SPDX-License-Identifier: Apache-2.0 18 /* Type of coredump device */ 19 enum COREDUMP_TYPE type; member 36 static void coredump_impl_dump(const struct device *dev) in coredump_impl_dump() argument 38 const struct coredump_config *config = dev->config; in coredump_impl_dump() 39 struct coredump_data *data = dev->data; in coredump_impl_dump() 41 if (config->type == COREDUMP_TYPE_CALLBACK) { in coredump_impl_dump() 42 if (data->dump_callback) { in coredump_impl_dump() 43 uintptr_t start_address = config->memory_regions[0]; in coredump_impl_dump() 44 size_t size = config->memory_regions[1]; in coredump_impl_dump() [all …]
|
/Zephyr-latest/drivers/fpga/ |
D | fpga_slg471x5.c | 4 * SPDX-License-Identifier: Apache-2.0 26 * mem_region_t - Memory Region 51 static enum FPGA_status fpga_slg471x5_get_status(const struct device *dev) in fpga_slg471x5_get_status() argument 55 struct fpga_slg471x5_data *data = dev->data; in fpga_slg471x5_get_status() 57 key = k_spin_lock(&data->lock); in fpga_slg471x5_get_status() 59 if (data->loaded) { in fpga_slg471x5_get_status() 65 k_spin_unlock(&data->lock, key); in fpga_slg471x5_get_status() 70 static int fpga_slg471x5_verify(const struct device *dev, uint8_t *img, uint32_t img_size) in fpga_slg471x5_verify() argument 72 const struct fpga_slg471x5_config *config = dev->config; in fpga_slg471x5_verify() 76 ret = i2c_read_dt(&config->bus, buf, SLG471X5_NREG); in fpga_slg471x5_verify() [all …]
|
/Zephyr-latest/drivers/dma/ |
D | dma_nxp_sdma.c | 4 * SPDX-License-Identifier: Apache-2.0 34 const struct device *dev; member 35 sdma_buffer_descriptor_t *bd_pool; /*pre-allocated list of BD used for transfer */ 42 void *arg; /* argument passed to user-defined DMA callback */ 43 dma_callback_t cb; /* user-defined callback for DMA transfer completion */ 56 chan_data->stat.read_position = 0; in dma_nxp_sdma_init_stat() 57 chan_data->stat.write_position = 0; in dma_nxp_sdma_init_stat() 59 switch (chan_data->direction) { in dma_nxp_sdma_init_stat() 62 chan_data->stat.pending_length = chan_data->capacity; in dma_nxp_sdma_init_stat() 63 chan_data->stat.free = 0; in dma_nxp_sdma_init_stat() [all …]
|
/Zephyr-latest/drivers/usb/bc12/ |
D | bc12_pi3usb9201.c | 4 * SPDX-License-Identifier: Apache-2.0 29 /* Run-time configuration data */ 31 const struct device *dev; member 57 * The USB Type-C specification limits the maximum amount of current from BC 1.2 86 static int pi3usb9201_interrupt_enable(const struct device *dev, const bool enable) in pi3usb9201_interrupt_enable() argument 88 const struct pi3usb9201_config *cfg = dev->config; in pi3usb9201_interrupt_enable() 91 return i2c_reg_update_byte_dt(&cfg->i2c, PI3USB9201_REG_CTRL_1, in pi3usb9201_interrupt_enable() 96 static int pi3usb9201_bc12_detect_ctrl(const struct device *dev, const bool enable) in pi3usb9201_bc12_detect_ctrl() argument 98 const struct pi3usb9201_config *cfg = dev->config; in pi3usb9201_bc12_detect_ctrl() 100 return i2c_reg_update_byte_dt(&cfg->i2c, PI3USB9201_REG_CTRL_2, in pi3usb9201_bc12_detect_ctrl() [all …]
|
/Zephyr-latest/drivers/input/ |
D | linux_evdev.c | 4 * SPDX-License-Identifier: Apache-2.0 22 static int linux_evdev_fd = -1; 35 .type = 's', in linux_evdev_options() 50 "Please specify an evdev device with the --evdev " in linux_evdev_check_arg() 68 const struct device *dev = p1; in linux_evdev_thread_fn() local 69 uint16_t type; in linux_evdev_thread_fn() local 75 ret = linux_evdev_read(linux_evdev_fd, &type, &code, &value); in linux_evdev_thread_fn() 84 LOG_DBG("evdev event: type=%d code=%d val=%d", type, code, value); in linux_evdev_thread_fn() 86 if (type == 0) { /* EV_SYN */ in linux_evdev_thread_fn() 87 input_report(dev, 0, 0, 0, true, K_FOREVER); in linux_evdev_thread_fn() [all …]
|
/Zephyr-latest/drivers/sensor/explorir_m/ |
D | explorir_m.c | 4 * SPDX-License-Identifier: Apache-2.0 7 * https://www.gassensing.co.uk/wp-content/uploads/2023/05/ExplorIR-M-Data-Sheet-Rev-4.13_3.pdf 86 while (k_uptime_get_32() - uptime < EXPLORIR_M_MAX_RESPONSE_DELAY) { in explorir_m_uart_flush_until_end() 95 memset(data->read_buffer, 0, data->read_index); in explorir_m_buffer_reset() 96 data->read_index = 0; in explorir_m_buffer_reset() 99 static int explorir_m_buffer_verify(const struct explorir_m_data *data, char type) in explorir_m_buffer_verify() argument 101 char buffer_type = data->read_buffer[EXPLORIR_M_TYPE_INDEX]; in explorir_m_buffer_verify() 103 if (data->read_buffer[0] == EXPLORIR_M_NOT_RECOGNISED_CHAR) { in explorir_m_buffer_verify() 105 return -EIO; in explorir_m_buffer_verify() 108 if (buffer_type != type) { in explorir_m_buffer_verify() [all …]
|
/Zephyr-latest/drivers/sensor/adi/adltc2990/ |
D | adltc2990.c | 2 * SPDX-FileCopyrightText: Copyright (c) 2023 Carl Zeiss Meditec AG 3 * SPDX-License-Identifier: Apache-2.0 22 return -EINVAL; in adltc2990_get_v1_v2_measurement_modes() 29 enum adltc2990_monitoring_type type = NOTHING; in adltc2990_get_v1_v2_measurement_modes() local 34 type = VOLTAGE_SINGLEENDED; in adltc2990_get_v1_v2_measurement_modes() 40 type = VOLTAGE_DIFFERENTIAL; in adltc2990_get_v1_v2_measurement_modes() 46 type = TEMPERATURE; in adltc2990_get_v1_v2_measurement_modes() 53 return type; in adltc2990_get_v1_v2_measurement_modes() 61 return -EINVAL; in adltc2990_get_v3_v4_measurement_modes() 68 enum adltc2990_monitoring_type type = NOTHING; in adltc2990_get_v3_v4_measurement_modes() local [all …]
|