Home
last modified time | relevance | path

Searched +full:active +full:- +full:range +full:- +full:x +full:- +full:max (Results 1 – 25 of 42) sorted by relevance

12

/Zephyr-latest/dts/bindings/input/
Dcirque,pinnacle-common.yaml2 # SPDX-License-Identifier: Apache-2.0
7 data-ready-gpios:
8 type: phandle-array
11 which is active high when SW_DR or SW_CC are asserted. If connected
12 directly, the MCU pin should be configured as active low.
16 default: "4x"
18 ADC attenuation, 1x is the most sensitive and 4x is the least sensitive.
20 - "1x"
21 - "2x"
22 - "3x"
[all …]
/Zephyr-latest/dts/bindings/sensor/
Dti,fdc2x1x.yaml2 # SPDX-License-Identifier: Apache-2.0
8 include: [sensor-device.yaml, i2c-device.yaml]
11 sd-gpios:
12 type: phandle-array
14 The SD pin defaults to active high when consumed by the sensor.
18 intb-gpios:
19 type: phandle-array
21 The INTB pin defaults to active low when produced by the sensor.
28 Set to identify the sensor as FDC2114 or FDC2214 (4-channel version)
33 Set the Auto-Scan Mode.
[all …]
/Zephyr-latest/drivers/dai/intel/dmic/
Ddmic.h4 * SPDX-License-Identifier: Apache-2.0
29 #define DMIC_HW_CIC_SHIFT_MIN -8
40 #define DMIC_HW_DUTY_MAX 80 /* Note: Practical max value */
53 #define DMIC_HW_FIR_COEF_MAX ((1 << (DMIC_HW_BITS_FIR_COEF - 1)) - 1)
54 #define DMIC_HW_FIR_COEF_Q (DMIC_HW_BITS_FIR_COEF - 1)
60 #define DMIC_HW_FIR_GAIN_MAX ((1 << (DMIC_HW_BITS_FIR_GAIN - 1)) - 1)
67 * decibels, set to -90 dB.
72 * dy = y48 - y16; dx = 48000 - 16000;
74 * offs = round(y16 - coef/2^15 * 16000)
78 #define LOGRAMP_START_DB Q_CONVERT_FLOAT(-90, DB2LIN_FIXED_INPUT_QY)
[all …]
/Zephyr-latest/subsys/bluetooth/controller/ll_sw/
Dull_central_iso.c4 * SPDX-License-Identifier: Apache-2.0
152 * - Calculate ISO_Interval to allow SDU_Interval < ISO_Interval
187 /* CIG does not exist - create it */ in ll_cig_parameters_commit()
195 cig->lll.num_cis = 0U; in ll_cig_parameters_commit()
198 } else if (cig->state != CIG_STATE_CONFIGURABLE) { in ll_cig_parameters_commit()
204 num_cis = cig->lll.num_cis; in ll_cig_parameters_commit()
209 cig->state = CIG_STATE_CONFIGURABLE; in ll_cig_parameters_commit()
212 cig->lll.handle = ll_conn_iso_group_handle_get(cig); in ll_cig_parameters_commit()
213 cig->lll.role = BT_HCI_ROLE_CENTRAL; in ll_cig_parameters_commit()
214 cig->lll.resume_cis = LLL_HANDLE_INVALID; in ll_cig_parameters_commit()
[all …]
Dull_adv_iso.c4 * SPDX-License-Identifier: Apache-2.0
60 static uint32_t adv_iso_time_get(const struct ll_adv_iso_set *adv_iso, bool max);
127 if (!adv_iso || adv_iso->lll.adv) { in big_create()
141 lll_adv_sync = adv->lll.sync; in big_create()
142 if (!lll_adv_sync || lll_adv_sync->iso) { in big_create()
243 if (adv->lll.aux) { in big_create()
244 aux = HDR_LLL2ULL(adv->lll.aux); in big_create()
250 if (aux && aux->is_started) { in big_create()
251 ticks_slot_aux = aux->ull.ticks_slot; in big_create()
254 MAX(aux->ull.ticks_active_to_start, in big_create()
[all …]
/Zephyr-latest/include/zephyr/drivers/
Dregulator.h2 * Copyright (c) 2019-2020 Peter Bigot Consulting, LLC
7 * SPDX-License-Identifier: Apache-2.0
67 /** @brief Driver-specific API functions to support parent regulator control. */
100 /** @brief Driver-specific API functions to support regulator control. */
130 /** Regulator active discharge state mask */
132 /** Regulator active discharge state flag position*/
134 /** Disable regulator active discharge */
136 /** Enable regulator active discharge */
138 /** Leave regulator active discharge state as default */
140 /** Regulator active discharge set bits */
[all …]
Dsensor.h10 * SPDX-License-Identifier: Apache-2.0
42 * and can be obtained using the formula val1 + val2 * 10^(-6). Negative
47 * -0.5: val1 = 0, val2 = -500000
48 * -1.0: val1 = -1, val2 = 0
49 * -1.5: val1 = -1, val2 = -500000
54 /** Fractional part of the value (in one-millionth parts). */
62 /** Acceleration on the X axis, in m/s^2. */
68 /** Acceleration on the X, Y and Z axes. */
70 /** Angular velocity around the X axis, in radians/s. */
76 /** Angular velocity around the X, Y and Z axes. */
[all …]
/Zephyr-latest/drivers/usb/device/
Dusb_dc_stm32.c3 * Copyright (c) 2017, I-SENSE group of ICCS
5 * SPDX-License-Identifier: Apache-2.0
41 * pin(s) in the device tree. E.g: pinctrl-0 = <&usb_otg_fs_vbus_pa9 ...>;
133 /* We need a minimum size for RX FIFO - exact number seemingly determined through trial and error */
139 #define TX_FIFO_WORDS (USB_RAM_SIZE / 4 - RX_FIFO_EP_WORDS - TX_FIFO_EP_0_WORDS)
141 #define TX_FIFO_EP_WORDS (TX_FIFO_WORDS / (TX_FIFO_NUM - 1))
155 uint16_t ep_mps; /** Endpoint max packet size */
234 return -EIO; in usb_dc_stm32u5_phy_clock_select()
246 return -EINVAL; in usb_dc_stm32u5_phy_clock_select()
256 return -EIO; in usb_dc_stm32u5_phy_clock_enable()
[all …]
Dusb_dc_kinetis.c1 /* usb_dc_kinetis.c - Kinetis USBFSOTG usb device driver */
6 * SPDX-License-Identifier: Apache-2.0
152 SIM->SOPT1 |= SIM_SOPT1_USBREGEN_MASK; in kinetis_usb_init()
155 USB0->USBTRC0 |= USB_USBTRC0_USBRESET_MASK; in kinetis_usb_init()
158 USB0->CTL = 0; in kinetis_usb_init()
160 USB0->CTL |= USB_CTL_USBENSOFEN_MASK; in kinetis_usb_init()
162 if ((USB0->PERID != USBFSOTG_PERID) || in kinetis_usb_init()
163 (USB0->REV != USBFSOTG_REV)) { in kinetis_usb_init()
164 return -1; in kinetis_usb_init()
167 USB0->BDTPAGE1 = (uint8_t)(((uint32_t)bdt) >> 8); in kinetis_usb_init()
[all …]
/Zephyr-latest/drivers/clock_control/
Dclock_control_litex.c4 * SPDX-License-Identifier: Apache-2.0
66 …* https://github.com/Digilent/Zybo-hdmi-out/blob/b991fff6e964420ae3c00c3dbee52f2ad748b3ba/sdk/disp…
213 return litex_clk_filter_table[glob_mul - 1]; in litex_clk_lookup_filter()
219 return litex_clk_lock_table[glob_mul - 1]; in litex_clk_lookup_lock()
234 int assert = (1 << (drp[reg].size * BITS_PER_BYTE)) - 1; in litex_clk_assert_reg()
251 timeout = ldev->timeout.lock; in litex_clk_wait()
253 timeout = ldev->timeout.drdy; in litex_clk_wait()
257 timeout--; in litex_clk_wait()
261 LOG_WRN("Timeout occured when waiting for the register: 0x%x", reg); in litex_clk_wait()
262 return -ETIME; in litex_clk_wait()
[all …]
/Zephyr-latest/drivers/dma/
Ddma_iproc_pax_v1.c4 * SPDX-License-Identifier: Apache-2.0
33 return ring->pkt_id = 0x0; in reset_pkt_id()
37 * @brief Opaque/packet id allocator, range 0 to 31
41 ring->pkt_id = (ring->pkt_id + 1) % 32; in alloc_pkt_id()
42 return ring->pkt_id; in alloc_pkt_id()
47 return ring->pkt_id; in curr_pkt_id()
52 return ring->curr.toggle; in curr_toggle_val()
63 r->opq = opq; in rm_write_header_desc()
65 r->bdcount = bdcount; in rm_write_header_desc()
66 r->prot = 0x0; in rm_write_header_desc()
[all …]
Ddma_iproc_pax_v2.c4 * SPDX-License-Identifier: Apache-2.0
32 * @brief Opaque/packet id allocator, range 0 to 31
36 return ring->pkt_id = 0x0; in reset_pkt_id()
41 ring->pkt_id = (ring->pkt_id + 1) % 32; in alloc_pkt_id()
42 return ring->pkt_id; in alloc_pkt_id()
47 return ring->pkt_id; in curr_pkt_id()
52 return ring->curr.toggle; in curr_toggle_val()
64 r->opq = opq; in rm_write_header_desc()
65 r->bdf = 0x0; in rm_write_header_desc()
66 r->res1 = 0x0; in rm_write_header_desc()
[all …]
/Zephyr-latest/arch/arm64/core/
Dmmu.c7 * SPDX-License-Identifier: Apache-2.0
22 #include <zephyr/linker/linker-defs.h>
37 /* Usage count value range */
63 unsigned int i = (pte - xlat_tables) / Ln_XLAT_NUM_ENTRIES; in table_index()
65 __ASSERT(i < CONFIG_MAX_XLAT_TABLES, "table %p out of range", pte); in table_index()
78 MMU_DEBUG("table [%d]%p: usage %#x -> %#x\n", i, table, prev_count, new_count); in table_usage()
101 table_usage(table, -ref_unit); in dec_table_ref()
175 bool aligned = (desc & PTE_PHYSADDR_MASK & (level_size - 1)) == 0; in is_desc_block_aligned()
178 MMU_DEBUG("misaligned desc 0x%016llx for block size 0x%x\n", in is_desc_block_aligned()
200 MMU_DEBUG("---\n"); in debug_show_pte()
[all …]
/Zephyr-latest/drivers/input/
Dinput_pinnacle.c4 * SPDX-License-Identifier: Apache-2.0
27 * Standard registers have 5-bit addresses, BIT[4:0], that range from
87 /* X max to 0 */
89 /* Y max to 0 */
136 #define PINNACLE_SPI_FC 0xFC /* Auto-increment byte */
217 const struct pinnacle_config *config = dev->config; in pinnacle_bus_is_ready()
219 return config->bus.is_ready(&config->bus); in pinnacle_bus_is_ready()
224 const struct pinnacle_config *config = dev->config; in pinnacle_write()
226 return config->bus.write(&config->bus, address, value); in pinnacle_write()
231 const struct pinnacle_config *config = dev->config; in pinnacle_seq_write()
[all …]
/Zephyr-latest/drivers/sensor/st/vl53l0x/
Dvl53l0x.c1 /* vl53l0x.c - Driver for ST VL53L0X time of flight sensor */
8 * SPDX-License-Identifier: Apache-2.0
31 * https://www.st.com/en/embedded-software/stsw-img005.html
33 * https://www.st.com/en/embedded-software/stm32cubel4.html
44 /* tBOOT (1.2ms max.) VL53L0X firmware boot period */
60 struct vl53l0x_data *drv_data = dev->data; in vl53l0x_setup_single_shot()
67 ret = VL53L0X_StaticInit(&drv_data->vl53l0x); in vl53l0x_setup_single_shot()
70 dev->name); in vl53l0x_setup_single_shot()
74 ret = VL53L0X_PerformRefCalibration(&drv_data->vl53l0x, in vl53l0x_setup_single_shot()
79 dev->name); in vl53l0x_setup_single_shot()
[all …]
/Zephyr-latest/drivers/usb/udc/
Dudc_stm32.c4 * SPDX-License-Identifier: Apache-2.0
78 const struct device *dev = priv->dev; in HAL_PCD_ResetCallback()
79 const struct udc_stm32_config *cfg = dev->config; in HAL_PCD_ResetCallback()
82 /* Re-Enable control endpoints */ in HAL_PCD_ResetCallback()
84 if (ep && ep->stat.enabled) { in HAL_PCD_ResetCallback()
85 HAL_PCD_EP_Open(&priv->pcd, USB_CONTROL_EP_OUT, cfg->ep0_mps, in HAL_PCD_ResetCallback()
90 if (ep && ep->stat.enabled) { in HAL_PCD_ResetCallback()
91 HAL_PCD_EP_Open(&priv->pcd, USB_CONTROL_EP_IN, cfg->ep0_mps, in HAL_PCD_ResetCallback()
95 udc_submit_event(priv->dev, UDC_EVT_RESET, 0); in HAL_PCD_ResetCallback()
102 udc_submit_event(priv->dev, UDC_EVT_VBUS_READY, 0); in HAL_PCD_ConnectCallback()
[all …]
/Zephyr-latest/drivers/can/
Dcan_shell.c5 * SPDX-License-Identifier: Apache-2.0
36 /* zephyr-keep-sorted-start */
38 CAN_SHELL_MODE_MAPPING("listen-only", CAN_MODE_LISTENONLY),
40 CAN_SHELL_MODE_MAPPING("manual-recovery", CAN_MODE_MANUAL_RECOVERY),
42 CAN_SHELL_MODE_MAPPING("one-shot", CAN_MODE_ONE_SHOT),
43 CAN_SHELL_MODE_MAPPING("triple-sampling", CAN_MODE_3_SAMPLES),
44 /* zephyr-keep-sorted-stop */
88 uint8_t nbytes = can_dlc_to_bytes(frame->dlc); in can_shell_print_frame()
98 shell_fprintf_normal(sh, "(%05d) ", frame->timestamp); in can_shell_print_frame()
101 shell_fprintf_normal(sh, "%s ", dev->name); in can_shell_print_frame()
[all …]
/Zephyr-latest/subsys/usb/device_next/class/
Dusbd_uac2.c2 * Copyright (c) 2023-2024 Nordic Semiconductor ASA
4 * SPDX-License-Identifier: Apache-2.0
37 * requires 6 bytes) and feedback endpoint (4 bytes on High-Speed, 3 bytes on
38 * Full-Speed). Because the total number of endpoints is really small (typically
40 * the USB specification itself is 30 non-control endpoints). Therefore, the
51 /* A.14 Audio Class-Specific Request Codes */
53 #define RANGE 0x02 macro
60 #define CONTROL_ATTRIBUTE(setup) (setup->bRequest)
61 #define CONTROL_ENTITY_ID(setup) ((setup->wIndex & 0xFF00) >> 8)
62 #define CONTROL_SELECTOR(setup) ((setup->wValue & 0xFF00) >> 8)
[all …]
/Zephyr-latest/drivers/ieee802154/
Dieee802154_cc13xx_cc26xx_subg.c4 * SPDX-License-Identifier: Apache-2.0
45 /* User-defined CMD_PROP_RADIO_DIV_SETUP structures */
54 /* Radio register overrides for CC13x2R (note: CC26x2 does not support sub-GHz radio)
55 * from SmartRF Studio (200kbps, 50kHz deviation, 2-GFSK, 311.8kHz Rx BW),
73 /* Rx: Set RSSI offset to adjust reported RSSI by -1 dB (default: -2),
77 /* Rx: Set anti-aliasing filter bandwidth to 0x8 (in ADI0, set IFAMPCTL3[7:4]=0x8) */
79 /* Tx: Set PA trim to max to maximize its output power (in ADI0, set PACTL0=0xF8) */
86 /* CC1352P overrides from SmartRF Studio (200kbps, 50kHz deviation, 2-GFSK, 311.8kHz Rx BW) */
92 /* Rx: Set RSSI offset to adjust reported RSSI by -1 dB (default: -2),
96 /* Rx: Set anti-aliasing filter bandwidth to 0x6 (in ADI0, set IFAMPCTL3[7:4]=0x8) */
[all …]
/Zephyr-latest/include/zephyr/net/
Dwifi.h5 * SPDX-License-Identifier: Apache-2.0
10 * @brief IEEE 802.11 protocol and general Wi-Fi definitions.
14 * @brief Wi-Fi Management API.
15 * @defgroup wifi_mgmt Wi-Fi Management
45 /** WPA2-PSK security. */
47 /** WPA2-PSK-SHA256 security. */
49 /** WPA3-SAE security. */
51 /** WPA3-SAE security with hunting-and-pecking loop. */
53 /** WPA3-SAE security with hash-to-element. */
55 /** WPA3-SAE security with both hunting-and-pecking loop and hash-to-element enabled. */
[all …]
/Zephyr-latest/tests/bluetooth/controller/ctrl_isoal/src/sub_sets/
Disoal_test_tx.c4 * SPDX-License-Identifier: Apache-2.0
12 /*------------------ PDU Allocation Callback ---------------------------------*/
72 /*------------------ PDU Write Callback --------------------------------------*/
145 zassert_false((pdu_offset + consume_len) > pdu_buffer->size, in custom_source_pdu_write_test()
151 memcpy(&pdu_buffer->pdu->payload[pdu_offset], sdu_payload, consume_len); in custom_source_pdu_write_test()
202 /*------------------ PDU Emit Callback --------------------------------------*/
222 zassert_not_null(node_tx->pdu); in custom_source_pdu_emit_test()
223 source_pdu_emit_test_handler(*node_tx, *((struct pdu_iso *)node_tx->pdu)); in custom_source_pdu_emit_test()
266 "\t\t%08x != %08x", \
277 /*------------------ PDU Release Callback --------------------------------------*/
[all …]
/Zephyr-latest/drivers/ethernet/
Deth_xlnx_gem.c5 * SPDX-License-Identifier: Apache-2.0
8 * - Only supports 32-bit addresses in buffer descriptors, therefore
9 * the ZynqMP APU (Cortex-A53 cores) may not be fully supported.
10 * - Hardware timestamps not considered.
11 * - VLAN tags not considered.
12 * - Wake-on-LAN interrupt not supported.
13 * - Send function is not SMP-capable (due to single TX done semaphore).
14 * - Interrupt-driven PHY management not supported - polling only.
15 * - No explicit placement of the DMA memory area(s) in either a
18 * with the Cortex-R5 QEMU target or an actual R5 running without the
[all …]
/Zephyr-latest/kernel/
Dmmu.c4 * SPDX-License-Identifier: Apache-2.0
17 #include <zephyr/linker/linker-defs.h>
31 * - A page frame is a page-sized physical memory region in RAM. It is a
37 * - A data page is a page-sized region of data. It may exist in a page frame,
76 #define COLOR(x) printk(_CONCAT(ANSI_, x)) argument
78 #define COLOR(x) do { } while (false) argument
86 printk("-"); in page_frame_dump()
113 printk("Physical memory from 0x%lx to 0x%lx\n", in k_mem_page_frames_dump()
160 * +--------------+ <- K_MEM_VIRT_RAM_START
161 * | Undefined VM | <- May contain ancillary regions like x86_64's locore
[all …]
/Zephyr-latest/subsys/bluetooth/mesh/
Daccess.c4 * SPDX-License-Identifier: Apache-2.0
36 /* 20 - 50ms */
38 /* 20 - 500ms */
75 /** Type of relation; value in range 0x00-0xFE marks correspondence
100 (mod_rel_list[(idx)].elem_base == mod->rt->elem_idx && \
101 mod_rel_list[(idx)].idx_base == mod->rt->mod_idx + (offset))
104 (mod_rel_list[(idx)].elem_ext == mod->rt->elem_idx && \
105 mod_rel_list[(idx)].idx_ext == mod->rt->mod_idx + (offset))
130 for (i = 0; i < dev_comp->elem_count; i++) { in bt_mesh_model_foreach()
131 const struct bt_mesh_elem *elem = &dev_comp->elem[i]; in bt_mesh_model_foreach()
[all …]
/Zephyr-latest/scripts/kconfig/
Dkconfiglib.py1 # Copyright (c) 2011-2019, Ulf Magnusson
2 # SPDX-License-Identifier: ISC
9 from Kconfig (https://www.kernel.org/doc/Documentation/kbuild/kconfig-language.txt)
27 $ wget -qO- https://raw.githubusercontent.com/ulfalizer/Kconfiglib/master/makefile.patch | git am
28 …$ wget -qO- https://raw.githubusercontent.com/ulfalizer/Kconfiglib/master/makefile.patch | patch -
30 Warning: Not passing -p1 to patch will cause the wrong file to be patched.
43 $ git am Kconfiglib/makefile.patch (or 'patch -p1 < Kconfiglib/makefile.patch')
53 ----------------
61 --------------
69 --------------------------------
[all …]

12