/Zephyr-latest/dts/bindings/ospi/ |
D | st,stm32-ospi.yaml | 2 # SPDX-License-Identifier: Apache-2.0 9 pinctrl-0 = <&octospi_clk_pe9 &octospi_ncs_pe10 &octospi_dqs_pe11 16 dma-names = "tx_rx"; 21 compatible: "st,stm32-ospi" 23 include: [base.yaml, pinctrl-device.yaml] 34 pinctrl-0: 37 pinctrl-names: 40 clock-names: 50 - &dma1: dma controller phandle 51 - 5: channel number (0 to Max-Channel minus 1). From 0 to 15 on stm32u5x. [all …]
|
/Zephyr-latest/drivers/gpio/ |
D | gpio_npcx.c | 4 * SPDX-License-Identifier: Apache-2.0 12 #include <zephyr/dt-bindings/gpio/nuvoton-npcx-gpio.h> 34 /* IO port */ 35 int port; member 50 ((struct gpio_reg *)((const struct gpio_npcx_config *)(dev)->config)->base) 53 const struct device *npcx_get_gpio_dev(int port) in npcx_get_gpio_dev() argument 55 if (port >= ARRAY_SIZE(gpio_devs)) { in npcx_get_gpio_dev() 59 return gpio_devs[port]; in npcx_get_gpio_dev() 64 const struct gpio_npcx_config *const config = dev->config; in npcx_gpio_enable_io_pads() 65 const struct npcx_wui *io_wui = &config->wui_maps[pin]; in npcx_gpio_enable_io_pads() [all …]
|
D | gpio_stm32.h | 2 * Copyright (c) 2016 Open-RnD Sp. z o.o. 4 * SPDX-License-Identifier: Apache-2.0 17 #include <zephyr/dt-bindings/pinctrl/stm32f1-pinctrl.h> 19 #include <zephyr/dt-bindings/pinctrl/stm32-pinctrl.h> 235 unsigned int out_state; /* 1 (high level) or 0 (low level) */ 245 /* port base address */ 247 /* IO port */ 248 int port; member 269 * @param dev GPIO port device pointer 270 * @param pin IO pin
|
D | gpio_dw.c | 4 * SPDX-License-Identifier: Apache-2.0 13 #include <zephyr/dt-bindings/gpio/snps-designware-gpio.h> 29 static int gpio_dw_port_set_bits_raw(const struct device *port, uint32_t mask); 30 static int gpio_dw_port_clear_bits_raw(const struct device *port, 34 * ARC architecture configure IP through IO auxiliary registers. 88 uint32_t port = (base_addr & 0x3f) / 12U; in dw_derive_port_from_base() local 89 return port; in dw_derive_port_from_base() 94 return ((int)(config->irq_num) > 0U); in dw_interrupt_support() 101 /* 4-port GPIO implementation translates from base address to port */ in dw_get_ext_port() 125 /* 4-port GPIO implementation translates from base address to port */ in dw_get_data_port() [all …]
|
D | gpio_pcf857x.c | 4 * 2023 Amrith Venkat Kesavamoorthi <amrith@mr-beam.org> 7 * SPDX-License-Identifier: Apache-2.0 9 * @see https://www.nxp.com/docs/en/data-sheet/PCF8575.pdf 10 * @see https://www.nxp.com/docs/en/data-sheet/PCF8574_PCF8574A.pdf 64 const struct pcf857x_drv_cfg *drv_cfg = dev->config; in pcf857x_process_input() 65 struct pcf857x_drv_data *drv_data = dev->data; in pcf857x_process_input() 69 rc = i2c_read_dt(&drv_cfg->i2c, rx_buf, drv_data->num_bytes); in pcf857x_process_input() 71 LOG_ERR("%s: failed to read from device: %d", dev->name, rc); in pcf857x_process_input() 72 return -EIO; in pcf857x_process_input() 76 *value = sys_get_le16(rx_buf); /*format P17-P10..P07-P00 (bit15-bit8..bit7-bit0)*/ in pcf857x_process_input() [all …]
|
D | gpio_esp32.c | 5 * SPDX-License-Identifier: Apache-2.0 10 /* Include esp-idf headers first to avoid redefining BIT() macro */ 22 #include <zephyr/dt-bindings/gpio/espressif-esp32-gpio.h> 65 #define CPU_ID() arch_curr_cpu()->id 110 const struct gpio_esp32_config *const cfg = dev->config; in gpio_esp32_config() 111 uint32_t io_pin = (uint32_t) pin + ((cfg->gpio_port == 1 && pin < 32) ? 32 : 0); in gpio_esp32_config() 116 LOG_ERR("Selected IO pin is not valid."); in gpio_esp32_config() 117 return -EINVAL; in gpio_esp32_config() 130 ret = -EINVAL; in gpio_esp32_config() 147 ret = -ENOTSUP; in gpio_esp32_config() [all …]
|
/Zephyr-latest/dts/bindings/tcpc/ |
D | nuvoton,numaker-tcpc.yaml | 2 # SPDX-License-Identifier: Apache-2.0 4 description: Nuvoton NuMaker USB Type-C port controller 6 compatible: "nuvoton,numaker-tcpc" 8 include: [base.yaml, reset-device.yaml, pinctrl-device.yaml] 23 vconn-overcurrent-event-polarity: 28 - "low-active" 29 - "high-active" 31 vconn-discharge-polarity: 36 - "low-active" 37 - "high-active" [all …]
|
/Zephyr-latest/drivers/interrupt_controller/ |
D | intc_ioapic.c | 2 * Copyright (c) 1997-1998, 2000-2002, 2004, 2006-2008, 2011-2015 Wind River 5 * SPDX-License-Identifier: Apache-2.0 12 * @brief Intel IO APIC/xAPIC driver 14 * This module is a driver for the IO APIC/xAPIC (Advanced Programmable 16 * and P7 (Pentium4) family processors. The IO APIC/xAPIC is included 18 * may be required to enable the IO APIC/xAPIC in some chip sets. 19 * The 8259A interrupt controller is intended for use in a uni-processor 20 * system, IO APIC can be used in either a uni-processor or multi-processor 21 * system. The IO APIC handles interrupts very differently than the 8259A. 23 * - Method of Interrupt Transmission. The IO APIC transmits interrupts [all …]
|
/Zephyr-latest/boards/blues/swan_r5/doc/ |
D | index.rst | 6 Swan is a low-cost embeddable STM32L4-based microcontroller designed to 7 accelerate the development and deployment of battery-powered solutions. 12 Uniquely for Feather-compatible boards, Swan is designed to satisfy 13 developers' needs that span from early prototyping through high-volume 15 Adafruit's myriad sensors and FeatherWing-compatible carriers. 16 Due to its novel design, for high-volume deployment the low-cost Swan 20 The board has three independent power options---USB, Battery, or Line 21 power---and provides a software-switchable 2 Amp regulator for powering external 22 sensors. When operating in its low-power operating mode, the entire Swan 24 making it quite suitable for battery-powered devices. [all …]
|
/Zephyr-latest/soc/nordic/nrf54h/bicr/ |
D | bicr-schema.json | 14 "VDDH supplied with 2.1-5.5 V and VDD regulated by the chip (inductor present)", 31 "title": "IO port power configuration", 121 "title": "IO port impedance configuration", 155 "title": "Low Frequency Oscillator (LFOSC) configuration", 161 "Low Frequency Crystal Oscillator (LFXO)", 162 "Low Frequency RC Oscillator (LFRC)" 184 "title": "Low Frequency Crystal Oscillator (LFXO) configuration", 240 "title": "Use built-in load capacitors", 257 "title": "Built-in load capacitance", 285 "title": "Low Frequency RC (LFRC) autocalibration configuration", [all …]
|
/Zephyr-latest/dts/bindings/pinctrl/ |
D | nuvoton,npcx-pinctrl.yaml | 2 # SPDX-License-Identifier: Apache-2.0 10 - bias-pull-down: Enable pull-down resistor. 11 - bias-pull-up: Enable pull-up resistor. 12 - drive-open-drain: Output driver is open-drain. 15 - pinmux-locked: Lock pinmux configuration for peripheral device 16 - pinmux-gpio: Inverse pinmux back to gpio 17 - psl-in-mode: Select the assertion detection mode of PSL input 18 - psl-in-pol: Select the assertion detection polarity of PSL input 23 #include <nuvoton/npcx/npcx7/npcx7-pinctrl.dtsi> 25 We want to use the I2C0_0 port of the NPCX7M6FB controller and enable the [all …]
|
/Zephyr-latest/soc/nuvoton/npcx/common/ |
D | soc_miwu.h | 4 * SPDX-License-Identifier: Apache-2.0 48 NPCX_MIWU_TRIG_LOW, /** Edge failing or active low detection */ 60 * @brief NPCX wake-up input source structure 62 * Used to indicate a Wake-Up Input source (WUI) belongs to which group and bit 63 * of Multi-Input Wake-Up Unit (MIWU) modules. 72 * Define npcx miwu driver callback handler signature for wake-up input source 90 struct npcx_wui wui; /** Wake-up input source of GPIO */ 104 const struct device *source; /** Wake-up input source */ 117 /** Node of single-linked list */ 135 * @brief Enable interrupt of the wake-up input source [all …]
|
/Zephyr-latest/boards/norik/octopus_io_board/doc/ |
D | index.rst | 6 Octopus IO-Board is an expansion to the Octopus SoM, which is built around the nRF9160 SiP 7 offering NB-IoT and LTE-M connectivity, GPS and accelerometer. Octopus IO-Board expands 9 development and prototyping of low-power IoT applications. 11 nRF9160 SiP contains ARM Cortex-M33 application processor and the 18 * :abbr:`I2C (Inter-Integrated Circuit)` 25 * :abbr:`UARTE (Universal asynchronous receiver-transmitter with EasyDMA)` 29 Octopus IO-Board offers the following features: 32 * USB-C for power 41 * Tag-Connect TC2030-IDC 6-pin connector for SWD programming and debugging 44 More information about the board can be found at the `Octopus IO-Board Product Page`_ [all …]
|
/Zephyr-latest/boards/vngiotlab/nrf51_vbluno51/doc/ |
D | index.rst | 7 a VNG Bluetooth Low Energy UNO using an nRF51822 ARM processor. 28 - CPU: 30 + *Bluetooth Low Energy interface.* 35 + GPIO Voltage: 0 - 3.3V. 36 - DAPLink (CMSIS-DAP) interface for program and debug: 38 + USB HID (DAP): CMSIS-DAP compliant debug channel. 39 + USB CDC: Virtual COM port for log, trace and terminal emulation. 41 - Supports hardware flow control features (RTS/CTS). 42 - *Energy monitoring for BLE module by current measurement (Only VBLUno51_EM)* 43 - FOTA (Firmware over the air): Upgrade firmware over BLE interface. [all …]
|
/Zephyr-latest/boards/wemos/esp32s2_lolin_mini/doc/ |
D | index.rst | 6 ESP32-S2 is a highly integrated, low-power, single-core Wi-Fi Microcontroller SoC, designed to be s… 7 cost-effective, with a high performance and a rich set of IO capabilities. [1]_ 11 - RSA-3072-based secure boot 12 - AES-XTS-256-based flash encryption 13 - Protected private key and device secrets from software access 14 - Cryptographic accelerators for enhanced performance 15 - Protection against physical fault injection attacks 16 - Various peripherals: 18 - 43x programmable GPIOs 19 - 14x configurable capacitive touch GPIOs [all …]
|
/Zephyr-latest/boards/particle/xenon/doc/ |
D | index.rst | 6 The Particle Xenon is a low-cost mesh-enabled development board based on the 14 ARM |reg| Cortex |reg|-M4F SoC with an integrated 2.4 GHz transceiver supporting 15 Bluetooth |reg| Low Energy and IEEE |reg| 802.15.4. 19 - `Xenon Datasheet`_ 20 - `Xenon Hardware Files`_ 25 On the front of the board are RGB-LED, LED and LIPO circuitry. 26 The RGB-LED is controlled by the nRF52840 via GPIO pins. 31 The board is optimized for low power applications and supports two 34 It contains circuitry for LIPO usage and can be charged via the USB port. 42 +-----------+------------+----------------------+ [all …]
|
/Zephyr-latest/boards/particle/argon/doc/ |
D | index.rst | 6 The Particle Argon is a Wi-Fi enabled development board with a Nordic 7 Semiconductor nRF52840 for mesh support and an ESP32 for Wi-Fi. The 15 |reg| Cortex |reg|-M4F SoC with an integrated 2.4 GHz transceiver supporting 16 Bluetooth |reg| Low Energy and IEEE |reg| 802.15.4. 20 - `Argon Datasheet`_ 21 - `Argon Hardware Files`_ 26 On the front of the board are RGB-LED, LED and LIPO circuitry. 27 The RGB-LED is controlled by the nRF52840 via GPIO pins. 32 The board is optimized for low power applications and supports two 35 It contains circuitry for LIPO usage and can be charged via the USB port. [all …]
|
/Zephyr-latest/boards/particle/boron/doc/ |
D | index.rst | 6 The Particle Boron is a cellular-enabled development board with a 15 ARM |reg| Cortex |reg|-M4F SoC with an integrated 2.4 GHz transceiver supporting 16 Bluetooth |reg| Low Energy and IEEE |reg| 802.15.4. 20 - `Boron Datasheet`_ 21 - `Boron Hardware Files`_ 26 On the front of the board are RGB-LED, LED and LIPO circuitry. 27 The RGB-LED is controlled by the nRF52840 via GPIO pins. 32 The board is optimized for low power applications and supports two 35 It contains circuitry for LIPO usage and can be charged via the USB port. 43 +-----------+------------+----------------------+ [all …]
|
/Zephyr-latest/dts/arm/nxp/ |
D | nxp_kw2xd.dtsi | 1 /* SPDX-License-Identifier: Apache-2.0 */ 4 #include <arm/armv7-m.dtsi> 5 #include <zephyr/dt-bindings/adc/adc.h> 6 #include <zephyr/dt-bindings/clock/kinetis_sim.h> 7 #include <zephyr/dt-bindings/clock/kinetis_mcg.h> 8 #include <zephyr/dt-bindings/gpio/gpio.h> 9 #include <zephyr/dt-bindings/i2c/i2c.h> 12 #include <nxp/kinetis/MKW24D512VHA5-pinctrl.h> 21 zephyr,flash-controller = &ftfl; 25 #address-cells = <1>; [all …]
|
D | nxp_mcxw71.dtsi | 2 * Copyright 2023-2024 NXP 4 * SPDX-License-Identifier: Apache-2.0 8 #include <arm/armv8-m.dtsi> 9 #include <zephyr/dt-bindings/clock/scg_k4.h> 10 #include <zephyr/dt-bindings/gpio/gpio.h> 11 #include <zephyr/dt-bindings/pwm/pwm.h> 12 #include <zephyr/dt-bindings/i2c/i2c.h> 13 #include <zephyr/dt-bindings/memory-attr/memory-attr-arm.h> 21 zephyr,bt-hci = &hci; 26 #address-cells = <1>; [all …]
|
/Zephyr-latest/scripts/utils/ |
D | pinctrl_nrf_migrate.py | 4 # SPDX-License-Identifier: Apache-2.0 11 nRF-based boards using the old <signal>-pin properties to select peripheral 13 file by removing old pin-related properties replacing them with pinctrl states. 14 A board-pinctrl.dtsi file will be generated containing the configuration for 28 -i path/to/board.dts 29 [--no-backup] 30 [--skip-nrf-check] 31 [--header ""] 35 .. code-block:: devicetree 41 tx-pin = <5>; [all …]
|
/Zephyr-latest/boards/nxp/rddrone_fmuk66/doc/ |
D | index.rst | 9 - Comes with a J-Link Edu Mini for programming and UART console. 14 - MK66FN2MOVLQ18 MCU (180 MHz, 2 MB flash memory, 256 KB RAM, low-power, 15 crystal-less USB, and 144 Low profile Quad Flat Package (LQFP)) 16 - Dual role USB interface with micro-B USB connector 17 - RGB LED 18 - FXOS8700CQ accelerometer and magnetometer 19 - FXAS21002CQ gyro 20 - BMM150 magnetometer 21 - ML3114A2 barometer 22 - BMP280 barometer [all …]
|
/Zephyr-latest/dts/arm/nuvoton/npcx/ |
D | npcx4.dtsi | 4 * 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/dp/ |
D | swdp_bitbang.c | 2 * Copyright (c) 2018-2019 PHYTEC Messtechnik GmbH 5 * SPDX-License-Identifier: Apache-2.0 9 * This file is based on SW_DP.c from CMSIS-DAP Source (Revision: V2.0.0) 10 * https://github.com/ARM-software/CMSIS_5/tree/develop/CMSIS/DAP/Firmware 11 * Copyright (c) 2013-2017, ARM Limited, All Rights Reserved 12 * SPDX-License-Identifier: Apache-2.0 16 /* Serial Wire Debug Port interface bit-bang driver */ 69 * - CMSIS-DAP Command Specification, DAP_Transfer 70 * - ARM Debug Interface v5 Architecture Specification 91 const struct sw_config *config = dev->config; in pin_swclk_set() [all …]
|
/Zephyr-latest/drivers/serial/ |
D | uart_ns16550.c | 1 /* ns16550.c - NS16550D serial driver */ 6 * Copyright (c) 2010, 2012-2015 Wind River Systems, Inc. 7 * Copyright (c) 2020-2023 Intel Corp. 9 * SPDX-License-Identifier: Apache-2.0 18 * Before individual UART port can be used, uart_ns16550_port_init() has to be 19 * called to setup the port. 72 /* If any node has property io-mapped set, we need to support IO port 76 * as io-mapped property is considered always exists and present, 78 * resort to the follow helper to see if any okay nodes have io-mapped 164 * RXRDY pin (29) will be low active. Once it is activated the [all …]
|