Home
last modified time | relevance | path

Searched +full:out +full:- +full:active +full:- +full:low (Results 1 – 25 of 134) sorted by relevance

123456

/Zephyr-latest/tests/drivers/gpio/gpio_basic_api/src/
Dtest_gpio_port.c5 * SPDX-License-Identifier: Apache-2.0
10 #define ALL_BITS ((gpio_port_value_t)-1)
15 /* Short-hand for a checked read of PIN_IN raw state */
30 /* Short-hand for a checked read of PIN_IN logical state */
45 /* Short-hand for a checked write of PIN_OUT raw state */
59 /* Short-hand for a checked write of PIN_OUT logic state */
73 /* Verify device, configure for physical in and out, verify
81 TC_PRINT("Validate device %s and %s\n", dev_in->name, dev_out->name); in setup()
84 TC_PRINT("Check %s output %d connected to %s input %d\n", dev_out->name, PIN_OUT, in setup()
85 dev_in->name, PIN_IN); in setup()
[all …]
Dtest_callback_trigger.c5 * SPDX-License-Identifier: Apache-2.0
26 && (dd->mode == GPIO_INT_EDGE_BOTH)) { in callback()
65 drv_data->mode = mode; in test_callback()
66 gpio_init_callback(&drv_data->gpio_cb, callback, BIT(PIN_IN)); in test_callback()
67 rc = gpio_add_callback(dev_in, &drv_data->gpio_cb); in test_callback()
68 if (rc == -ENOTSUP) { in test_callback()
79 if (rc == -ENOTSUP) { in test_callback()
92 TC_PRINT("OUT init %x, IN cfg %x, cnt %d\n", out_flags, mode, cb_cnt); in test_callback()
114 gpio_remove_callback(dev_in, &drv_data->gpio_cb); in test_callback()
118 gpio_remove_callback(dev_in, &drv_data->gpio_cb); in test_callback()
[all …]
/Zephyr-latest/dts/bindings/led_strip/
Dworldsemi,ws2812-i2s.yaml2 # SPDX-License-Identifier: Apache-2.0
10 compatible: "worldsemi,ws2812-i2s"
12 include: [i2s-device.yaml, ws2812.yaml]
16 out-active-low:
18 description: True if the output pin is active low.
20 nibble-one:
23 description: 4-bit value to shift out for a 1 pulse.
25 nibble-zero:
28 description: 4-bit value to shift out for a 0 pulse.
30 lrck-period:
[all …]
/Zephyr-latest/dts/bindings/gpio/
Dsemtech,sx1509b.yaml2 # SPDX-License-Identifier: Apache-2.0
8 include: [i2c-device.yaml, gpio-controller.yaml]
11 "#gpio-cells":
18 nint-gpios:
19 type: phandle-array
21 Connection for the NINT signal. This signal is active-low when
24 init-out-low:
29 driven low.
31 init-out-high:
38 gpio-cells:
[all …]
/Zephyr-latest/dts/bindings/sensor/
Dams,tmd2620.yaml2 # SPDX-License-Identifier: Apache-2.0
8 include: [sensor-device.yaml, i2c-device.yaml]
11 int-gpios:
12 type: phandle-array
15 The interrupt pin of TMD2620 is open-drain, active low.
17 as pull-up, active low.
19 proximity-gain:
24 - 1
25 - 2
26 - 4
[all …]
/Zephyr-latest/dts/bindings/w1/
Dadi,max32-w1.yaml1 # Copyright (c) 2023-2024 Analog Devices, Inc.
2 # SPDX-License-Identifier: Apache-2.0
4 description: ADI MAX32xxx MCUs 1-Wire Master
6 include: [w1-master.yaml, pinctrl-device.yaml]
8 compatible: "adi,max32-w1"
20 pinctrl-0:
23 pinctrl-names:
26 internal-pullup:
32 0 - Internal pullup disabled.
33 1 - Internal pullup enabled.
[all …]
/Zephyr-latest/tests/drivers/gpio/gpio_api_1pin/src/
Dtest_pin_interrupt.c4 * SPDX-License-Identifier: Apache-2.0
61 TC_PRINT("Running test on port=%s, pin=%d\n", port->name, TEST_PIN); in test_gpio_pin_interrupt_edge()
64 if (ret == -ENOTSUP) { in test_gpio_pin_interrupt_edge()
65 TC_PRINT("Simultaneous pin in/out mode is not supported.\n"); in test_gpio_pin_interrupt_edge()
87 if (ret == -ENOTSUP) { in test_gpio_pin_interrupt_edge()
101 "number of times on rising/to active edge", i); in test_gpio_pin_interrupt_edge()
135 TC_PRINT("Running test on port=%s, pin=%d\n", port->name, TEST_PIN); in test_gpio_pin_interrupt_level()
138 if (ret == -ENOTSUP) { in test_gpio_pin_interrupt_level()
139 TC_PRINT("Simultaneous pin in/out mode is not supported.\n"); in test_gpio_pin_interrupt_level()
167 if (ret == -ENOTSUP) { in test_gpio_pin_interrupt_level()
[all …]
Dtest_pin.c4 * SPDX-License-Identifier: Apache-2.0
57 * - Verify that gpio_pin_toggle function changes pin state from active to
69 TC_PRINT("Running test on port=%s, pin=%d\n", port->name, TEST_PIN); in ZTEST()
72 if (ret == -ENOTSUP) { in ZTEST()
73 TC_PRINT("Simultaneous pin in/out mode is not supported.\n"); in ZTEST()
95 * correctly set pin active state via GPIO_ACTIVE_LOW/_HIGH flags.
99 * - Verify visually that gpio_pin_toggle function changes pin state from active
111 TC_PRINT("Running test on port=%s, pin=%d\n", port->name, TEST_PIN); in ZTEST()
134 * - Verify that gpio_pin_get_raw reads the same value as set by
144 4, 1, 45, 0, 0, -7, 0, 0, 0, INT_MAX, INT_MIN, 0 in ZTEST()
[all …]
/Zephyr-latest/samples/drivers/led/led_strip/boards/
Dthingy52_nrf52832.overlay1 #include <zephyr/dt-bindings/led/led.h>
4 * - M1.S connected to GND
5 * - SDOUT connected to M1.D
6 * - ~300 ohm resistor between M1.D and TP5 (5V / Vbus)
22 pinctrl-0 = <&i2s0_default_alt>;
23 pinctrl-names = "default";
26 compatible = "worldsemi,ws2812-i2s";
29 chain-length = <10>; /* arbitrary; change at will */
30 color-mapping = <LED_COLOR_ID_GREEN
33 out-active-low;
[all …]
/Zephyr-latest/subsys/net/l2/ieee802154/
DKconfig2 # SPDX-License-Identifier: Apache-2.0
8 Add support for low rate WPAN IEEE 802.15.4 technology.
18 module-dep = NET_LOG
19 module-str = Log level for IEEE 802.15.4
20 module-help = Enables IEEE 802.15.4 code to output debug messages.
27 Enable printing out in/out 802.15.4 packets. This is extremely
31 prompt "Which packet do you want to print-out?"
36 bool "Print-out both RX and TX packets"
38 This will print-out both received and transmitted packets.
41 bool "Print-out only RX packets"
[all …]
/Zephyr-latest/drivers/usb/common/nrf_usbd_common/
Dnrf_usbd_common.h2 * Copyright (c) 2016 - 2023, Nordic Semiconductor ASA
4 * SPDX-License-Identifier: Apache-2.0
36 * This number would be shared between IN and OUT endpoint.
61 * @brief Create identifier for OUT endpoint.
63 * Simple macro to create OUT endpoint identifier for given endpoint number.
79 NRF_USBD_COMMON_EPOUT0 = 0x00, /**< Endpoint OUT 0 */
80 NRF_USBD_COMMON_EPOUT1 = 0x01, /**< Endpoint OUT 1 */
81 NRF_USBD_COMMON_EPOUT2 = 0x02, /**< Endpoint OUT 2 */
82 NRF_USBD_COMMON_EPOUT3 = 0x03, /**< Endpoint OUT 3 */
83 NRF_USBD_COMMON_EPOUT4 = 0x04, /**< Endpoint OUT 4 */
[all …]
/Zephyr-latest/tests/drivers/uart/uart_pm/src/
Dmain.c4 * SPDX-License-Identifier: Apache-2.0
15 static void polling_verify(const struct device *dev, bool is_async, bool active) in polling_verify() argument
33 zassert_equal(err, -1); in polling_verify()
42 if (active) { in polling_verify()
49 zassert_equal(err, -1); in polling_verify()
57 switch (evt->type) { in async_callback()
66 static bool async_verify(const struct device *dev, bool active) in async_verify() argument
74 if (err == -ENOTSUP) { in async_verify()
78 if (!active) { in async_verify()
102 zassert_true((err == 0) || (err == -EFAULT)); in async_verify()
[all …]
/Zephyr-latest/tests/lib/p4workq/src/
Dmain.c4 * SPDX-License-Identifier: Apache-2.0
25 bool active; member
43 item->item.priority = sys_rand32_get() % (K_LOWEST_THREAD_PRIO - 1); in stress_sub()
44 item->item.deadline = sys_rand32_get() % k_ms_to_cyc_ceil32(2); in stress_sub()
45 item->item.handler = stress_handler; in stress_sub()
46 item->running = false; in stress_sub()
47 item->active = true; in stress_sub()
49 k_p4wq_submit(&wq, &item->item); in stress_sub()
57 titem->running = true; in stress_handler()
61 zassert_true(curr_pri == item->priority, in stress_handler()
[all …]
/Zephyr-latest/samples/shields/npm6001_ek/doc/
Dindex.rst1 .. zephyr:code-sample:: npm6001_ek
13 - Regulators (BUCK0/1/2/3 and LDO0/1)
14 - GPIO
15 - Watchdog
24 :alt: nRF52840DK + nPM6001-EK wiring example
27 nRF52840DK + nPM6001-EK wiring example
35 .. zephyr-app-commands::
36 :zephyr-app: samples/shields/npm6001_ek
52 .. code-block:: bash
63 .. code-block:: bash
[all …]
/Zephyr-latest/drivers/fpga/
Dfpga_ice40_bitbang.c5 * SPDX-License-Identifier: Apache-2.0
25 * CS polarity is normal (active low). Zephyr's SPI driver model currently
30 * restore the default pinctrl settings. On some higher-end microcontrollers
34 * However, on lower-end microcontrollers, the amount of time that elapses
36 * leaves us with the bitbanging option. Of course, on lower-end
40 * in order to bitbang on lower-end microcontrollers, we actually require
61 * lattice,ice40-fpga.yaml for details.
65 for (; n > 0; --n) { in fpga_ice40_delay()
73 for (; n > 0; --n) { in fpga_ice40_send_clocks()
88 /* assert chip-select (active low) */ in fpga_ice40_spi_send_data()
[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 …]
Dreset.h2 * Copyright (c) 2022 Andrei-Edward Popa <andrei.popa105@yahoo.com>
4 * SPDX-License-Identifier: Apache-2.0
186 * API template to take out the device from reset state.
221 * @retval -ENOSYS If the functionality is not implemented by the driver.
222 * @retval -errno Other negative errno in case of failure.
228 const struct reset_driver_api *api = (const struct reset_driver_api *)dev->api; in z_impl_reset_status()
230 if (api->status == NULL) { in z_impl_reset_status()
231 return -ENOSYS; in z_impl_reset_status()
234 return api->status(dev, id, status); in z_impl_reset_status()
242 * reset_status(spec->dev, spec->id, status);
[all …]
Dgpio.h2 * Copyright (c) 2019-2020 Nordic Semiconductor ASA
5 * Copyright (c) 2015-2016 Intel Corporation.
7 * SPDX-License-Identifier: Apache-2.0
27 #include <zephyr/dt-bindings/gpio/gpio.h>
58 /* Initializes output to a low state. */
69 /** Configures GPIO pin as output and initializes it to a low state. */
89 * flag. If a pin was configured as Active Low, physical level low will be
90 * considered as logical level 1 (an active state), physical level high will
124 /* Trigger detection when input state is (or transitions to) physical low or
180 /** Configures GPIO interrupt to be triggered on pin physical level low and
[all …]
/Zephyr-latest/boards/nordic/thingy52/
Dthingy52_nrf52832.dts6 * SPDX-License-Identifier: Apache-2.0
9 /dts-v1/;
11 #include "thingy52_nrf52832-pinctrl.dtsi"
12 #include <zephyr/dt-bindings/input/input-event-codes.h>
16 compatible = "nordic,thingy52-nrf52832";
20 zephyr,shell-uart = &uart0;
21 zephyr,bt-mon-uart = &uart0;
22 zephyr,bt-c2h-uart = &uart0;
25 zephyr,code-partition = &slot0_partition;
39 compatible = "gpio-leds";
[all …]
/Zephyr-latest/dts/bindings/pinctrl/
Dsilabs,dbus-pinctrl.yaml2 # SPDX-License-Identifier: Apache-2.0
7 node to route USART0 RX to pin PA1 and enable the pull-up resistor on the
15 compatible = "silabs,gecko-usart";
16 pinctrl-0 = <&usart0_default>;
17 pinctrl-names = "default";
20 pinctrl-0 is a phandle that stores the pin settings for the peripheral, in
22 'pinctrl' node, typically in a board-pinctrl.dtsi file in the board
32 /* Configure GPIO to push-pull mode */
33 drive-push-pull;
35 output-high;
[all …]
/Zephyr-latest/boards/ezurio/bl5340_dvk/doc/
Dindex.rst6 BL5340 module which is powered by a dual-core Nordic Semiconductor
7 nRF5340 ARM Cortex-M33F CPU. The nRF5340 inside the BL5340 module is a
8 dual-core SoC based on the Arm® Cortex®-M33 architecture, with:
10 * a full-featured Arm Cortex-M33F core with DSP instructions, FPU, and
11 Armv8-M Security Extension, running at up to 128 MHz, referred to as
13 * a secondary Arm Cortex-M33 core, with a reduced feature set, running
20 non-secure partition of the application core on the BL5340 module.
29 * :abbr:`I2C (Inter-Integrated Circuit)`
30 * :abbr:`I2S (Inter-Integrated Sound)`
35 * RADIO (Bluetooth Low Energy and 802.15.4)
[all …]
/Zephyr-latest/drivers/spi/
Dspi_numaker.c2 * SPDX-License-Identifier: Apache-2.0
42 * CPOL/CPHA = 0/0 --> SPI_MODE_0
43 * CPOL/CPHA = 0/1 --> SPI_MODE_1
44 * CPOL/CPHA = 1/0 --> SPI_MODE_2
45 * CPOL/CPHA = 1/1 --> SPI_MODE_3
58 struct spi_numaker_data *data = dev->data; in spi_numaker_configure()
59 const struct spi_numaker_config *dev_cfg = dev->config; in spi_numaker_configure()
62 if (spi_context_configured(&data->ctx, config)) { in spi_numaker_configure()
66 if (SPI_MODE_GET(config->operation) & SPI_MODE_LOOP) { in spi_numaker_configure()
68 return -ENOTSUP; in spi_numaker_configure()
[all …]
Dspi_nxp_s32.c2 * Copyright 2022-2024 NXP
4 * SPDX-License-Identifier: Apache-2.0
15 struct spi_context *ctx = &data->ctx; in spi_nxp_s32_last_packet()
17 if (ctx->tx_count <= 1U && ctx->rx_count <= 1U) { in spi_nxp_s32_last_packet()
18 if (!spi_context_tx_on(ctx) && (data->transfer_len == ctx->rx_len)) { in spi_nxp_s32_last_packet()
22 if (!spi_context_rx_on(ctx) && (data->transfer_len == ctx->tx_len)) { in spi_nxp_s32_last_packet()
26 if ((ctx->rx_len == ctx->tx_len) && (data->transfer_len == ctx->tx_len)) { in spi_nxp_s32_last_packet()
41 const struct spi_nxp_s32_config *config = dev->config; in spi_nxp_s32_transfer_next_packet()
42 struct spi_nxp_s32_data *data = dev->data; in spi_nxp_s32_transfer_next_packet()
49 data_cb = config->cb; in spi_nxp_s32_transfer_next_packet()
[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/pm/
Dpm.c4 * SPDX-License-Identifier: Apache-2.0
59 callback = notifier->state_entry; in pm_state_notify()
61 callback = notifier->state_exit; in pm_state_notify()
65 callback(z_cpus_pm_state[_current_cpu->id].state); in pm_state_notify()
76 * Its maximum value is K_TICKS_FOREVER ((uint32_t)-1) which is -1 in ticks_expiring_sooner()
78 * We need to find out which one is the closest in ticks_expiring_sooner()
81 __ASSERT(ticks1 >= -1, "ticks1 has unexpected negative value"); in ticks_expiring_sooner()
82 __ASSERT(ticks2 >= -1, "ticks2 has unexpected negative value"); in ticks_expiring_sooner()
96 uint8_t id = _current_cpu->id; in pm_system_resume()
102 * Some CPU low power states require enabling of interrupts in pm_system_resume()
[all …]

123456