►Nriot | |
►Ndetail | |
Cil_indices | Creates indices from Pos to Max |
Cil_indices< Max, Pos, int_list< Is... > > | Recursion step |
Cil_indices< Pos, Pos, int_list< Is... > > | End of recursion, Pos reached Max |
Cint_list | A list of integers (wraps a long.. |
Cadopt_lock_t | Tag type for adopt lock strategy |
Ccondition_variable | C++11 compliant implementation of condition variable, uses the time point implemented in our chrono replacement instead of the specified one |
Cdefer_lock_t | Tag type for defer lock strategy |
Clock_guard | C++11 compliant implementation of unique lock |
Cmutex | C++11 compliant implementation of mutex, uses the time point implemented in our chrono replacement instead of the specified one |
Cthread | C++11 compliant implementation of thread, however uses the time point from out chrono header instead of the specified one |
Cthread_data | Holds context data for the thread |
Cthread_data_deleter | This deleter prevents our thread data from being destroyed if the thread object is destroyed before the thread had a chance to run |
Cthread_id | Implementation of thread::id |
Ctime_point | A time point for timed wait, as clocks from the standard are not available on RIOT |
Ctry_to_lock_t | Tag type for try lock strategy |
Cunique_lock | C++11 compliant implementation of unique lock |
C__pthread_cleanup_datum | Internal structure for pthread_cleanup_push() |
C__pthread_rwlock_waiter_node_t | Internal structure that stores one waiting thread |
C_adc_hw_t | ADC pin hardware information type (for internal use only) |
C_gnrc_tcp_common_tcb_list_t | TCB list type |
C_nib_abr_entry_t | Internal NIB-representation of the authoritative border router for multihop prefix and 6LoWPAN context dissemination |
C_nib_dr_entry_t | Default route NIB entry |
C_nib_offl_entry_t | Off-link NIB entry |
C_nib_onl_entry | On-link NIB entry |
C_sock_tl_ep | Common IP-based transport layer end point |
C_thread | thread_t holds thread's context data |
C_transmission_control_block | Transmission control block of GNRC TCP |
Cad7746 | AD7746 device descriptor |
Cad7746_params | AD7746 params |
Cadc_chan_conf_t | ADC channel configuration |
Cadc_conf_chan_t | ADC Channel Configuration |
Cadc_conf_t | ADC device configuration |
Cadcxx1c | ADCxx1C device descriptor |
Cadcxx1c_params | ADCxx1C params |
Cadi_3_refsys_regs_m4_t | ADI_3_REFSYS registers |
Cadi_3_refsys_regs_t | ADI_3_REFSYS registers |
Cadi_4_aux_regs_m8_t | ADI_4_AUX registers using masked 8-bit access |
Cadi_4_aux_regs_t | ADI_4_AUX registers |
Cads101x | ADS101x/111x device descriptor |
Cads101x_alert | ADS101x/111x alert device descriptor |
Cads101x_alert_params | ADS101x/111x alert params |
Cads101x_params | ADS101x/111x params |
Cadt7310_t | Device descriptor for ADT7310 sensors |
Cadxl345_data_t | ADXL345 result vector struct |
Cadxl345_interrupt_t | Interrupt configuration struct for the ADXL345 sensor |
Cadxl345_params_t | Configuration struct for the ADXL345 sensor |
Cadxl345_t | Device descriptor for the ADXL345 sensor |
Caes_context_t | Cipher_context_t-struct adapted for AES |
Caes_key_st | AES key |
Caip31068_params_t | AIP31068 device initialization parameters |
Caip31068_t | AIP31068 PWM device data structure type |
Caon_ioc_regs_t | AON_IOC registers |
Caon_pmctl_regs_t | AON_PMCTL registers |
Caon_rtc_regs_t | AON_RTC registers |
Caon_sysctl_regs_t | AON_SYSCTL registers |
Caon_wuc_regs_t | AON_WUC registers |
Capa102_params_t | Configuration parameters for (chained) APA102 LEDs |
Capds99xx_int_config_t | Interrupt configuration |
Capds99xx_int_source_t | Interrupt source |
Capds99xx_params_t | APDS99XX device initialization parameters |
Capds99xx_rgb_t | RGB count value data structure (APDS9950 and APDS9960 only) |
Capds99xx_t | APDS99XX sensor device data structure type |
Casymcute_con | Asymcute connection context |
Casymcute_req | Asymcute request context |
Casymcute_sub | Data-structure holding the state of subscriptions |
Casymcute_topic | Data-structure for holding topics and their registration status |
Casymcute_will | Data structure for defining a last will |
Casync_read_t | Interrupt callback information structure |
Cat24cxxx_params | Struct that holds initialization parameters |
Cat24cxxx_t | Struct that represents an AT24CXXX device |
Cat24mac_params_t | Struct holding all params needed for device communication |
Cat25xxx_params_t | Struct holding all params needed for device initialization |
Cat25xxx_t | Struct that represents an AT25XXX device |
Cat30tse75x_t | Device descriptor for a AT30TSE75x device |
Cat86rf215 | Device descriptor for AT86RF215 radio devices |
Cat86rf215_BBC_regs | Base Band Controller registers |
Cat86rf215_params | Struct holding all params needed for device initialization |
Cat86rf215_RF_regs | Radio Frontend registers |
Cat86rf2xx_params | Struct holding all params needed for device initialization |
Cat86rf2xx_t | Device descriptor for AT86RF2XX radio devices |
Cat_dev_t | AT device structure |
Cat_urc_t | Unsolicited result code data structure |
Cata8520e_params_t | Initialization parameters |
Cata8520e_t | Device descriptor |
Catomic_bit_u16_t | Type specifying a bit in an uint16_t |
Catomic_bit_u32_t | Type specifying a bit in an uint32_t |
Catomic_bit_u64_t | Type specifying a bit in an uint64_t |
Catomic_bit_u8_t | Type specifying a bit in an uint8_t |
Catomic_bool | Type with the same alignment and size as atomic_bool |
Catomic_char | Type with the same alignment and size as atomic_char |
Catomic_int | Type with the same alignment and size as atomic_int |
Catomic_int_fast16_t | Type with the same alignment and size as atomic_int_fast16_t |
Catomic_int_fast32_t | Type with the same alignment and size as atomic_int_fast32_t |
Catomic_int_fast64_t | Type with the same alignment and size as atomic_int_fast64_t |
Catomic_int_fast8_t | Type with the same alignment and size as atomic_int_fast8_t |
Catomic_int_least16_t | Type with the same alignment and size as atomic_int_least16_t |
Catomic_int_least32_t | Type with the same alignment and size as atomic_int_least32_t |
Catomic_int_least64_t | Type with the same alignment and size as atomic_int_least64_t |
Catomic_int_least8_t | Type with the same alignment and size as atomic_int_least8_t |
Catomic_intmax_t | Type with the same alignment and size as atomic_intmax_t |
Catomic_intptr_t | Type with the same alignment and size as atomic_intptr_t |
Catomic_llong | Type with the same alignment and size as atomic_llong |
Catomic_long | Type with the same alignment and size as atomic_long |
Catomic_schar | Type with the same alignment and size as atomic_schar |
Catomic_short | Type with the same alignment and size as atomic_short |
Catomic_size_t | Type with the same alignment and size as atomic_size_t |
Catomic_uchar | Type with the same alignment and size as atomic_uchar |
Catomic_uint | Type with the same alignment and size as atomic_uint |
Catomic_uint_fast16_t | Type with the same alignment and size as atomic_uint_fast16_t |
Catomic_uint_fast32_t | Type with the same alignment and size as atomic_uint_fast32_t |
Catomic_uint_fast64_t | Type with the same alignment and size as atomic_uint_fast64_t |
Catomic_uint_fast8_t | Type with the same alignment and size as atomic_uint_fast8_t |
Catomic_uint_least16_t | Type with the same alignment and size as atomic_uint_least16_t |
Catomic_uint_least32_t | Type with the same alignment and size as atomic_uint_least32_t |
Catomic_uint_least64_t | Type with the same alignment and size as atomic_uint_least64_t |
Catomic_uint_least8_t | Type with the same alignment and size as atomic_uint_least8_t |
Catomic_uintmax_t | Type with the same alignment and size as atomic_uintmax_t |
Catomic_uintptr_t | Type with the same alignment and size as atomic_uintptr_t |
Catomic_ullong | Type with the same alignment and size as atomic_ullong |
Catomic_ulong | Type with the same alignment and size as atomic_ulong |
Catomic_ushort | Type with the same alignment and size as atomic_ushort |
Catwinc15x0 | ATWINC15x0 device descriptor type |
Catwinc15x0_params_t | ATWINC15x0 hardware and global parameters |
Caux_aiodio_regs_t | AUX_AIODIO registers |
Caux_anaif_regs_t | AUX_ANAIF registers |
Caux_evctl_regs_t | AUX_EVCTL registers |
Caux_evtcl_regs_t | AUX_EVCTL registers |
Caux_smph_regs_t | AUX_SMPH registers |
Caux_sysif_regs_t | AUX_SYSIF registers |
Caux_tdc_regs_t | AUX_TDC registers |
Caux_timer01_regs_t | AUX_TIMER01 registers |
Caux_timer2_regs_t | AUX_TIMER2 registers |
Caux_timer_regs_t | AUX_TIMER registers |
Caux_wuc_regs_t | AUX_WUC registers |
Cbe_uint16_t | A 16 bit integer in big endian aka network byte order |
Cbe_uint32_t | A 32 bit integer in big endian aka network byte order |
Cbe_uint64_t | A 64 bit integer in big endian aka network byte order |
Cbh1750fvi_params_t | Set of configuration parameters for BH1750FV devices |
Cbh1750fvi_t | Device descriptor for BH1570FVI devices |
Cbh1900nux_params_t | Set of configuration parameters for BH1900NUX devices |
Cbh1900nux_t | Device descriptor for BH1900NUX devices |
Cbloom_t | Bloom_t bloom filter object |
Cbluetil_ad_data_t | Struct used for returning the contents of a selected field |
Cbluetil_ad_t | Descriptor for a buffer containing advertising data |
Cbme680_field_data | BME680 sensor field data |
Cbme680_intf_i2c_t | BME680 I2C parameters |
Cbme680_intf_spi_t | BME680 SPI parameters |
Cbme680_intf_t | BME680 Hardware interface parameters union |
Cbme680_params_t | BME680 device initialization parameters |
Cbme680_t | BME680 device descriptor |
Cbmp180_calibration_t | Calibration struct for the BMP180 sensor |
Cbmp180_params_t | Device initialization parameters |
Cbmp180_t | Device descriptor for the BMP180 sensor |
Cbmx055_params_t | Data structure holding the device parameters needed for initialization |
Cbmx055_t | Device descriptor for BMX055 sensors |
Cbmx280_calibration_t | Calibration struct for the BMX280 sensor |
Cbmx280_params_t | Parameters for the BMX280 sensor |
Cbmx280_t | Device descriptor for the BMX280 sensor |
Cboot_t | Structure to hold boot partition |
Ccan | Low level device structure for ESP32 CAN (extension of candev_t) |
Ccan_bittiming | CAN bit-timing parameters |
Ccan_bittiming_const | CAN hardware-dependent bit-timing constant |
Ccan_conf_t | ESP CAN device configuration |
Ccan_filter | Controller Area Network filter |
Ccan_frame | Controller Area Network frame |
Ccan_opt_t | Structure to pass a CAN option |
Ccan_pkt_t | A CAN packet |
Ccan_reg_entry | Registry entry |
Ccan_rx_data | Received data structure |
Ccan_trx | Generic transceiver descriptor |
Ccandev | Structure to hold driver state |
Ccandev_conf | Linux candev configuration |
Ccandev_dev | Candev descriptor to pass to the device thread |
Ccandev_driver | Structure to hold driver interface -> function mapping |
Ccandev_linux | The candev_linux struct |
Ccandev_mcp2515 | MCP2515 device descriptor |
Ccandev_mcp2515_conf | MCP2515 configuration descriptor |
Ccandev_params | Parameters to initialize a candev |
Ccandev_stm32_isr | Internal interrupt flags |
Ccandev_stm32_rx_fifo | This structure holds anything related to the receive part |
Ccb_mux | Cb_mux list entry structure |
Ccc110x_chanmap_t | Structure to hold mapping between virtual and physical channel numbers |
Ccc110x_config_t | Configuration of the transceiver to use |
Ccc110x_framebuf_t | Buffer to temporary store incoming/outgoing packet |
Ccc110x_fs_calibration_t | Structure holding the calibration data of the frequency synthesizer |
Ccc110x_params_t | Structure holding all parameter for driver initialization |
Ccc110x_patable_t | Structure that holds the PATABLE, which allows to configure the 8 available output power levels using a magic number for each level |
Ccc110x_t | Device descriptor for CC1100/CC1101 transceivers |
Ccc1xxx_l2hdr_t | Layer 2 header used in CC1xxx frames |
Ccc1xxx_t | Users of the CC110x/CC1200 adaption layer have to overlap their device handle with this structure |
Ccc2420_params | Struct holding all parameters needed for device initialization |
Ccc2420_t | Device descriptor for CC2420 radio devices |
Ccc2538_gpio_t | GPIO port component registers |
Ccc2538_gptimer_t | GPTIMER component registers |
Ccc2538_ioc_t | IOC port component registers |
Ccc2538_rf_t | Device descriptor for CC2538 transceiver |
Ccc2538_rfcore_t | RF Core component registers |
Ccc2538_soc_adc_t | SOC ADC component registers |
Ccc2538_ssi_t | SSI component registers |
Ccc2538_sys_ctrl_t | System Control component registers |
Ccc2538_uart_t | UART component registers |
Ccc26x0_ioc_regs_t | Obtain IOCFG-register for a DIO |
Cccfg_regs_t | CCFG registers |
Cccs811_params_t | CCS811 device initialization parameters |
Cccs811_t | CCS811 sensor device data structure |
Cchacha20poly1305_ctx_t | Chacha20poly1305 state struct |
Cchacha_ctx | A ChaCha cipher stream context |
Cchip_info_struct | Alksd |
Ccib_t | Circular integer buffer structure |
Ccid_t | CID register see section 5.2 in SD-Spec v5.00 |
Ccipher_context_t | Context for cipher-operations |
Ccipher_interface_st | BlockCipher-Interface for the Cipher-Algorithms |
Ccipher_t | Basic struct for using block ciphers contains the cipher interface and the context |
Cclif_attr_t | Link format attribute descriptor |
Cclif_t | Link format descriptor |
Cclk_cfg_t | Clock configuration |
Ccmac_context_t | AES_CMAC calculation context |
Ccoap_block1_t | Block1 helper struct |
Ccoap_block_slicer_t | Blockwise transfer helper struct |
Ccoap_hdr_t | Raw CoAP PDU header structure |
Ccoap_link_encoder_ctx_t | Context information required to write a resource link |
Ccoap_optpos_t | CoAP option array entry |
Ccoap_pkt_t | CoAP PDU parsing context structure |
Ccoap_resource_t | Type for CoAP resource entry |
Ccolor_hsv_t | Data-structure for holding HSV colors |
Ccolor_rgb_t | Data-structure describing a RGB color |
Ccolor_rgba_t | RGBA color value |
Ccond_t | Condition variable structure |
CCONFIG_SUIT_STORAGE_RAM_ATTR | Memory storage state |
Cconn_can_isotp_master | ISO-TP master connection |
Cconn_can_isotp_slave | ISO-TP salve connection |
Cconn_can_raw | RAW CAN connection |
Cconstfs_file_t | A file in ConstFS (file name + contents) |
Cconstfs_t | ConstFS file system superblock |
Ccontext_switch_frame | Stores the registers and PC for a context switch |
Ccord_lc_filter | Filters to use for a lookup |
Ccord_lc_rd_t | Information about RD server and its lookup interface resources |
Ccord_lc_result | Result of lookup |
Ccortexm_base_t | Structure of Cortex-M basic vector table |
Ccredman_buffer_t | Buffer of the credential |
Ccredman_credential_t | Credential information |
Ccsd_t | CSD register (see section 5.3 in SD-Spec v5.00) |
Ccsd_v1_t | CSD register with csd structure version 1.0 see section 5.3.2 in SD-Spec v5.00 |
Ccsd_v2_t | CSD register with csd structure version 2.0 see section 5.3.3 in SD-Spec v5.00 |
Ccsma_sender_conf_t | Configuration type for backoff |
Cdac_conf_t | DAC line configuration data |
Cdcf77 | Device descriptor for DCF77 sensor devices |
►Cdcf77_bits_t | Timeinformation bitfields for DCF77 devices |
Cvalues | Struct of bitfields |
Cdcf77_params_t | Configuration parameters for DCF77 devices |
Cddi0_osc_regs_m16_t | DDI_0_OSC registers with masked 16-bit access |
Cddi0_osc_regs_t | DDI_0_OSC registers |
Cdebugpins_config | Struct holding configuration of OpenWSN debug pins |
Cdevfs | A device "file" consists of a file name and an opaque pointer to device driver private data |
Cdfplayer | A DFPlayer Mini device descriptor |
Cdfplayer_file_t | Data structure representing a file on the DFPlayer |
Cdfplayer_params_t | Initialization parameters of a DFPlayer Mini device descriptor |
Cdhcpv6_duid_l2_t | DUID based on link-layer address plus time |
Cdhcpv6_duid_t | Generic storage DUID |
Cdhcpv6_msg_t | Client/Server message header |
Cdhcpv6_opt_duid_t | DHCPv6 client or server identifier option format |
Cdhcpv6_opt_elapsed_time_t | DHCPv6 elapsed time option format |
Cdhcpv6_opt_ia_pd_t | DHCPv6 identity association for prefix delegation option (IA_PD) format |
Cdhcpv6_opt_iapfx_t | DHCPv6 IA prefix option format |
Cdhcpv6_opt_oro_t | DHCPv6 option request option format |
Cdhcpv6_opt_pref_t | DHCPv6 preference option format |
Cdhcpv6_opt_smr_t | DHCPv6 SOL_MAX_RT option format |
Cdhcpv6_opt_status_t | DHCPv6 status code option format |
Cdhcpv6_opt_t | General DHCPv6 option format |
Cdht_data_t | Data type for storing DHT sensor readings |
Cdht_params_t | Configuration parameters for DHT devices |
Cdht_t | Device descriptor for DHT sensor devices |
Cdisp_dev | Generic type for a display device |
Cdisp_dev_driver_t | Generic type for a display driver |
Cdma_conf_t | DMA configuration |
Cdose_params_t | Struct containing the required configuration |
Cdose_t | DOSE netdev device |
Cdpl_callout | Callout structure |
Cdpl_event | Dpl event wrapper |
Cdpl_eventq | Dpl event queue wrapper |
Cdpl_mutex | Dpl mutex wrapper |
Cdpl_sem | Dpl semaphore wrapper |
Cdpl_task | Dpl task wrapper |
Cds1307_params_t | Set of configuration parameters for DS1307 devices |
Cds1307_t | Device descriptor for DS1307 devices |
Cds18_params_t | Device initialization parameters |
Cds18_t | Device descriptor for a ds18 device |
Cds3231_params_t | Set of configuration parameters for DS3231 devices |
Cds3231_t | Device descriptor for DS3231 devices |
Cds3234_params_t | Parameters for the DS3234 device driver |
Cds75lx_params_t | Device initialization parameters |
Cds75lx_t | Device descriptor for the DS75LX sensor |
Cdsp0401_params_t | Device initialization parameters |
Cdsp0401_t | Device descriptor for the DSP0401 |
Cdynamixel_reader_t | Dynamixel packet reader struct |
Cdynamixel_t | Descriptor struct for a dynamixel device |
Cdynamixel_writer_t | Dynamixel packet writer struct |
Cecdsa_params_t | ECDSA parameters |
Cecdsa_public_key_t | ECDSA public keys |
Cemcute_sub | Data-structure for keeping track of topics we register to |
Cemcute_topic_t | MQTT-SN topic |
Cenc28j60_params_t | Struct containing the needed peripheral configuration |
Cenc28j60_t | ENC28J60 device descriptor |
Cencx24j600_frame_hdr | Structure resembling format as sent by device |
Cencx24j600_params_t | Struct containing the needed peripheral configuration |
Cencx24j600_t | Encx24j600 netdev device |
Cesp_eth_netdev_t | Device descriptor for ESP-ETH devices |
Cesp_now_netdev_t | Device descriptor for ESP-NOW devices |
Cesp_now_params_t | Struct holding all parameters needed for device initialization |
Cesp_now_pkt_hdr_t | Header with necessary flags for ESP-NOW packets |
Cesp_wifi_netdev_t | Device descriptor for ESP WiFi devices |
Ceth_conf_t | Ethernet Peripheral configuration |
Ceth_dma_desc | Layout of enhanced RX/TX DMA descriptor |
Cethernet_hdr_t | Ethernet header |
Cethos_params_t | Struct containing the needed configuration |
Cethos_t | Ethos netdev device |
Ceui48_conf_t | Structure to hold providers for EUI-48 addresses |
Ceui48_t | Data type to represent an EUI-48 |
Ceui64_conf_t | Structure to hold providers for EUI-64 addresses |
Ceui64_t | Data type to represent an EUI-64 |
Cevent | Event structure |
Cevent_callback_t | Callback Event structure definition |
Cevent_queue_t | Event queue structure |
Cevent_timeout_t | Timeout Event structure |
Cevtimer_event | Generic event |
Cevtimer_mbox_event_t | Message box event definition |
Cevtimer_msg_event_t | IPC-message event |
Cevtimer_t | Event timer |
Cfatfs_desc | FatFs instance descriptor |
Cfatfs_file_desc | FatFs file instance descriptor |
Cfcfg_regs_t | FCFG registers |
Cfd_set | The fd_set structure |
Cfeetech_reader_t | Feetech packet reader struct |
Cfeetech_t | Descriptor struct for a feetech device |
Cfeetech_writer_t | Feetech packet writer struct |
Cfib_destination_set_entry_t | Entry used to collect available destinations |
Cfib_entry_t | Container descriptor for a FIB entry |
Cfib_sr_entry | Container descriptor for a FIB source route entry |
Cfib_sr_meta_t | Container for one FIB source route table, combining source routes and an entry pool |
Cfib_sr_t | Container descriptor for a FIB source route |
Cfib_table_t | Meta information of a FIB table |
CFIO_PORT_t | Fast GPIO register definition struct |
Cflash_regs_t | FLASH registers |
Cfletcher16_ctx_t | Fletcher's 16 bit checksum context struct |
Cfrac_t | Frac descriptor for fraction consisting of two 32 bit integers |
Cfxos8700_measurement_t | Individual 3-axis measurement |
Cfxos8700_params_t | Parameters needed for device initialization |
Cfxos8700_t | Device descriptor for a FXOS8700 device |
Cgcoap_listener | A modular collection of resources for a server |
Cgcoap_observe_memo_t | Memo for Observe registration and notifications |
Cgcoap_request_memo | Memo to handle a response for a request |
Cgcoap_resend_t | Extends request memo for resending a confirmable request |
Cgnrc_gomach_dupchk_t | GoMacH's data structure for recording TX information for avoiding receiving duplicate packets |
Cgnrc_gomach_dupchk_unit_t | GoMacH's data structure for recording sender's past TX information |
Cgnrc_gomach_frame_announce_t | GoMacH sub-channel announce frame |
Cgnrc_gomach_frame_beacon_t | GoMacH Beacon frame |
Cgnrc_gomach_frame_broadcast_t | GoMacH broadcast frame |
Cgnrc_gomach_frame_data_t | GoMacH data frame |
Cgnrc_gomach_frame_preamble_ack_t | GoMacH preamble_ack frame |
Cgnrc_gomach_frame_preamble_t | GoMacH preamble frame |
Cgnrc_gomach_hdr_t | GoMacH frame header |
Cgnrc_gomach_l2_addr_t | GoMacH internal L2 address structure |
Cgnrc_gomach_l2_id_t | GoMacH internal L2 address structure |
Cgnrc_gomach_packet_info_t | Type to pass information about packet parsing |
Cgnrc_gomach_slosch_unit_t | GoMacH's slot-schedule-unit |
Cgnrc_gomach_timeout_t | GoMacH's timeout structure |
Cgnrc_gomach_vtdma_manag_t | GoMacH's vTDMA (dynamic slots allocation) management unit |
Cgnrc_gomach_vtdma_t | Sender's vTDMA (dynamic slots allocation) management unit |
Cgnrc_ipv6_ext_frag_limits | Data type to describe limits of a single fragment in the reassembly buffer |
Cgnrc_ipv6_ext_frag_rbuf_t | A reassembly buffer entry |
Cgnrc_ipv6_ext_frag_send_t | Fragmentation send buffer type |
Cgnrc_ipv6_ext_frag_stats_t | Statistics on reassembly and reassembly |
Cgnrc_ipv6_nib_abr_t | Authoritative border router list entry view on NIB |
Cgnrc_ipv6_nib_ft_t | Forwarding table entry view on NIB |
Cgnrc_ipv6_nib_nc_t | Neighbor cache entry view on NIB |
Cgnrc_ipv6_nib_pl_t | Prefix list entry view on NIB |
Cgnrc_lorawan_mcps_t | MCPS service access point descriptor |
Cgnrc_lorawan_mlme_t | MLME service access point descriptor |
Cgnrc_lorawan_t | GNRC LoRaWAN mac descriptor |
Cgnrc_lwmac_frame_broadcast_t | LWMAC broadcast data frame |
Cgnrc_lwmac_frame_data_t | LWMAC unicast data frame |
Cgnrc_lwmac_frame_wa_t | LWMAC WA (wake-up answer packet, i.e., preamble-ACK packet) frame |
Cgnrc_lwmac_frame_wr_t | LWMAC WR (wake-up request packet, i.e., preamble packet) frame |
Cgnrc_lwmac_hdr_t | LWMAC header |
Cgnrc_lwmac_l2_addr_t | LWMAC internal L2 address structure |
Cgnrc_lwmac_packet_info_t | Type to pass information about parsing |
Cgnrc_lwmac_timeout_t | LWMAC timeout structure |
Cgnrc_mac_rx_t | MAC internal type for storing reception state parameters and state machines |
Cgnrc_mac_timeout_event_t | Structure of the GNRC_MAC timeout event |
Cgnrc_mac_timeout_t | Structure holding the GNRC_MAC timeouts |
Cgnrc_mac_tx_neighbor_t | Type for storing states of TX neighbor node |
Cgnrc_mac_tx_t | MAC internal type for storing transmission state parameters and state machines |
Cgnrc_netapi_opt_t | Data structure to be send for setting (GNRC_NETAPI_MSG_TYPE_SET) and getting (GNRC_NETAPI_MSG_TYPE_GET) options |
Cgnrc_netif_6lo_t | 6Lo component of gnrc_netif_t |
Cgnrc_netif_dedup_t | Structure to store information on the last broadcast packet received |
Cgnrc_netif_hdr_t | Generic network interface header |
Cgnrc_netif_ipv6_t | IPv6 component for gnrc_netif_t |
Cgnrc_netif_lorawan_t | GNRC LoRaWAN interface descriptor |
Cgnrc_netif_mac_t | Common MAC module component of gnrc_netif_mac_t |
Cgnrc_netif_ops | |
Cgnrc_netif_pktq_t | A packet queue for Network interface API with a de-queue timer |
Cgnrc_netif_t | Representation of a network interface |
Cgnrc_netreg_entry | Entry to the Network protocol registry |
Cgnrc_netreg_entry_cbd_t | Callback + Context descriptor |
Cgnrc_pktqueue | Data type for packet queue nodes |
Cgnrc_pktsnip | Type to represent parts (either headers or payload) of a packet, called snips |
Cgnrc_priority_pktqueue_node | Data type for gnrc priority packet queue nodes |
Cgnrc_rpl_dao_ack_t | Destination Advertisement Object Acknowledgement |
Cgnrc_rpl_dao_t | Destination Advertisement Object |
Cgnrc_rpl_dio_t | DIO Base Object |
Cgnrc_rpl_dis_t | DODAG Information Solicitation |
Cgnrc_rpl_internal_opt_dis_solicited_t | Internal unpacked struct type for DIS solicited option insertion |
Cgnrc_rpl_internal_opt_t | Internal unpacked struct type for option insertion |
Cgnrc_rpl_of_t | Objective function representation |
Cgnrc_rpl_opt_dis_solicited_t | DIS Solicited Information option |
Cgnrc_rpl_opt_dodag_conf_t | DODAG Configuration Option |
Cgnrc_rpl_opt_prefix_info_t | Prefix Information Option |
Cgnrc_rpl_opt_t | RPL-Option Generic Format |
Cgnrc_rpl_opt_target_t | Target Option |
Cgnrc_rpl_opt_transit_t | Transit Option |
Cgnrc_rpl_p2p_dro_ack_t | P2P Discovery Reply Object Acknowledgement (P2P-DRO-ACK) |
Cgnrc_rpl_p2p_dro_t | P2P Discovery Reply Object (P2P-DRO) |
Cgnrc_rpl_p2p_ext_t | Extended DODAG information for P2P-RPL |
Cgnrc_rpl_p2p_opt_rdo_t | P2P Route Discovery Object (RDO) Option |
Cgnrc_rpl_srh_t | The RPL Source routing header |
Cgnrc_sixlowpan_ctx_t | Entry in the 6LoWPAN context buffer |
Cgnrc_sixlowpan_frag_fb_t | 6LoWPAN fragmentation buffer entry |
Cgnrc_sixlowpan_frag_hint_t | A fragment size hint |
Cgnrc_sixlowpan_frag_rb_base_t | Base class for both reassembly buffer and virtual reassembly buffer |
Cgnrc_sixlowpan_frag_rb_int | Fragment intervals to identify limits of fragments and duplicates |
Cgnrc_sixlowpan_frag_rb_t | An entry in the 6LoWPAN reassembly buffer |
Cgnrc_sixlowpan_frag_stats_t | Statistics on fragmentation and reassembly |
Cgnrc_sixlowpan_frag_vrb_t | Representation of the virtual reassembly buffer entry |
Cgnrc_sock_reg | Sock Network protocol registry info |
Cgnrc_tcp_ep_t | Address information for a single TCP connection endpoint |
Cgomach | GoMacH's specific structure for storing internal states |
Cgp2y10xx_params_t | GP2Y10xx device parameters |
Cgp2y10xx_t | GP2Y10xx device descriptor |
Cgpio_isr_ctx_t | Default interrupt context for GPIO pins |
Cgpio_regs_t | GPIO registers |
Cgpt_reg_t | GPT registers |
Chal_spi_settings | Since one spi device can control multiple devices, some configuration can be changed on the fly from the hal |
Chal_timer | The HAL timer structure |
Chard_api_t | ROM Hard-API |
Chd44780_params_t | Parameters needed for device initialization |
Chd44780_t | Device descriptor for HD44780 LCD |
Chdc1000_params_t | Parameters needed for device initialization |
Chdc1000_t | Device descriptor for HDC1000 sensors |
Chih6130_t | Device descriptor for HIH6130/HIH6131 sensors |
Chmac_context_t | Context for HMAC operations based on sha256 |
Chmc5883l_data_t | Magnetic field values in milli-Gauss (mGs) |
Chmc5883l_params_t | HMC5883L device initialization parameters |
Chmc5883l_raw_data_t | Raw data set as two complements |
Chmc5883l_t | HMC5883L sensor device data structure type |
Chts221_params_t | Parameters needed for device initialization |
Chts221_t | Device descriptor for HTS221 sensors |
Ci2c_conf_t | I2C configuration options |
Ci2c_regs_t | I2C registers |
Cicmp_echo_t | Echo request and response message format |
Cicmpv6_echo_t | Echo request and response message format |
Cicmpv6_error_dst_unr_t | Destination unreachable message format |
Cicmpv6_error_param_prob_t | Parameter problem message format |
Cicmpv6_error_pkt_too_big_t | Packet too big message format |
Cicmpv6_error_time_exc_t | Time exceeded message format |
Cicmpv6_hdr_t | General ICMPv6 message format |
Cieee802154_csma_be_t | CSMA-CA exponential backoff parameters |
Cieee802154_dev | IEEE802.15.4 device descriptor |
Cieee802154_phy_conf_t | Holder of the PHY configuration |
Cieee802154_radio_ops | Radio ops struct declaration |
Cieee802154_rx_info_t | RX information associated to a frame |
Cieee802154_submac | IEEE 802.15.4 SubMAC descriptor |
Cieee802154_submac_cb_t | IEEE 802.15.4 SubMAC callbacks |
Cieee802154_tx_info_t | TX information of the last transmitted frame |
Cili9341_params_t | Device initialization parameters |
Cili9341_t | Device descriptor for a ili9341 |
Cin6_addr | IPv6 address structure type |
Cin_addr | IPv4 address structure type |
Cina2xx_params_t | Configuration parameters of the INA2xx driver |
Cina2xx_t | Device descriptor for INA2XX sensors |
Cina3221_params_t | INA3221 device parameters |
Cina3221_t | INA3221 device handle struct |
Cio1_xplained_params_t | Device initialization parameters |
Cio1_xplained_t | Device descriptor for the IO1 Xplained extension |
Ciolist | Iolist structure definition |
Ciovec | Structure for scatter/gather I/O |
Cipv4_addr_t | Data type to represent an IPv4 address |
Cipv4_hdr_t | Data type to represent an IPv4 packet header |
Cipv6_addr_t | Data type to represent an IPv6 address |
Cipv6_ext_frag_t | Fragment header definition |
Cipv6_ext_rh_t | IPv6 routing extension header |
Cipv6_ext_t | IPv6 extension headers |
Cipv6_hdr_t | Data type to represent an IPv6 packet header |
Cipv6_mreq | IPv6 multicast request |
Cisl29020_params_t | Data structure holding the full set of configuration parameters |
Cisl29020_t | Device descriptor for ISL29020 sensors |
Cisl29125_params_t | Device parameters for ISL29125 sensors |
Cisl29125_rgb_t | Data type for storing lux RGB sensor readings |
Cisl29125_t | Device descriptor for ISL29125 sensors |
Cisotp | The isotp struct |
Cisotp_fc_options | The isotp_fc_options struct |
Cisotp_options | The isotp_options struct |
Cisrpipe_t | Context structure for isrpipe |
Citg320x_data_t | Angular rate values in tenths of a degree per second |
Citg320x_params_t | ITG320X device initialization parameters |
Citg320x_raw_data_t | Raw data set as two complements |
Citg320x_t | ITG320X sensor device data structure type |
Cjc42_params_t | Device initialization parameters |
Cjc42_t | Device descriptor for a jc42 device |
Ckeccak_state_t | Context for operations on a sponge with keccak permutation |
Ckw2xrf_params | Struct holding all params needed for device initialization |
Ckw2xrf_t | Device descriptor for KW2XRF radio devices |
Ckw41zrf_t | Device descriptor for KW41ZRF radio devices |
Cl2filter_t | Filter list entries |
Cl3g4200d_data_t | Result vector for gyro measurement |
Cl3g4200d_params_t | Device initialization parameters |
Cl3g4200d_t | Device descriptor for L3G4200D sensors |
Clc709203f_params_t | Parameter struct for driver initialization |
Clc709203f_t | Device descriptor for the fuel gauge |
Cle_uint16_t | A 16 bit integer in little endian |
Cle_uint32_t | A 32 bit integer in little endian |
Cle_uint64_t | A 64 bit integer in little endian |
Cleds_config | OpenWSN leds pin configuration |
Clis2dh12_int_params_t | Parameter for interrupt configuration |
Clis2dh12_params_t | LIS2DH12 configuration parameters |
Clis2dh12_t | LIS2DH12 device descriptor |
Clis3dh_data_t | Result vector for accelerometer measurement |
Clis3dh_params_t | Configuration parameters for LIS3DH devices |
Clis3dh_t | Device descriptor for LIS3DH sensors |
Clis3mdl_3d_data_t | 3d data container of the LIS3MDL sensor |
Clis3mdl_params_t | Device initialization parameters |
Clis3mdl_t | Device descriptor for LIS3MDL sensor |
Clist_node | List node structure |
Clittlefs2_desc_t | Littlefs descriptor for vfs integration |
Clittlefs_desc_t | Littlefs descriptor for vfs integration |
Clog | Empty log structure |
Cloramac_channel_t | A LoRaMAC network channel |
Cloramac_settings_t | LoRaMAC communication settings |
Clorawan_buffer_t | Buffer helper for parsing and constructing LoRaWAN packets |
Clorawan_hdr_t | Data type to represent a LoRaWAN packet header |
Clorawan_join_accept_t | Join accept packet representation |
Clorawan_join_request_t | Join request packet representation |
Clpd8808_params_t | Parameters needed for configuration |
Clpsxxx_params_t | Struct holding all parameters needed for device initialization |
Clpsxxx_t | Device descriptor for LPSXXX sensors |
Clsm303dlhc_3d_data_t | 3d data container |
Clsm303dlhc_params_t | Data structure holding all the information needed for initialization |
Clsm303dlhc_t | Device descriptor for LSM303DLHC sensors |
Clsm6dsl_3d_data_t | 3D output data |
Clsm6dsl_params_t | LSM6DSL driver parameters |
Clsm6dsl_t | LSM6DSL device descriptor |
Cltc4150_dev | LTC4150 coulomb counter |
Cltc4150_last_minute_data_t | Data structure used by ltc4150_last_minute |
Cltc4150_params_t | Parameters required to set up the LTC4150 coulomb counter |
Cltc4150_recorder_t | Interface to allow recording of the drawn current in a user defined resolution |
Clua_riot_builtin_c | Entry describing a c lua module built into the application binary |
Clua_riot_builtin_lua | Entry describing a pure lua module whose source is built into the application binary |
Clwip_sock_base | Sock base type |
Clwm2m_client_connection | Connection to server descriptor |
Clwm2m_client_data_t | LwM2M client descriptor |
Clwmac | LWMAC specific structure for storing internal states |
Cmag3110_data_t | Data type for the result data |
Cmag3110_params_t | Configuration parameters |
Cmag3110_t | Device descriptor for MAG3110 magnetometer |
Cmatstat_state_t | Internal state for computing running statistics |
Cmbox_t | Mailbox struct definition |
Cmcps_confirm_t | Mac Common Part Sublayer (MCPS) confirm representation |
Cmcps_data_t | MCPS data |
Cmcps_indication_t | Mac Common Part Sublayer (MCPS) indication representation |
Cmcps_request_t | Mac Common Part Sublayer (MCPS) request representation |
Cmd5_ctx_t | MD5 calculation context |
Cmega_timer_t | Timer register map |
Cmega_uart_t | UART register map |
Cmemarray_t | Memory pool |
Cmini_timer_t | 8-bit timer register map |
Cmlme_confirm_t | MAC (sub) Layer Management Entity (MLME) confirm representation |
Cmlme_indication_t | MAC (sub) Layer Management Entity (MLME) indication representation |
Cmlme_link_req_confirm_t | MLME Link Check confirmation data |
Cmlme_lorawan_join_t | MLME Join Request data |
Cmlme_mib_t | MAC Information Base descriptor for MLME Request-Confirm |
Cmlme_request_t | MAC (sub) Layer Management Entity (MLME) request representation |
Cmma7660_data_t | Data type for the result data |
Cmma7660_params_t | Parameters for an MMA7660 device |
Cmma7660_t | Device descriptor for an MMA7660 device |
Cmma8x5x_data_t | Data type for the result data |
Cmma8x5x_params_t | Configuration parameters |
Cmma8x5x_t | Device descriptor for MMA8x5x accelerometers |
Cmotor_driver_config_t | Describe DC motor driver with PWM device and motors array |
Cmotor_t | Describe DC motor with PWM channel and GPIOs |
Cmpl3115a2_params_t | Configuration parameters |
Cmpl3115a2_t | Device descriptor for MPL3115A2 sensors |
Cmpu9x50_params_t | Device initialization parameters |
Cmpu9x50_results_t | MPU-9X50 result vector struct |
Cmpu9x50_status_t | Configuration struct for the MPU-9X50 sensor |
Cmpu9x50_t | Device descriptor for the MPU9X50 sensor |
Cmq3_t | Device descriptor for a MQ-3 sensor |
Cmrf24j40_params | Struct holding all params needed for device initialization |
Cmrf24j40_t | Device descriptor for MRF24J40 radio devices |
Cmsg_bus_entry_t | Message bus subscriber entry |
Cmsg_bus_t | A message bus is just a list of subscribers |
Cmsg_t | Describes a message object which can be sent between threads |
Cmsp_port_isr_t | Digital I/O Port with interrupt functionality (P1 & P2) |
Cmsp_port_t | Digital I/O Port w/o interrupt functionality (P3-P6) |
Cmsp_sfr_t | Special function registers |
Cmsp_timer_ivec_t | Timer interrupt status registers |
Cmsp_timer_t | Timer module registers |
Cmsp_usart_t | USART (UART, SPI and I2C) registers |
Cmsp_usci_spi_t | USCI SPI specific registers |
Cmsp_usci_t | USCI universal serial control interface registers |
Cmtd_at24cxxx_t | Device descriptor for mtd at24cxxx device |
Cmtd_at25xxx_t | Device descriptor for mtd_at25xxx device |
Cmtd_desc | MTD driver interface |
Cmtd_dev_t | MTD device descriptor |
Cmtd_jedec_id_t | Internal representation of JEDEC memory ID codes |
Cmtd_mapper_parent_t | MTD mapper backing device context |
Cmtd_mapper_region_t | MTD mapped region |
Cmtd_native_dev | Mtd native descriptor |
Cmtd_sdcard_t | Device descriptor for mtd_sdcard device |
Cmtd_spi_nor_opcode_t | SPI NOR flash opcode table |
Cmtd_spi_nor_params_t | Compile-time parameters for a serial flash device |
Cmtd_spi_nor_t | Device descriptor for serial flash memory devices |
CMutex | Mutex struct within mqtt paho |
Cmutex_t | Mutex structure |
Cmy9221_params_t | Parameters needed for device initialization |
Cmy9221_t | Device descriptor for MY9221 LED controller |
Cncv7356_trx | Ncv7356 trx descriptor |
Cndp_nbr_adv_t | Neighbor advertisement message format |
Cndp_nbr_sol_t | Neighbor solicitation message format |
Cndp_opt_mtu_t | MTU option format |
Cndp_opt_pi_t | Prefix information option format |
Cndp_opt_rdnss_impl_t | Recursive DNS server option format with payload |
Cndp_opt_rdnss_t | Recursive DNS server option format without payload |
Cndp_opt_rh_t | Redirected header option format |
Cndp_opt_t | General NDP option format |
Cndp_redirect_t | Redirect message format |
Cndp_rtr_adv_t | Router advertisement message format |
Cndp_rtr_sol_t | Router solicitation message format |
Cnetdev | Structure to hold driver state |
Cnetdev_ble_ctx_t | Radio context |
Cnetdev_ble_pkt_t | BLE packet structure (as defined by the BLE standard) |
Cnetdev_driver | Structure to hold driver interface -> function mapping |
Cnetdev_ieee802154_submac_t | IEEE 802.15.4 SubMAC netdev descriptor |
Cnetdev_ieee802154_t | Extended structure to hold IEEE 802.15.4 driver state |
Cnetdev_lora_rx_info_t | Received LoRa packet status information |
Cnetdev_radio_rx_info | Received frame status information for most radios |
Cnetdev_tap | Tap interface state |
Cnetdev_tap_params_t | Tap interface initialization parameters |
Cnetdev_test_t | Device descriptor for netdev dummy test driver devices |
Cnetif_t | Network interface descriptor |
Cnetstats_rpl_t | RPL statistics struct |
Cnetstats_t | Global statistics struct |
CNetwork | Network struct within mqtt paho |
Cnfc_iso14443a_t | ISO14443A tag description |
Cnimble_autoconn_params_t | Set of configuration parameters needed to run autoconn |
Cnimble_netif_conn_t | Memory layout for holding the relevant connection information |
Cnimble_scanlist_entry_t | Data structure for holding a single scanlist entry |
Cnrf24l01p_t | Structure that represents the hardware setup of the nrf24l01+ transceiver |
Cnrf802154_t | Device descriptor for NRF802154 transceiver |
Cnrfmin_hdr_t | Header format used for our custom nrfmin link layer |
Cnrfmin_pkt_t | In-memory structure of a nrfmin radio packet |
Cnrfusb_t | Nrf usb peripheral device context |
Cntp_packet_t | NTP packet |
Cntp_timestamp_t | NTP timestamp |
Cnvram | Device descriptor for generic NVRAM devices |
Cnvram_spi_params | Bus parameters for SPI NVRAM |
Copenwsn_radio_t | OpenWSN radio variables structure |
Copt3001_params_t | Parameters needed for device initialization |
Copt3001_t | Device descriptor for OPT3001 sensors |
Cos_dev | Device structure |
Cot_job_t | Struct containing an OpenThread job |
Cpca9633_params_t | PCA9633 device initialization parameters |
Cpca9633_t | PCA9633 PWM device data structure type |
Cpca9685_params_t | PCA9685 device initialization parameters |
Cpca9685_saul_pwm_params_t | PCA9685 configuration structure for mapping PWM channels to SAUL |
Cpca9685_t | PCA9685 PWM device data structure type |
Cpcd8544_t | PCD8544 device descriptor |
Cph_oem | PH OEM device descriptor |
Cph_oem_params | PH OEM sensor params |
Cphydat_t | Generic data structure for expressing physical values |
Cpir_params_t | Parameters needed for device initialization |
Cpir_t | Device descriptor for a PIR sensor |
Cpit_conf_t | CPU specific timer PIT module configuration |
Cpll_cfg_t | PLL configuration parameters |
Cpm_blocker_t | Power Management mode blocker typedef |
Cpn532_params_t | Data structure with the configuration parameters |
Cpn532_t | Device descriptor for the PN532 |
Cpoly1305_ctx_t | Poly1305 context |
Cppp_hdr_t | Header of a PPP packet |
Cprcm_regs_t | PRCM registers |
Cpriority_queue_node | Data type for priority queue nodes |
Cpriority_queue_t | Data type for priority queues |
Cprogress_bar_t | Progress bar descriptor |
Cpsk_params_t | PSK parameters |
Cpthread_attr_t | An attribute set to supply to pthread_create() |
Cpthread_barrier_t | A synchronization barrier |
Cpthread_barrier_waiting_node | Internal structure to store the list of waiting threads |
Cpthread_barrierattr_t | Details for a pthread_barrier_t |
Cpthread_cond_t | Condition variable |
Cpthread_condattr_t | |
Cpthread_mutexattr_t | This type is unused right now, and only exists for POSIX compatibility |
Cpthread_rwlock_t | A fair reader writer lock |
Cpthread_rwlockattr_t | Attributes for a new reader/writer lock |
Cpthread_spinlock_t | A spinlock |
Cpulse_counter_params_t | Parameters needed for device initialization |
Cpulse_counter_t | Device descriptor for a pulse counter device |
Cpwm_chan_conf_t | PWM channel configuration |
Cpwm_chan_t | PWM channel |
Cpwm_conf_chan_t | PWM channel configuration data structure |
Cpwm_conf_t | PWM device configuration |
Cqdec_chan_t | QDEC channel |
Cqdec_conf_t | QDEC configuration |
Cqdec_isr_ctx_t | Default interrupt context entry holding callback and argument |
Cqmc5883l_params_t | QMC5883L initialization parameters |
Cqmc5883l_t | QMC5883L device descriptor |
Creg32_m16_t | Masked 32-bit register |
Creg8_m4_t | Masked 8-bit register |
Crfc_dbell_regs_t | RFC_DBELL registers |
Crfc_pwr_regs_t | RFC_PWR registers |
Crgbled_t | Descriptor struct for rgbleds |
Cringbuffer_t | Ringbuffer |
Criot_pipe | A generic pipe |
Criotboot_flashwrite_t | Firmware update state structure |
Criotboot_hdr_t | Structure to store image header - All members are little endian |
Crmutex_t | Mutex structure |
Crn2xx3_params_t | Configuration parameters for RN2483/RN2903 devices |
Crn2xx3_t | RN2483/RN2903 device descriptor |
Crp_address_msg_t | Routing Protocol (RP) message content to request/reply notification |
Crtt_hw_driver_t | RTT hardware abstraction layer driver |
Csam0_aux_cfg_mapping | NVM User Row Mapping - Dedicated Entries Config values will be applied at power-on |
Csam0_common_usb_config_t | USB peripheral parameters |
Csam0_common_usb_t | Sam0 usb peripheral device context |
Csaul_adc_params_t | Direct mapped ADC configuration values |
Csaul_driver_t | Definition of the RIOT actuator/sensor interface |
Csaul_gpio_params_t | Direct mapped GPIO configuration values |
Csaul_pwm_channel_t | Single PWM channel exposed via SAUL |
Csaul_pwm_dimmer_params_t | PWM channels mapped to dimmer-style registration entries |
Csaul_pwm_rgb_params_t | PWM channels mapped to RGB LED registration entries |
Csaul_reg | SAUL registry entry |
Csaul_reg_info_t | Additional data to collect for each entry |
Cscd30_measurement_t | Measurement from SCD30 sensor |
Cscd30_params_t | Device initialization parameters |
Cscd30_t | Device descriptor for the SCD30 sensor |
Csched_param | This structure is unused right now, and only exists for POSIX compatibility |
Cschedstat_t | Scheduler statistics |
Cscheduler_vars_t | OpenWSN scheduler variables structure |
Cscreen_dev_t | Screen device descriptor |
Csd_status_t | SD status register (see section 4.10.2 in SD-Spec v5.00) |
Csdcard_spi_params_t | Sdcard_spi device params |
Csdcard_spi_t | Device descriptor for sdcard_spi |
Csdp3x_measurement_t | Measurement from SDP3x sensor |
Csdp3x_params_t | Device initialization parameters |
Csdp3x_t | Device descriptor for the SDP3x sensor |
Csds011_data_t | Data type for storing SDS011 sensor readings |
Csds011_params_t | Configuration parameters for SDS011 Laser Dust Sensor |
Csds011_t | Device descriptor definition for SDS011 Laser Dust Sensor |
Csector_info_struct | Struct defining sector information |
Cseesaw_soil_params_t | Parameters needed for device initialization |
Cseesaw_soil_t | Device descriptor for Seesaw Soil sensors |
Csema_t | A Semaphore |
Csemtech_loramac_channel_params_t | LoRaMAC channel radio parameters |
Csemtech_loramac_link_check_info_t | LoRaMAC link check information |
Csemtech_loramac_rx_data_t | Structure containing LoRaWAN RX data |
Csemtech_loramac_t | Semtech LoRaMAC descriptor |
Cserial_msg_t | Struct containing a serial message |
CSerialPort | Arduino Serial Interface |
Cservo_t | Descriptor struct for a servo |
Csha1_context | SHA-1 algorithm context |
Csha256_chain_idx_elm_t | Sha256-chain indexed element |
Csha2xx_context_t | Structure to hold the SHA-2XX context |
Cshell_command_t | A single command in the list of the supported commands |
Csht1x_dev_t | SHT10/11/15 temperature humidity sensor |
Csht1x_params_t | Parameters required to set up the SHT10/11/15 device driver |
Csht2x_params_t | Device initialization parameters |
Csht2x_t | Device descriptor for the SHT2X sensor |
Csht3x_dev_t | SHT3x sensor device data structure |
Csht3x_params_t | SHT3x device initialization parameters |
Cshtc1_params_t | Settings struct with all relevant parameters |
Cshtc1_t | Device descriptor for the SHTC1 |
Csi114x_params_t | Device initialization parameters |
Csi114x_t | Device descriptor for the Si114x sensor |
Csi70xx_params_t | Device initialization parameters |
Csi70xx_t | Si70xx device descriptor |
Csixlowpan_frag_n_t | Subsequent 6LoWPAN fragmentation header |
Csixlowpan_frag_t | General and 1st 6LoWPAN fragmentation header |
Csixlowpan_nd_da_t | Duplicate address request and confirmation message format |
Csixlowpan_nd_opt_6ctx_t | 6LoWPAN context option format |
Csixlowpan_nd_opt_abr_t | Authoritative border router option format |
Csixlowpan_nd_opt_ar_t | Address registration option format |
Csixlowpan_sfr_ack_t | Recoverable fragment (RFRAG) acknowledgment header |
Csixlowpan_sfr_rfrag_t | Recoverable fragment header |
Csixlowpan_sfr_t | Generic type for selective fragment recovery headers |
Cskald_ctx_t | Advertising context holding the advertising data and state |
Cskald_eddystone_uid_t | Unique and opaque 16-byte beacon id format used by Eddystone |
Cskald_uuid_t | UUID representation format used by Skald |
Cslipdev_params_t | Configuration parameters for a slipdev |
Cslipdev_t | Device descriptor for slipdev |
Csock_async_ctx_t | Asynchronous context for Asynchronous sock with event API |
Csock_dns_hdr_t | DNS internal structure |
Csock_dtls | Information about DTLS sock |
Csock_dtls_session | Information about remote client connected to the server |
Csock_event_cb_t | Generalized callback type |
Csock_event_t | Event definition for context scope |
Csock_ip | Raw IP sock type |
Csock_ip_ep_t | Abstract IP end point and end point for a raw IP sock object |
Csock_tcp | TCP sock type |
Csock_tcp_queue | TCP queue type |
Csock_udp | UDP sock type |
Csockaddr | Used to define the socket address |
Csockaddr_in | IPv4 socket address type |
Csockaddr_in6 | IPv6 socket address type |
Csockaddr_ll | Link-Layer socket descriptor |
Csockaddr_storage | Implementation based socket address table |
Csocket_zep_params_t | ZEP device initialization parameters |
Csocket_zep_t | ZEP device state |
Csoft_spi_conf_t | Software SPI port descriptor |
Csoft_uart_conf_t | Software UART port descriptor |
Csomeip_hdr_t | SOME/IP header |
Csomeip_message_id_t | Structure of the Message ID |
Csomeip_request_id_t | Structure of the Request ID |
Cspi_clk_conf_t | Datafields for static SPI clock configuration values |
Cspi_conf_t | SPI configuration structure type |
Cspi_dev_t | SPI device configuration |
Cspi_gpio_mode_t | SPI gpio mode |
CSPIClass | Arduino SPI interface |
Cspidev_linux_conf | Static runtime configuration for SPI port + CS line |
Cspidev_linux_state | Dynamic runtime state for SPI port + CS line |
Cspiffs_desc | This contains everything needed to run an instance of SPIFFS |
CSPISettings | Arduino SPI configuration interface |
Csps30_data_t | Set of measured particulate matter values |
Csps30_params_t | SPS30 device parameters |
Csps30_t | SPS30 device instance |
Csrf02_t | Device descriptor for SRF02 sensors |
Csrf04_params_t | GPIO pins for srf04 device |
Csrf04_t | Device descriptor for srf04 sensor |
Csrf08_params_t | Device initialization parameters |
Csrf08_t | Device descriptor for SRF08 sensors |
Cstatvfs | File system information |
Cstm32_usb_otg_fshs_config_t | Stm32 USB OTG configuration |
Cstm32_usb_otg_fshs_t | Stm32 USB OTG peripheral device context |
Cstmpe811_params_t | Device initialization parameters |
Cstmpe811_t | Device descriptor for the STMPE811 sensor |
Cstmpe811_touch_position_t | Touch position structure |
Csuit_component_t | SUIT component struct as decoded from the manifest |
Csuit_condition_params_t | SUIT condition parameters |
Csuit_manifest_t | SUIT manifest struct |
Csuit_param_ref_t | SUIT parameter reference |
Csuit_storage | Generic storage backend state |
Csuit_storage_driver | SUIT storage backend driver struct |
Csuit_storage_flashwrite_t | Riotboot flashwrite SUIT storage context |
Csuit_storage_ram_region_t | Single in-memory storage region |
Csuit_transport_mock_payload_t | Mock payload |
Csx127x_internal_t | SX127X internal data |
Csx127x_lora_settings_t | LoRa configuration structure |
Csx127x_params_t | SX127X hardware and global parameters |
Csx127x_radio_settings_t | Radio settings |
Csx127x_t | SX127X device descriptor |
Csys_mbox_t | Platform specific mailbox type |
Ctc32_conf_t | Timer device configuration |
Ctc_tcc_cfg_t | Common configuration for timer devices |
Ctcp_hdr_opt_t | TCP option field helper structure |
Ctcp_hdr_t | TCP header definition |
Ctcs37727_data_t | Struct for storing TCS37727 sensor data |
Ctcs37727_params_t | TCS37727 configuration parameters |
Ctcs37727_t | Device descriptor for TCS37727 sensors |
CThread | Thread struct within mqtt paho |
CTimer | Struct to get time references within mqtt paho |
Ctimer_conf_t | Timer configuration |
Ctimer_dev_t | Define timer configuration values |
Ctimer_isr_ctx_t | Default interrupt context entry holding callback and argument |
CTimerEvent_s | Timer object description |
Ctimeval | Definition of struct timeval for the atmega |
Ctimex_t | A timex timestamp |
Ctja1042_trx | Tja1042 CAN trx descriptor |
Ctlsf_size_container_t | Struct to hold the total sizes of free and used blocks Used for tlsf_size_walker() |
Ctmp00x_params_t | Parameters needed for device initialization |
Ctmp00x_t | Device descriptor for TMP00X sensors |
Ctouch_dev | Generic type for a touch device |
Ctouch_dev_driver_t | Generic type for a touch driver |
Ctouch_t | Touch coordinates |
Ctpcon | The tpcon struct |
Ctps6274x_params_t | TPS6274x Configuration struct |
Ctps6274x_t | Device descriptor for the TPS6274x |
Ctrickle_callback_t | Trickle callback function with arguments |
Ctrickle_t | All state variables of a trickle timer |
Ctrx_driver | Generic transceiver driver |
Ctsl2561_params_t | Device initialization parameters |
Ctsl2561_t | Device descriptor for the TSL2561 sensor |
Ctsl4531x_params_t | Device initialization parameters |
Ctsl4531x_t | Device descriptor |
Ctsrb | Thread-safe ringbuffer struct |
CTwoWire | Class definition for the Arduino Wire library implementation |
Cu8x8_riotos_t | Holds RIOT-OS specific peripheral data |
Cuart_conf_t | UART device configuration |
Cuart_half_duplex_dir_t | Half-duplex UART direction management method type |
Cuart_half_duplex_params_t | Configuration for half-duplex UART |
Cuart_half_duplex_t | Descriptor struct for half-duplex UART |
Cuart_isr_ctx_t | Interrupt context for a UART device |
Cuart_regs_t | UART component registers |
Cucg_riotos_t | Holds RIOT-OS specific peripheral data |
Cudp_hdr_t | UDP header |
Cuhcp_hdr_t | UHCP packet header struct |
Cuhcp_push_t | Struct for push packets |
Cuhcp_req_t | Struct for request packets |
Cuint16_una_t | Unaligned access helper struct (uint16_t version) |
Cuint32_una_t | Unaligned access helper struct (uint32_t version) |
Cuint64_una_t | Unaligned access helper struct (uint64_t version) |
Cuniversal_address_container_t | The container descriptor used to identify a universal address entry |
Curi_parser_result_t | Container that holds all results |
Cusb_desc_acm_t | USB CDC ACM descriptor |
Cusb_desc_call_mngt_t | USB CDC call management functional descriptor |
Cusb_desc_cdc_t | Generic USB CDC descriptor |
Cusb_desc_cdcecm_speed_t | USB CDC ECM connection speed change notification |
Cusb_desc_ecm_t | USB CDC ECM descriptor |
Cusb_desc_union_t | USB union descriptor |
Cusb_descriptor_configuration_t | USB configuration descriptor (USB 2.0 spec table 9-10) |
Cusb_descriptor_device_t | USB device descriptor (USB 2.0 spec table 9-8) |
Cusb_descriptor_endpoint_t | USB endpoint descriptor (USB 2.0 spec table 9-13) |
Cusb_descriptor_interface_association_t | USB interface association descriptor (Interface Association Descriptors table 9-Z) |
Cusb_descriptor_interface_t | USB interface descriptor (USB 2.0 spec table 9-12) |
Cusb_descriptor_string_t | USB string descriptor (USB 2.0 spec table 9-16) |
Cusb_req_cdcacm_coding_t | USB CDC ACM line coding setup content |
Cusb_setup_t | USB setup packet (USB 2.0 spec table 9-2) |
Cusbdev | Usbdev device descriptor |
Cusbdev_driver | Usbdev driver functions |
Cusbdev_ep | Usbdev endpoint descriptor |
Cusbdev_mock | Usbdev mock device |
Cusbdev_mock_ep_t | Usbdev mock device endpoint |
Cusbus | USBUS context struct |
Cusbus_cdcacm_device | USBUS CDC ACM context struct |
Cusbus_cdcecm_device | USBUS CDC ECM device interface context |
Cusbus_control_handler_t | Endpoint zero event handler |
Cusbus_control_slicer_t | Helper struct to divide control messages in multiple parts |
Cusbus_descr_gen | USBUS descriptor generator |
Cusbus_descr_gen_funcs_t | USBUS descriptor generator function pointers |
Cusbus_endpoint | USBUS endpoint context |
Cusbus_handler | USBUS handler struct |
Cusbus_handler_driver | USBUS event handler function pointers |
Cusbus_interface | USBUS interface |
Cusbus_interface_alt | USBUS interface alternative setting |
Cusbus_string | USBUS string type |
Cuu | Depending on the desired operation, we view a ‘long long’ (aka quad_t) in one or more of the following formats |
Cuuid_t | UUID layout |
Cuwb_dw1000_t | Device descriptor for the driver |
Cvcnl40x0_params_t | Device initialization parameters |
Cvcnl40x0_t | Device descriptor for the VCNL40X0 sensor |
Cveml6070_params_t | Device initialization parameters |
Cveml6070_t | Device descriptor for the VEML6070 sensor |
Cvfs_DIR | Internal representation of a file system directory entry |
Cvfs_dir_ops | Operations on open directories |
Cvfs_dirent_t | User facing directory entry |
Cvfs_file_ops | Operations on open files |
Cvfs_file_system_ops | Operations on mounted file systems |
Cvfs_file_system_t | A file system driver |
Cvfs_file_t | Information about an open file |
Cvfs_mount_struct | A mounted file system |
Cvims_regs_t | VIMS registers |
Cw5100_params_t | W5100 device descriptor |
Cw5100_t | Device descriptor for W5100 devices |
Cwdt_regs_t | WDT registers |
Cws281x_params_t | Struct to hold initialization parameters for a WS281x RGB LED |
Cws281x_t | Device descriptor of a WS281x RGB LED chain |
Cxbee_l2hdr_t | Data structure for extraction L2 information of received packets |
Cxbee_params_t | Configuration parameters for XBee devices |
Cxbee_t | XBee device descriptor |
Cxtimer | Xtimer timer structure |
Cxtimer_ticks32_t | Xtimer timestamp (32 bit) |
Cxtimer_ticks64_t | Xtimer timestamp (64 bit) |
Czep_hdr_t | ZEP header definition |
Czep_v1_hdr_t | ZEPv1 header definition |
Czep_v2_ack_hdr_t | ZEPv2 header definition (type == Ack) |
Czep_v2_data_hdr_t | ZEPv2 header definition (type == Data) |
Cztimer_base | Minimum information for each timer |
Cztimer_clock | Ztimer device structure |
Cztimer_convert_frac_t | Ztimer_convert_frac frequency conversion layer class |
Cztimer_convert_muldiv64_t | Ztimer_convert_muldiv64 structure |
Cztimer_convert_shift_t | Ztimer_convert_shift frequency conversion layer class |
Cztimer_convert_t | Base type for ztimer convert modules |
Cztimer_mock_t | Ztimer mock clock class |
Cztimer_ops_t | Ztimer backend method structure |
Cztimer_periodic_t | Ztimer periodic structure |
Cztimer_periph_timer_t | Ztimer periph context structure |
Cztimer_t | Ztimer structure |