Home
last modified time | relevance | path

Searched +full:rx +full:- +full:wake +full:- +full:timeout (Results 1 – 25 of 53) sorted by relevance

123

/Zephyr-latest/dts/bindings/serial/
Drenesas,smartbond-uart.yaml3 compatible: "renesas,smartbond-uart"
5 include: [uart-controller.yaml, pinctrl-device.yaml]
14 periph-clock-config:
19 current-speed:
24 - 4800
25 - 9600
26 - 14400
27 - 19200
28 - 28800
29 - 38400
[all …]
/Zephyr-latest/drivers/serial/
Duart_stm32.h2 * Copyright (c) 2016 Open-RnD Sp. z o.o.
4 * SPDX-License-Identifier: Apache-2.0
38 /* enable tx/rx pin swap */
40 /* enable rx pin inversion */
61 /* Device defined as wake-up source */
81 int32_t timeout; member
Duart_npcx.c4 * SPDX-License-Identifier: Apache-2.0
33 /* int-mux configuration */
105 if (atomic_test_and_set_bit(data->pm_policy_state_flag, flag) == 0) { in uart_npcx_pm_policy_state_lock_get()
113 if (atomic_test_and_clear_bit(data->pm_policy_state_flag, flag) == 1) { in uart_npcx_pm_policy_state_lock_put()
124 * - 115200 in uart_set_npcx_baud_rate()
125 * - 3000000 in uart_set_npcx_baud_rate()
129 inst->UPSR = 0x38; in uart_set_npcx_baud_rate()
130 inst->UBAUD = 0x01; in uart_set_npcx_baud_rate()
132 inst->UPSR = 0x08; in uart_set_npcx_baud_rate()
133 inst->UBAUD = 0x0a; in uart_set_npcx_baud_rate()
[all …]
Duart_mchp_xec.c2 * Copyright (c) 2010, 2012-2015 Wind River Systems, Inc.
6 * SPDX-License-Identifier: Apache-2.0
97 * RXRDY pin will go inactive when there are no more charac-
101 * FCR3 = 1 and the trigger level or the timeout has been
102 * reached, the RXRDY pin will go low active. Once it is acti-
107 * FIFO Mode (FCR0 = 1, FCR3 = 0) and there are no charac-
173 #define IIRC(dev) (((struct uart_xec_dev_data *)(dev)->data)->iir_cache)
242 struct uart_xec_device_config const *dev_cfg = dev->config; in uart_clr_slp_en()
244 z_mchp_xec_pcr_periph_sleep(dev_cfg->pcr_idx, dev_cfg->pcr_bitpos, 0); in uart_clr_slp_en()
249 struct uart_xec_device_config const *dev_cfg = dev->config; in uart_xec_girq_clr()
[all …]
/Zephyr-latest/modules/openthread/
DKconfig.thread4 # SPDX-License-Identifier: Apache-2.0
48 bool "FTD - Full Thread Device"
50 bool "MTD - Minimal Thread Device"
54 bool "SED - Sleepy End Device"
73 string "The platform-specific string to insert into the OpenThread version string"
88 Defines how many microseconds ahead should MAC deliver a CSL frame to the sub-MAC layer.
91 int "CSL receiver wake up margin in microseconds"
114 int "CSL timeout in seconds"
117 The default CSL timeout in seconds.
150 default -65
[all …]
/Zephyr-latest/drivers/ieee802154/
Dieee802154_dw1000_regs.h4 * SPDX-License-Identifier: Apache-2.0
7 * https://github.com/Decawave/mynewt-dw1000-core.git
14 * Copyright (C) 2017-2018, Decawave Limited, All Rights Reserved
24 * http://www.apache.org/licenses/LICENSE-2.0
75 /* Frame Filtering Behave as a Co-ordinator */
97 /* Disable Double RX Buffer */
114 /* Receive Wait Timeout Enable. */
117 * Receiver Auto-Re-enable.
118 * This bit is used to cause the receiver to re-enable automatically
126 /* System Time Counter (40-bit) */
[all …]
Dieee802154_dw1000.c4 * SPDX-License-Identifier: Apache-2.0
78 uint8_t rx_shr_code; /* RX SHR preamble code */
79 uint8_t rx_ns_sfd; /* non-standard SFD */
80 uint16_t rx_sfd_to; /* SFD timeout value (in symbols)
81 * (tx_shr_nsync + 1 + SFD_length - rx_pac_l)
136 .rx_sfd_to = (129 + 8 - 8),
143 /* This struct is used to read all additional RX frame info at one push */
158 struct dwt_context *ctx = dev->data; in dwt_spi_read()
159 const struct dwt_hi_cfg *hi_cfg = dev->config; in dwt_spi_read()
178 const struct spi_buf_set rx = { in dwt_spi_read() local
[all …]
Dieee802154_mcr20a.c1 /* ieee802154_mcr20a.c - NXP MCR20A driver */
8 * SPDX-License-Identifier: Apache-2.0
113 #define MCR20A_OUTPUT_POWER_MIN (-35)
132 * Fc = 2405 + 5(k - 11) , k = 11,12,...,26
157 const struct mcr20a_config *config = dev->config; in z_mcr20a_read_reg()
173 const struct spi_buf_set rx = { in z_mcr20a_read_reg() local
178 if (spi_transceive_dt(&config->bus, &tx, &rx) == 0) { in z_mcr20a_read_reg()
179 return cmd_buf[len - 1]; in z_mcr20a_read_reg()
191 const struct mcr20a_config *config = dev->config; in z_mcr20a_write_reg()
207 return (spi_write_dt(&config->bus, &tx) == 0); in z_mcr20a_write_reg()
[all …]
/Zephyr-latest/kernel/
Dmailbox.c4 * SPDX-License-Identifier: Apache-2.0
52 * Do run-time initialization of mailbox object subsystem.
89 z_waitq_init(&mbox->tx_msg_queue); in k_mbox_init()
90 z_waitq_init(&mbox->rx_msg_queue); in k_mbox_init()
91 mbox->lock = (struct k_spinlock) {}; in k_mbox_init()
110 * @return 0 if successfully matched, otherwise -1.
117 if (((tx_msg->tx_target_thread == (k_tid_t)K_ANY) || in mbox_message_match()
118 (tx_msg->tx_target_thread == rx_msg->tx_target_thread)) && in mbox_message_match()
119 ((rx_msg->rx_source_thread == (k_tid_t)K_ANY) || in mbox_message_match()
120 (rx_msg->rx_source_thread == tx_msg->rx_source_thread))) { in mbox_message_match()
[all …]
/Zephyr-latest/dts/arm/nuvoton/npcx/
Dnpcx4.dtsi4 * SPDX-License-Identifier: Apache-2.0
8 #include "npcx4/npcx4-alts-map.dtsi"
10 #include "npcx4/npcx4-miwus-wui-map.dtsi"
12 #include "npcx4/npcx4-miwus-int-map.dtsi"
14 #include "npcx4/npcx4-espi-vws-map.dtsi"
15 /* npcx4 series low-voltage io controls mapping table */
16 #include "npcx4/npcx4-lvol-ctrl-map.dtsi"
18 #include "zephyr/dt-bindings/reset/npcx4_reset.h"
26 cpu-power-states = <&suspend_to_idle0>;
29 power-states {
[all …]
/Zephyr-latest/drivers/espi/
Despi_npcx.c4 * SPDX-License-Identifier: Apache-2.0
15 #include <zephyr/dt-bindings/espi/npcx_espi.h>
32 /* mapping table between eSPI reset signal and wake-up input */
77 ((struct espi_reg *)((const struct espi_npcx_config *)(dev)->config)->base)
132 /* eSPI Virtual Wire Input (Master-to-Slave) signals configuration structure */
136 uint8_t bitmask; /* VW signal bits-mask */
140 /* eSPI Virtual Wire Output (Slave-to-Master) signals configuration structure */
144 uint8_t bitmask; /* VW signal bits-mask */
149 * npcxn-espi-vws-map.dtsi device tree file for more detail.
237 /* VW signal which has no wake-up input source */ in espi_init_wui_callback()
[all …]
/Zephyr-latest/subsys/ipc/ipc_service/backends/
Dipc_icbmsg.c4 * SPDX-License-Identifier: Apache-2.0
14 * --------------------------
16 * Single channel (RX or TX) of the shared memory is divided into two areas: ICMsg area
17 * followed by Blocks area. ICMsg is used to send and receive short 3-byte messages.
22 * +------------+-------------+
24 * +------------+-------------+
27 * +-----------+-----------+-----------+-----------+- -+-----------+
28 * | Block 0 | Block 1 | Block 2 | Block 3 | ... | Block N-1 |
29 * +-----------+-----------+-----------+-----------+- -+-----------+
32 * +------+--------------------------------+---------+
[all …]
/Zephyr-latest/subsys/bluetooth/host/classic/
Drfcomm.c1 /* rfcomm.c - RFCOMM handling */
6 * SPDX-License-Identifier: Apache-2.0
39 #define RFCOMM_MAX_CREDITS (BT_BUF_ACL_RX_COUNT - 1)
54 /* Pool for dummy buffers to wake up the tx threads */
62 /* reversed, 8-bit, poly=0x07 */
109 while (len--) { in rfcomm_calc_fcs()
114 return (0xff - fcs); in rfcomm_calc_fcs()
122 while (len--) { in rfcomm_check_fcs()
136 for (; dlcs; dlcs = dlcs->_next) { in rfcomm_dlcs_lookup_dlci()
137 if (dlcs->dlci == dlci) { in rfcomm_dlcs_lookup_dlci()
[all …]
/Zephyr-latest/subsys/net/lib/sockets/
Dsockets_can.c5 * SPDX-License-Identifier: Apache-2.0
45 k_timeout_t timeout) in k_fifo_wait_non_empty() argument
52 return k_poll(events, ARRAY_SIZE(events), timeout); in k_fifo_wait_non_empty()
63 return -1; in zcan_socket()
69 errno = -ret; in zcan_socket()
70 return -1; in zcan_socket()
74 ctx->user_data = NULL; in zcan_socket()
76 k_fifo_init(&ctx->recv_q); in zcan_socket()
81 k_condvar_init(&ctx->cond.recv); in zcan_socket()
142 /* To prevent the reader from missing the wake-up signal in zcan_received_cb()
[all …]
/Zephyr-latest/drivers/ethernet/
Deth_lan9250.c1 /* LAN9250 Stand-alone Ethernet Controller with SPI
5 * SPDX-License-Identifier: Apache-2.0
26 const struct lan9250_config *config = dev->config; in lan9250_write_sys_reg()
43 return spi_write_dt(&config->spi, &tx); in lan9250_write_sys_reg()
48 const struct lan9250_config *config = dev->config; in lan9250_read_sys_reg()
54 const struct spi_buf_set rx = {.buffers = rx_buf, .count = 3}; in lan9250_read_sys_reg() local
72 return spi_transceive_dt(&config->spi, &tx, &rx); in lan9250_read_sys_reg()
89 return -EIO; in lan9250_wait_ready()
141 return -EIO; in lan9250_wait_mac_ready()
155 * https://github.com/microchip-pic-avr-solutions/ethernet-lan9250/ in lan9250_read_phy_reg()
[all …]
/Zephyr-latest/drivers/bluetooth/hci/
Dipm_stm32wb.c1 /* ipm_stm32wb.c - HCI driver for stm32wb shared ram */
4 * Copyright (c) 2019-2022 Linaro Ltd.
6 * SPDX-License-Identifier: Apache-2.0
33 /* Private variables ---------------------------------------------------------*/
80 /* Rx thread definitions */
128 * https://github.com/zephyrproject-rtos/zephyr/issues/19509
139 struct bt_hci_evt_le_meta_event *mev = (void *)&tev->payload; in tryfix_event()
141 if (tev->evtcode != BT_HCI_EVT_LE_META_EVENT || in tryfix_event()
142 mev->subevent != BT_HCI_EVT_LE_ENH_CONN_COMPLETE) { in tryfix_event()
149 if (bt_addr_eq(&evt->peer_addr.a, BT_ADDR_NONE)) { in tryfix_event()
[all …]
/Zephyr-latest/include/zephyr/rtio/
Drtio.h4 * SPDX-License-Identifier: Apache-2.0
9 * @brief Real-Time IO device API for moving bytes with low effort
126 * -ECANCELED as the result.
318 } rx; member
334 uint32_t buf_len; /**< Length of tx and rx buffers */
456 if (r == NULL || r->block_pool == NULL) { in rtio_mempool_block_size()
459 return BIT(r->block_pool->info.blk_sz_shift); in rtio_mempool_block_size()
474 struct sys_mem_blocks *mem_pool = r->block_pool; in __rtio_compute_mempool_block_index()
477 uintptr_t buff = (uintptr_t)mem_pool->buffer; in __rtio_compute_mempool_block_index()
478 uint32_t buff_size = mem_pool->info.num_blocks * block_size; in __rtio_compute_mempool_block_index()
[all …]
/Zephyr-latest/dts/arm/silabs/
Defr32bg2x.dtsi4 * SPDX-License-Identifier: Apache-2.0
7 #include <arm/armv8-m.dtsi>
8 #include <dt-bindings/gpio/gpio.h>
9 #include <dt-bindings/i2c/i2c.h>
10 #include <dt-bindings/pinctrl/gecko-pinctrl.h>
11 #include <dt-bindings/adc/adc.h>
16 zephyr,flash-controller = &msc;
22 #clock-cells = <0>;
23 compatible = "fixed-factor-clock";
27 #clock-cells = <0>;
[all …]
Defr32xg23.dtsi4 * SPDX-License-Identifier: Apache-2.0
7 #include <arm/armv8-m.dtsi>
8 #include <dt-bindings/gpio/gpio.h>
9 #include <dt-bindings/i2c/i2c.h>
10 #include <dt-bindings/adc/adc.h>
11 #include <dt-bindings/clock/silabs/xg23-clock.h>
16 zephyr,flash-controller = &msc;
22 #clock-cells = <0>;
23 compatible = "fixed-factor-clock";
27 #clock-cells = <0>;
[all …]
Defr32mg24.dtsi4 * SPDX-License-Identifier: Apache-2.0
7 #include <arm/armv8-m.dtsi>
8 #include <dt-bindings/gpio/gpio.h>
9 #include <dt-bindings/i2c/i2c.h>
10 #include <dt-bindings/adc/adc.h>
11 #include <dt-bindings/clock/silabs/xg24-clock.h>
16 zephyr,flash-controller = &msc;
22 #clock-cells = <0>;
23 compatible = "fixed-factor-clock";
27 #clock-cells = <0>;
[all …]
/Zephyr-latest/include/zephyr/net/
Dwifi_mgmt.h6 * SPDX-License-Identifier: Apache-2.0
66 /** @brief Wi-Fi management commands */
68 /** Scan for Wi-Fi networks */
70 /** Connect to a Wi-Fi network */
72 /** Disconnect from a Wi-Fi network */
100 /** Set or get Wi-Fi channel for Monitor or TX-Injection mode */
104 /** Get Wi-Fi driver and Firmware versions */
106 /** Get Wi-Fi latest connection parameters */
143 /** Request a Wi-Fi scan */
149 /** Request a Wi-Fi connect */
[all …]
/Zephyr-latest/subsys/bluetooth/host/
Dconn.c1 /* conn.c - Bluetooth connection handling */
4 * Copyright (c) 2015-2016 Intel Corporation
6 * SPDX-License-Identifier: Apache-2.0
66 bt_conn_tx_cb_t cb = tx->cb; in conn_tx_destroy()
67 void *user_data = tx->user_data; in conn_tx_destroy()
77 cb(conn, user_data, -ESHUTDOWN); in conn_tx_destroy()
91 /* Peripheral timeout to initialize Connection Parameter Update procedure */
123 /* TODO: remove user-data requirements */
140 bt_buf_destroy_view(frag, &get_frag_md(frag)->view_meta); in frag_destroy()
161 winsize, &get_frag_md(window)->view_meta); in get_data_frag()
[all …]
/Zephyr-latest/subsys/bluetooth/controller/ll_sw/openisa/hal/RV32M1/radio/
Dradio.c2 * Copyright (c) 2016 - 2019 Nordic Semiconductor ASA
4 * Copyright 2019 - 2020 NXP
6 * SPDX-License-Identifier: Apache-2.0
43 #define RADIO_AESCCM_HDR_MASK 0xE3 /* AES-CCM: NESN, SN, MD bits masked to 0 */
44 #define RADIO_PDU_LEN_MAX (BIT(8) - 1)
46 ((bytes) * 8 >> (__builtin_ffs(bits_per_usec) - 1))
52 #define RX_WTMRK 5 /* (AA + PDU header) - 1 */
55 #define RX_OVHD 32 /* Rx overhead */
60 #define PB_RX_PDU (PB_RX + 2) /* Rx PDU offset (in halfwords) in PB */
99 static uint32_t tmr_ready; /* radio ready for Tx/Rx timestamp */
[all …]
/Zephyr-latest/drivers/ps2/
Dps2_npcx_controller.c4 * SPDX-License-Identifier: Apache-2.0
21 #include <zephyr/dt-bindings/clock/npcx_clock.h>
30 * Set WDAT3-0 and clear CLK3-0 in the PSOSIG register to
39 * The max duration of a PS/2 clock is about 100 micro-seconds.
56 * (i.e. the bit position of CLK3-0 in the PS2_PSOSIG register)
71 ((struct ps2_reg *)((const struct ps2_npcx_ctrl_config *)(dev)->config)->base)
81 struct ps2_npcx_ctrl_data *const data = dev->data; in ps2_npcx_ctrl_configure()
85 return -EINVAL; in ps2_npcx_ctrl_configure()
89 return -EINVAL; in ps2_npcx_ctrl_configure()
92 k_sem_take(&data->lock, K_FOREVER); in ps2_npcx_ctrl_configure()
[all …]
/Zephyr-latest/subsys/canbus/isotp/
Disotp.c5 * SPDX-License-Identifier: Apache-2.0
46 frame->id = addr->ext_id; in prepare_frame()
47 frame->flags = ((addr->flags & ISOTP_MSG_IDE) != 0 ? CAN_FRAME_IDE : 0) | in prepare_frame()
48 ((addr->flags & ISOTP_MSG_FDF) != 0 ? CAN_FRAME_FDF : 0) | in prepare_frame()
49 ((addr->flags & ISOTP_MSG_BRS) != 0 ? CAN_FRAME_BRS : 0); in prepare_frame()
55 filter->id = addr->ext_id; in prepare_filter()
56 filter->mask = mask; in prepare_filter()
57 filter->flags = (addr->flags & ISOTP_MSG_IDE) != 0 ? CAN_FILTER_IDE : 0; in prepare_filter()
61 * Wake every context that is waiting for a buffer
72 k_work_submit(&rctx->work); in receive_pool_free()
[all …]

123