/Zephyr-latest/drivers/wifi/eswifi/ |
D | eswifi_bus_spi.c | 4 * SPDX-License-Identifier: Apache-2.0 46 return gpio_pin_get_dt(&spi->cfg->dr) > 0; in eswifi_spi_cmddata_ready() 56 } while (!eswifi_spi_cmddata_ready(spi) && --max_retries); in eswifi_spi_wait_cmddata_ready() 58 return max_retries ? 0 : -ETIMEDOUT; in eswifi_spi_wait_cmddata_ready() 61 static int eswifi_spi_write(struct eswifi_dev *eswifi, char *data, size_t dlen) in eswifi_spi_write() argument 63 struct eswifi_spi_data *spi = eswifi->bus_data; in eswifi_spi_write() 68 spi_tx_buf[0].buf = data; in eswifi_spi_write() 73 status = spi_write_dt(&spi->cfg->bus, &spi_tx); in eswifi_spi_write() 83 static int eswifi_spi_read(struct eswifi_dev *eswifi, char *data, size_t dlen) in eswifi_spi_read() argument 85 struct eswifi_spi_data *spi = eswifi->bus_data; in eswifi_spi_read() [all …]
|
/Zephyr-latest/drivers/sensor/bosch/bma280/ |
D | bma280_trigger.c | 4 * SPDX-License-Identifier: Apache-2.0 23 const struct bma280_config *config = dev->config; in setup_int1() 25 gpio_pin_interrupt_configure_dt(&config->int1_gpio, in setup_int1() 34 const struct bma280_config *config = dev->config; in bma280_attr_set() 37 if (!config->int1_gpio.port) { in bma280_attr_set() 38 return -ENOTSUP; in bma280_attr_set() 42 return -ENOTSUP; in bma280_attr_set() 47 slope_th = (uint64_t)val->val1 * 1000000U + (uint64_t)val->val2; in bma280_attr_set() 49 if (i2c_reg_write_byte_dt(&config->i2c, in bma280_attr_set() 53 return -EIO; in bma280_attr_set() [all …]
|
/Zephyr-latest/subsys/shell/backends/ |
D | shell_rpmsg.c | 4 * SPDX-License-Identifier: Apache-2.0 14 static int rpmsg_shell_cb(struct rpmsg_endpoint *ept, void *data, in rpmsg_shell_cb() argument 18 struct shell_rpmsg *sh_rpmsg = (struct shell_rpmsg *)transport->ctx; in rpmsg_shell_cb() 25 rx.data = data; in rpmsg_shell_cb() 27 if (k_msgq_put(&sh_rpmsg->rx_q, &rx, K_NO_WAIT) != 0) { in rpmsg_shell_cb() 31 rpmsg_hold_rx_buffer(ept, data); in rpmsg_shell_cb() 32 sh_rpmsg->shell_handler(SHELL_TRANSPORT_EVT_RX_RDY, sh_rpmsg->shell_context); in rpmsg_shell_cb() 39 struct shell_rpmsg *sh_rpmsg = (struct shell_rpmsg *)transport->ctx; in uninit() 41 if (!sh_rpmsg->ready) { in uninit() 42 return -ENODEV; in uninit() [all …]
|
/Zephyr-latest/drivers/usb/common/nrf_usbd_common/ |
D | Kconfig | 1 # Copyright (c) 2016-2023 Nordic Semiconductor ASA 2 # SPDX-License-Identifier: Apache-2.0 5 module-str = nRF USBD common 14 bool "Send ZLP on ISO IN when not ready" 19 data is ready to be sent. When enabled, ZLP is sent when no data is 20 ready. When disabled, no response is sent (bus timeout occurs).
|
/Zephyr-latest/subsys/mgmt/ec_host_cmd/backends/ |
D | ec_host_cmd_backend_shi.h | 4 * SPDX-License-Identifier: Apache-2.0 20 * 1. - - AP asserts chip select (CS#) 21 * 2. EC_SHI_OLD_READY - AP sends first byte(s) of request 22 * 3. - - EC starts handling CS# interrupt 23 * 4. EC_SHI_RECEIVING - AP sends remaining byte(s) of request 24 * 5. EC_SHI_PROCESSING - EC starts processing request; AP is clocking in 26 * 6. - - EC finishes processing and sets up response 27 * 7. EC_SHI_FRAME_START - AP reads frame byte 28 * 8. (response packet) - AP reads response packet 29 * 9. EC_SHI_PAST_END - Any additional bytes read by AP [all …]
|
/Zephyr-latest/drivers/sensor/nxp/fxas21002/ |
D | fxas21002_trigger.c | 4 * SPDX-License-Identifier: Apache-2.0 19 struct fxas21002_data *data = in fxas21002_gpio_callback() local 21 const struct fxas21002_config *config = data->dev->config; in fxas21002_gpio_callback() 23 if ((pin_mask & BIT(config->int_gpio.pin)) == 0U) { in fxas21002_gpio_callback() 27 gpio_pin_interrupt_configure_dt(&config->int_gpio, GPIO_INT_DISABLE); in fxas21002_gpio_callback() 30 k_sem_give(&data->trig_sem); in fxas21002_gpio_callback() 32 k_work_submit(&data->work); in fxas21002_gpio_callback() 38 struct fxas21002_data *data = dev->data; in fxas21002_handle_drdy_int() local 40 if (data->drdy_handler) { in fxas21002_handle_drdy_int() 41 data->drdy_handler(dev, data->drdy_trig); in fxas21002_handle_drdy_int() [all …]
|
D | Kconfig | 1 # FXAS21002 3-axis gyroscope 4 # SPDX-License-Identifier: Apache-2.0 23 pre-production devices can have a different value. It is unlikely you 32 0: +/-2000 dps (62.5 mdps/LSB) 33 1: +/-1000 dps (31.25 mdps/LSB) 34 2: +/-500 dps (15.625 mdps/LSB) 35 3: +/-250 dps (7.8125 mdps/LSB) 38 int "Output data rate" 42 Selects the output data rate 62 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_NXP_FXAS21002),int1-gpios) ||\ [all …]
|
/Zephyr-latest/dts/bindings/sensor/ |
D | bosch,bmm150.yaml | 2 # SPDX-License-Identifier: Apache-2.0 6 include: sensor-device.yaml 9 drdy-gpios: 10 type: phandle-array 12 This property specifies the connection for data ready pin. 13 The polarity default is active high when sensor data is ready.
|
D | bosch,bmi08x-gyro.yaml | 2 # SPDX-License-Identifier: Apache-2.0 6 include: sensor-device.yaml 9 int-gpios: 10 type: phandle-array 16 int3-4-map-io: 19 Bit[0] will map the data ready interrupt on INT3 22 Bit[7] will enable the data ready interrupt on INT4 24 int3-4-conf-io: 28 Bit[1]: if set to 1, INT3 is open-drain, otherwise it's push-pull 30 Bit[3]: if set to 1, INT4 is open-drain, otherwise it's push-pull [all …]
|
/Zephyr-latest/drivers/sensor/st/hts221/ |
D | hts221_trigger.c | 2 * Copyright (c) 2016-2021 Intel Corporation 4 * SPDX-License-Identifier: Apache-2.0 22 const struct hts221_config *cfg = dev->config; in setup_drdy() 27 gpio_pin_interrupt_configure_dt(&cfg->gpio_drdy, flags); in setup_drdy() 32 struct hts221_data *data = dev->data; in handle_drdy() local 37 k_sem_give(&data->drdy_sem); in handle_drdy() 39 k_work_submit(&data->work); in handle_drdy() 45 struct hts221_data *data = dev->data; in process_drdy() local 47 if (data->data_ready_handler != NULL) { in process_drdy() 48 data->data_ready_handler(dev, data->data_ready_trigger); in process_drdy() [all …]
|
/Zephyr-latest/samples/sensor/accel_trig/src/ |
D | main.c | 5 * SPDX-License-Identifier: Apache-2.0 18 /* Always fetch the sample to clear the data ready interrupt in the in trigger_handler() 31 struct sensor_value data[3]; in main() local 40 printf("Device %s is not ready\n", dev->name); in main() 51 sensor_channel_get(dev, SENSOR_CHAN_ACCEL_XYZ, data); in main() 53 /* Print accel x,y,z data */ in main() 54 printf("%16s [m/s^2]: (%12.6f, %12.6f, %12.6f)\n", dev->name, in main() 55 sensor_value_to_double(&data[0]), sensor_value_to_double(&data[1]), in main() 56 sensor_value_to_double(&data[2])); in main()
|
/Zephyr-latest/samples/sensor/magn_trig/src/ |
D | main.c | 5 * SPDX-License-Identifier: Apache-2.0 18 /* Always fetch the sample to clear the data ready interrupt in the in trigger_handler() 31 struct sensor_value data[3]; in main() local 40 printf("Device %s is not ready\n", dev->name); in main() 51 sensor_channel_get(dev, SENSOR_CHAN_MAGN_XYZ, data); in main() 53 /* Print magn x,y,z data */ in main() 54 printf("%16s (x, y, z): (%12.6f, %12.6f, %12.6f)\n", dev->name, in main() 55 sensor_value_to_double(&data[0]), sensor_value_to_double(&data[1]), in main() 56 sensor_value_to_double(&data[2])); in main()
|
/Zephyr-latest/tests/benchmarks/sched_queues/ |
D | README.rst | 7 number of ready threads increases. This benchmark can be used to help 12 * Time to add a threads of increasing priority to the ready queue. 13 * Time to add threads of decreasing priority to the ready queue. 22 .. code-block:: shell 24 EXTRA_CONF_FILE="prj.verbose.conf" west build -p -b <board> <path to project> 27 summary statistics as records to allow Twister parse the log and save that data 30 the summary statistics will be parsed as data records.
|
D | Kconfig | 2 # SPDX-License-Identifier: Apache-2.0 9 int "Number of iterations to gather data" 20 will add to the ready queue. Increasing this value will places greater 21 stress on the ready queue and better highlight the performance 22 differences as the number of threads in the ready queue changes.
|
/Zephyr-latest/drivers/sensor/bosch/bmc150_magn/ |
D | bmc150_magn_trigger.c | 4 * SPDX-License-Identifier: Apache-2.0 22 dev->config; in setup_drdy() 24 gpio_pin_interrupt_configure_dt(&cfg->int_gpio, in setup_drdy() 33 struct bmc150_magn_data *data = dev->data; in bmc150_magn_trigger_set() local 35 dev->config; in bmc150_magn_trigger_set() 38 if (!config->int_gpio.port) { in bmc150_magn_trigger_set() 39 return -ENOTSUP; in bmc150_magn_trigger_set() 43 if (trig->type == SENSOR_TRIG_DATA_READY) { in bmc150_magn_trigger_set() 51 data->handler_drdy = handler; in bmc150_magn_trigger_set() 52 data->trigger_drdy = trig; in bmc150_magn_trigger_set() [all …]
|
/Zephyr-latest/samples/boards/st/h7_dual_core/src/ |
D | main.c | 4 * SPDX-License-Identifier: Apache-2.0 20 static struct ipm_data data; variable 26 uint32_t id, volatile void *data) in new_message_callback() argument 30 gpio_pin_set(ipm_data->led->port, ipm_data->led->pin, (int)ipm_data->led_is_on); in new_message_callback() 32 ipm_data->led_is_on = !ipm_data->led_is_on; in new_message_callback() 42 printk("ipm device not ready\n"); in main() 47 printk("led0 device not ready\n"); in main() 53 data.led = &led0; in main() 54 data.led_is_on = false; in main() 56 ipm_register_callback(ipm, new_message_callback, &data); in main()
|
/Zephyr-latest/drivers/sensor/nxp/fxls8974/ |
D | Kconfig | 1 # FXLS8974 3-axis accelerometer 4 # SPDX-License-Identifier: Apache-2.0 27 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_NXP_FXLS8974),int1-gpios) || \ 28 $(dt_compat_any_has_prop,$(DT_COMPAT_NXP_FXLS8974),int2-gpios) 41 bool "Data ready interrupt to INT1 pin" 44 Say Y to route data ready interrupt to INT1 pin. Say N to route to
|
/Zephyr-latest/include/zephyr/drivers/ |
D | i2s.h | 4 * SPDX-License-Identifier: Apache-2.0 9 * @brief Public APIs for the I2S (Inter-IC Sound) bus drivers. 20 * @brief I2S (Inter-IC Sound) Interface 23 * as common non-standard extensions such as PCM Short/Long Frame Sync, 24 * Left/Right Justified Data Format. 39 /** I2S data stream format options */ 42 /** Data Format bit field position. */ 44 /** Data Format bit field mask. */ 47 /** @brief Standard I2S Data Format. 49 * Serial data is transmitted in two's complement with the MSB first. Both [all …]
|
/Zephyr-latest/drivers/mdio/ |
D | mdio_shell.c | 2 * Copyright (c) 2021 IP-Logix Inc. 5 * SPDX-License-Identifier: Apache-2.0 53 * Scan the entire 5-bit address space of the MDIO bus 61 uint16_t data; in cmd_mdio_scan() local 66 shell_error(sh, "MDIO: Device driver %s is not ready.", dev->name); in cmd_mdio_scan() 68 return -ENODEV; in cmd_mdio_scan() 85 data = 0; in cmd_mdio_scan() 86 if (mdio_read(dev, i, reg_addr, &data) >= 0 && in cmd_mdio_scan() 87 data != UINT16_MAX) { in cmd_mdio_scan() 95 shell_print(sh, "%u devices found on %s", cnt, dev->name); in cmd_mdio_scan() [all …]
|
/Zephyr-latest/drivers/sensor/tdk/mpu9250/ |
D | mpu9250_trigger.c | 4 * SPDX-License-Identifier: Apache-2.0 23 struct mpu9250_data *drv_data = dev->data; in mpu9250_trigger_set() 24 const struct mpu9250_config *cfg = dev->config; in mpu9250_trigger_set() 27 if (trig->type != SENSOR_TRIG_DATA_READY) { in mpu9250_trigger_set() 28 return -ENOTSUP; in mpu9250_trigger_set() 31 ret = gpio_pin_interrupt_configure_dt(&cfg->int_pin, GPIO_INT_DISABLE); in mpu9250_trigger_set() 37 drv_data->data_ready_handler = handler; in mpu9250_trigger_set() 42 drv_data->data_ready_trigger = trig; in mpu9250_trigger_set() 44 ret = gpio_pin_interrupt_configure_dt(&cfg->int_pin, in mpu9250_trigger_set() 59 const struct mpu9250_config *cfg = drv_data->dev->config; in mpu9250_gpio_callback() [all …]
|
/Zephyr-latest/drivers/input/ |
D | input_ili2132a.c | 4 * SPDX-License-Identifier: Apache-2.0 37 struct ili2132a_data *data = CONTAINER_OF(cb, struct ili2132a_data, gpio_cb); in gpio_isr() local 39 k_work_submit(&data->work); in gpio_isr() 44 const struct ili2132a_config *dev_cfg = dev->config; in ili2132a_process() 49 ret = i2c_read_dt(&dev_cfg->i2c, buf, sizeof(buf)); in ili2132a_process() 51 LOG_ERR("Failed to read data: %d", ret); in ili2132a_process() 68 struct ili2132a_data *data = CONTAINER_OF(work_item, struct ili2132a_data, work); in ili2132a_work_handler() local 70 ili2132a_process(data->dev); in ili2132a_work_handler() 75 struct ili2132a_data *data = dev->data; in ili2132a_init() local 76 const struct ili2132a_config *dev_cfg = dev->config; in ili2132a_init() [all …]
|
/Zephyr-latest/dts/bindings/adc/ |
D | ti,ads131m02.yaml | 2 # SPDX-License-Identifier: Apache-2.0 8 include: [adc-controller.yaml, spi-device.yaml] 11 "#io-channel-cells": 14 drdy-gpios: 15 type: phandle-array 18 GPIO for data ready, becomes active when a conversion result is ready. 21 io-channel-cells: 22 - input
|
/Zephyr-latest/drivers/gpio/ |
D | gpio_max14916.c | 5 * SPDX-License-Identifier: Apache-2.0 29 struct max14916_data *data = dev->data; in max14916_pars_spi_diag() local 33 LOG_ERR("[DIAG] MAX14916 in SPI diag - error detected"); in max14916_pars_spi_diag() 35 data->glob.interrupt.reg_bits.SHT_VDD_FLT = MAX149X6_GET_BIT(rx_diag_buff[0], 5); in max14916_pars_spi_diag() 36 data->glob.interrupt.reg_bits.OW_ON_FLT = MAX149X6_GET_BIT(rx_diag_buff[0], 4); in max14916_pars_spi_diag() 37 data->glob.interrupt.reg_bits.OW_OFF_FLT = MAX149X6_GET_BIT(rx_diag_buff[0], 3); in max14916_pars_spi_diag() 38 data->glob.interrupt.reg_bits.CURR_LIM = MAX149X6_GET_BIT(rx_diag_buff[0], 2); in max14916_pars_spi_diag() 39 data->glob.interrupt.reg_bits.OVER_LD_FLT = MAX149X6_GET_BIT(rx_diag_buff[0], 1); in max14916_pars_spi_diag() 42 LOG_ERR("[DIAG] MAX14916 in SPI diag - GLOBAL FAULT detected"); in max14916_pars_spi_diag() 45 ret = -EIO; in max14916_pars_spi_diag() [all …]
|
/Zephyr-latest/include/zephyr/mgmt/mcumgr/transport/ |
D | smp_dummy.h | 3 * Copyright Laird Connectivity 2021-2022. All rights reserved. 5 * SPDX-License-Identifier: Apache-2.0 29 * @brief Adds SMPC data to the internal buffer to be processed 31 * @param data Input data buffer 32 * @param data_size Size of data (in bytes) 34 void dummy_mcumgr_add_data(uint8_t *data, uint16_t data_size); 40 * @retval net buffer of processed data 45 * @brief Waits for a period of time for outgoing SMPC data to be ready and 46 * returns either when a full message is ready or when the timeout has 49 * @param wait_time_s Time to wait for data (in seconds) [all …]
|
/Zephyr-latest/drivers/sensor/st/iis3dhhc/ |
D | Kconfig | 4 # SPDX-License-Identifier: Apache-2.0 15 Enable driver for IIS3DHHC SPI-based accelerometer sensor. 31 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_IIS3DHHC),irq-gpios) 37 depends on $(dt_compat_any_has_prop,$(DT_COMPAT_ST_IIS3DHHC),irq-gpios) 66 bool "Data ready interrupt to INT1 pin" 70 Say Y to route data ready interrupt to INT1 pin. Say N to route to
|