-
portable-atomic
Portable atomic types including support for 128-bit atomics, atomic float, etc
-
zerocopy
makes zero-cost memory manipulation effortless. We write "unsafe" so you don't have to.
-
embedded-hal
A Hardware Abstraction Layer (HAL) for embedded systems
-
postcard
A no_std + serde compatible message library for Rust
-
rhai
Embedded scripting for Rust
-
elf
A pure-rust library for parsing ELF files
-
brotli-decompressor
brotli decompressor that with an interface avoiding the rust stdlib. This makes it suitable for embedded devices and kernels. It is designed with a pluggable allocator so that the standard…
-
smoltcp
A TCP/IP stack designed for bare-metal, real-time systems without a heap
-
fixed
Fixed-point numbers
-
critical-section
Cross-platform critical section
-
embedded-hal-mock
A collection of mocked devices that implement the embedded-hal traits
-
micromath
Embedded-friendly math library featuring fast floating point approximations (with small code size) for common arithmetic operations, trigonometry, 2D/3D vector types, statistical analysis…
-
embedded-graphics
Embedded graphics library for small hardware displays
-
riscv
Low level access to RISC-V processors
-
probe-rs
A collection of on chip debugging tools to communicate with microchips
-
stm32f4xx-hal
Peripheral access API for STM32F4 series microcontrollers
-
espflash
A command-line tool for flashing Espressif devices
-
defmt
A highly efficient logging framework that targets resource-constrained devices, like microcontrollers
-
rtt-target
Target side implementation of the RTT (Real-Time Transfer) I/O protocol
-
pc-keyboard
PS/2 keyboard interface library
-
semihosting
AArch64, Arm, RISC-V, MIPS32, MIPS64, and Xtensa
-
aarch64-cpu
Low level access to processors using the AArch64 execution state
-
stm32-hal2
Hardware abstraction layer for the STM32 MCUs
-
ssd1306
I2C/SPI driver for the SSD1306 OLED display controller
-
flip-link
Flips the memory layout of embedded programs to protect against stack overflows
-
arbitrary-int
Modern and lightweight implementation of u2, u3, u4, ..., u127
-
embedded-graphics-simulator
Embedded graphics simulator
-
rp2040-hal
Embedded-HAL impl for the rp2040 microcontroller
-
rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
stm32h7xx-hal
Hardware Abstraction Layer implementation for STM32H7 series microcontrollers
-
sntpc
making SNTP requests
-
smlang
A no-std state machine language DSL
-
embassy-nrf
Embassy Hardware Abstraction Layer (HAL) for nRF series microcontrollers
-
nrf-hal-common
details of the nRF HAL crates. Don’t use this directly, use one of the specific HAL crates instead (
nrfXYZ-hal
). -
managed
An interface for logically owning objects, whether or not heap allocation is available
-
tock-registers
Memory-Mapped I/O and register interface developed for Tock
-
embassy-futures
no-std, no-alloc utilities for working with futures
-
embassy-executor
async/await executor designed for embedded usage
-
ux
Implement the following non standard integers: u2, u3, u4, u5, u6, u7, u9, u10, u11, u12, u13, u14, u15, u17, u18, u19, u20, u21, u22, u23, u24, u25, u26, u27, u28, u29, u30, u31, u33…
-
esp-backtrace
Bare-metal backtrace support for Espressif devices
-
imxrt-iomuxc
Pad configuration interface for NXP i.MX RT processors. Part of the imxrt-rs project
-
fugit
Time library for embedded targets with ease-of-use and performance first
-
embedded-storage
A Storage Abstraction Layer for Embedded Systems
-
mbedtls
Idiomatic Rust wrapper for MbedTLS, allowing you to use MbedTLS with only safe code while being able to use such great Rust features like error handling and closures. Building on MbedTLS's focus on embedded use…
-
minicov
Code coverage and profile-guided optimization support for no_std and embedded programs
-
uefi
makes it easy to develop Rust software that leverages safe, convenient, and performant abstractions for UEFI functionality
-
avr-device
Register access crate for AVR microcontrollers
-
stm32-eth
Embedded Rust Ethernet driver for the STM32 MCU series
-
microfft
Embedded-friendly Fast Fourier Transforms
-
disarm64
decoding ARM64 instructions (at least 250 MiB/sec of the decoding speed is delivered on a laptop that is used for development). Here you will also find a utility for generating disassembler/instruction…
-
embedded-sdmmc
A basic SD/MMC driver for Embedded Rust
-
esp-wifi
A WiFi, Bluetooth and ESP-NOW driver for use with Espressif chips and bare-metal Rust
-
speakersafetyd
Speaker protection daemon for embedded Linux systems
-
industrial-io
Linux Industrial I/O (IIO) Support
-
ravedude
easily flash code onto an AVR microcontroller with avrdude
-
ws2812-spi
SPI-based driver for ws2812 leds
-
delog
Deferred logging, an implementation and extension of Rust's standard logging facade
-
rppal
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals
-
nrf-modem
Async modem api for the nRF91xx
-
atat
AT Parser for serial based device crates
-
embassy-time
Instant and Duration for embedded no-std systems, with async timer support
-
embedded-text
TextBox for embedded-graphics
-
northstar
container runtime for Linux targetting embedded systems
-
gd32f1x0-hal
HAL for the GD32F1x0 family of microcontrollers
-
aht20-driver
Rust embedded-hal driver for the AHT20 temperature and humidity sensor
-
ftdi-embedded-hal
embedded-hal implementation for FTDI USB devices
-
esp32-nimble
A wrapper for the ESP32 NimBLE Bluetooth stack
-
sbat
UEFI Secure Boot Advanced Targeting (SBAT) no_std library
-
embassy-sync
no-std, no-alloc synchronization primitives with async support
-
epd-waveshare
An embedded-hal based driver for ePaper displays from Waveshare formerly published as eink-waveshare-rs
-
automotive_diag
Core definitions for various Automotive ECU Diagnostics such as UDS ISO-14229, KWP2000, OBD-II, etc
-
embedded-alloc
A heap allocator for embedded systems
-
wchisp
A command-line implementation of WCHISPTool, for flashing ch32 MCUs
-
adafruit-seesaw
Platform-agnostic implementation for communicating with devices that run the Seesaw firmware
-
biquad
digital second order IIR filtrers, also known as biquads
-
tm1637-gpio-driver
Generic GPIO driver for the TM1637 micro controller, primarily for educational purpose. Doesn't need std-lib and you can choose any GPIO interface/library you want.
-
bme280
device driver for the Bosch BME280 temperature, humidity, and atmospheric pressure sensor and the Bosch BMP280 temperature, and atmospheric pressure sensor
-
svd-vector-gen
process Microcontroller SVD files(e.g. STM32) and generate vector tables and linker scripts.
-
bluerobotics-ping
serves as the entry point for embedding applications using Rust on Blue Robotics's Ping devices family
-
esp-idf-hal
A Hardware abstraction layer for Espressif's ESP family of microcontrollers based on the ESP-IDF framework
-
coap-lite
A lightweight CoAP message manipulation crate, ideal for embedded environments
-
psx
developing homebrew for the Sony PlayStation 1
-
sbi-rt
Runtime library for supervisors to call RISC-V Supervisor Binary Interface (RISC-V SBI)
-
cortex-m
Low level access to Cortex-M processors
-
avr-tester
Framework for testing AVR binaries
-
uwheel
Embeddable Aggregate Management System for Streams and Queries
-
rtthost
RTT (Real-Time Transfer) client
-
lilos
A tiny embedded OS based around Futures and async
-
littlefs2
Idiomatic Rust API for littlefs
-
rlsf
Real-time dynamic memory allocator based on the TLSF algorithm
-
os-terminal
Beautiful terminal emulator on no-std environment
-
itm-parser
A command-line tool to parse and format ITM (Instrumentation Trace Macrocell) output for embedded systems development using probe-rs
-
jep106
A pollable collection of all JEP106 manufacturer codes
-
azure_mgmt_baremetalinfrastructure
generated REST API bindings
-
embedded-nano-mesh
Lightweight mesh communication protocol for embedded devices
-
esp-println
print!
andprintln!
implementations various Espressif devices -
port-expander
Abstraction for I2C port-expanders
-
wasefire-applet-api-desc
Description of the Wasefire applet API
-
device-driver
A toolkit to write better device drivers, faster
-
rhai-dylib
Dylib support for Rhai
-
ltc681x
Client LTC681X battery monitoring family
-
cargo-esp-new
A cargo-new extension for esp8266 chips
-
w5500
IoT Controller implementation
-
usbd-human-interface-device
Batteries included embedded USB HID library for usb-device. Includes concrete Keyboard (boot and NKRO), Mouse, Joystick and Consumer Control implementations as well as support for building your own HID classes.
-
rttmon
RTT monitor for OpenOCD
-
drmemd
Main process of the DrMem control system
-
astarte-device-sdk
that provides communication and pairing primitives to an Astarte Cluster
-
esp-idf-svc
embedded-svc traits for ESP-IDF (Espressif's IoT Development Framework)
-
musb
musb(Mentor USB) regs and
embassy-usb-driver
,usb-device
impl -
nickel-lang-vector
Persistent vectors for Nickel
-
bitbybit
Efficient implementation of bit-fields where several numbers are packed within a larger number and bit-enums. Useful for drivers, so it works in no_std environments
-
n32g4xx-hal
Peripheral access API for N32G4xx series microcontrollers
-
voladdress
easy volatile memory abstraction
-
mpu6050-dmp
Platform-independent I2C driver for MPU6050. Supports DMP usage. Fork of drogue-mpu-6050 which uses only embedded-hal traits (no dependency on embedded-time or drogue-embedded-timer).
-
efm32pg1b-pac
Peripheral access API for Silicon Labs EFM32PG1B microcontrollers
-
lorawan
structures and tools for reading and writing LoRaWAN messages from and to a slice of bytes
-
atsamd-hal
HAL and Peripheral access API for ATSAMD11, ATSAMD21, ATSAMD51, ATSAME51, ATSAME53 and ATSAME54 microcontrollers
-
a653rs
Arinc653 abstraction library for hypervisor independent partition programming
-
include_data
Include typed data directly in your executable
-
imxrt-ral
Register access layer for all NXP i.MX RT microcontrollers
-
defmt-rtt
Transmit defmt log messages over the RTT (Real-Time Transfer) protocol
-
rhai-rand
Random number package for Rhai
-
embedded-websocket
A lightweight websocket library for embedded systems (no_std)
-
xmc4100
Cortex-M peripheral access library
-
ufmt
A (6-40x) smaller, (2-9x) faster and panic-free alternative to
core::fmt
-
microbit
Board support crate for the BBC Micro:bit V1
-
ushell
Embedded shell over serial connection
-
jelly-mem_access
Memory Mapped I/O access library
-
embedded-nal
A Network Abstraction Layer (NAL) for Embedded Systems
-
svdtools
modifying bugs in CMSIS SVD
-
embedded-canvas
Draw anything with ease on the Canvas before drawing it to your small hardware display
-
embedded-cli
CLI with autocompletion, help and history for embedded systems (like Arduino or STM32)
-
wlink
WCH-Link flash tool for WCH's RISC-V MCUs(CH32V, CH56X, CH57X, CH58X, CH59X, CH32L103, CH32X035, CH641, CH643)
-
fdt
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
moondancer
firmware for the Great Scott Gadgets Cynthion USB Test Instrument
-
dmx-rdm
communicating DMX512 (ANSI E1.11) and DMX-RDM (ANSI E1.20) over a RS485 bus by using interchangeable drivers
-
ihex
parsing and generating Intel HEX (or IHEX) objects. This format is commonly used for representing compiled program code and data to be loaded into a microcontroller, flash memory or ROM.
-
sgp30
Platform agnostic Rust driver for the Sensirion SGP30 gas sensor
-
uguid
GUID (Globally Unique Identifier) no_std library
-
ads1x1x
Platform-agnostic Rust driver for the ADS1x1x ultra-small, low-power analog-to-digital converters (ADC). Compatible with the devices: ADS1013, ADS1014, ADS1015, ADS1113, ADS1114 and ADS1115.
-
dot15d4
IEEE 802.15.4 implementation in Rust
-
atsamd21g
Peripheral access API for ATSAMD21G microcontrollers (generated using svd2rust)
-
se05x
Driver for the NXP SE05X
-
eva-lsl
EVA ICS v4 local service launcher
-
teensy4-bsp
Rust-based BSP for the Teensy 4. Part of the teensy4-rs project
-
st7565
Driver for ST7565 based displays
-
dht-pio
A DHT Implementation using PIO (Programmable Input/Output), tested on Rasberry Pi Pico
-
py32f0xx-hal
Peripheral access API for py32F0 series microcontrollers
-
bno055
Bosch Sensortec BNO055 9-axis IMU driver
-
embedded-huffman
A paginated, streaming library for Huffman coding on embedded
-
stm32f3xx-hal
Peripheral access API for STM32F3 series microcontrollers
-
mcp2515
#![no_std]
library for interacting with MCP2515 CAN controller chips -
shared-mem-queue
Single-writer single-reader queues which can be used for inter-processor-communication in a shared memory region
-
usbd-midi
USB MIDI device class implementation for use with usb-device
-
embedded-dht-rs
A driver for interfacing with DHT11, DHT20 (AHT20), DHT22 (AM2302) temperature and humidity sensors, designed for embedded systems
-
flat_device_tree
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
libcsp
Safe and ergonomic Rust API for libcsp on top on libcsp-sys
-
bbqueue
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
binwalk
Analyzes data for embedded file types
-
sx1262
A embedded-hal driver for the Semtech SX1261/2 sub-GHz radio transceiver
-
witchcraft-server-config
Configuration types for witchcraft-server
-
linux-embedded-hal
embedded-hal
traits for Linux devices -
rustsbi
Minimal RISC-V's SBI implementation library in Rust
-
shtcx
Platform agnostic Rust driver for the Sensirion SHTCx series temperature/humidity sensors
-
loreyawen
An encrypted connection for low-datarate networks by piggybacking on LoRaWANs link encryption
-
rpk-firmware
RPK Keyboard firmware
-
vl53l0x
A platform agnostic driver to interface with the vl53l0x (time-to-flight sensor)
-
flaw
Control-law-inspired embedded signal filtering, no-std and no-alloc compatible
-
ili9341
A platform agnostic driver to interface with the ILI9341 (ald ILI9340C) TFT LCD display
-
pn532
protocol implementation
-
rs_ws281x
Wrapper for ws281x library using bindgen to track upstream
-
einvoice
E-Invoice library with language bindings
-
mcp2003a
LIN transceiver driver with embedded-hal traits for no-std environments
-
playdate-rs
Safe Rust bindings for the Playdate SDK C-CPI
-
scpi
SCPI/IEEE488.2 parser library
-
ws2812-esp32-rmt-driver
WS2812 driver using ESP32 RMT
-
riscv-decode
decoding RISC-V instructions
-
ciborium-io
Simplified Read/Write traits for no_std usage
-
r2u2_core
R2U2: A stream-based runtime monitor
-
micropb
Rust Protobuf library targetting embedded systems and no_std environments
-
ruduino
Reusable components for AVR microcontrollers
-
mcp2517
CAN controller
-
hopter
A Rust-based embedded operating system designed to enable memory safe, memory efficient, reliable, and responsive applications
-
max78000-pac
A Peripheral Access Crate for the MAX78000 microcontroller
-
accelerometer
Generic, embedded-friendly accelerometer support, including traits and types for taking readings from 2 or 3-axis accelerometers and tracking device orientations
-
sml-rs
Smart Message Language (SML) parser written in Rust
-
embassy-stm32-plus
embassy-stm32 plus
-
bitfields
Macro for generating flexible bitfields. Useful for low-level code (embedded or emulators).
-
rtic-sync
Synchronization primitives for asynchronous contexts
-
libscd
Rust drivers for various SCD devices such as scd30 and scd4x CO2 sensors
-
authenticode
working with Authenticode (no-std)
-
i2c-character-display
Driver for HD44780-based character displays connected via a I2C adapter
-
postcard-rpc
A no_std + serde compatible RPC library for Rust
-
fixed-slice-vec
FixedSliceVec
is a dynamic length Vec with runtime-determined maximum capacity backed by a slice -
mc-sst25
Microship SST25* flash memory series
-
flipperzero-sys
Flipper Zero
-
usbd-dfu-rt
USB DFU run-time class
-
is31fl3728-rs
Rust embedded driver for is31fl3728 - led-matrix controller
-
dcf77_utils
DCF77 receiver for embedded platforms
-
machine-check
Formal verification tool for digital systems
-
mfrc522
A platform agnostic driver to interface the MFRC522 (RFID reader/writer)
-
rhai-fs
Filesystem package for Rhai
-
aligned-cmov
Fast constant-time conditional moves of aligned bytes
-
memacc
Memory access functions
-
disarmv7
Decodes armv7 instructions in to a rust enum
-
fdcan
STM32 FDCAN peripheral driver
-
zssh
Minimal SSH server for embedded applications
-
huawei-cloud-api-definitions-BMS
Huawei Cloud API definitions, generated from OpenAPI spec
-
stabilizer
Firmware for the Sinara Stabilizer board (STM32H743, Ethernet, PoE, 2 ADCs, 2 DACs)
-
world_magnetic_model
NOAA World Magnetic Model
-
meshtastic
communicating with and configuring Meshtastic devices
-
w5500-hl
Driver for the Wiznet W5500 internet offload chip
-
j1939
SAE J1939 is a set of standards that define how ECUs communicate via the CAN bus in heavy-duty vehicles
-
aps490_pfpu2_mini
Control software for PFPU2 automated brain detection system
-
tcn75a
Embedded HAL driver for accessing TCN75A temperature sensors
-
gpt-parser
GUID Partition Table (GPT) read-only parser. Endian aware and usable against no_std+alloc.
-
dac8568
platform agnostic library for the Texas Instruments DAC8568, DAC8168 and DAC7568
-
smart-leds
device drivers
-
drone-cortexm
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
canadensis
A Cyphal implementation: Node types and re-exports from some other canadensis crates
-
stm32-fmc
Hardware Abstraction Layer for STM32 Memory Controllers (FMC/FSMC)
-
metrics-exporter-scope
Metrics scope exporter
-
std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
u8g2-fonts
A text renderer for embedded-graphics, based on U8g2
-
form
A small script to move inline modules into the proper directory structure
-
serde-csv-core
CSV serialization for no_std crates
-
sensirion-i2c
Common functionality for I2C based sensors from Sensirion
-
esp-hal
Bare-metal HAL for Espressif devices
-
atsame54_xpro
Board Support crate for the SAM E54 Xplained Pro Evaluation Kit
-
stm32f4-staging
Device support crates for STM32F4 devices
-
atsamx7x-hal
HAL and peripheral access API for ATSAME70, ATSAMS70, ATSAMV70, and ATSAMV71 microcontrollers
-
embedded-iconoir
1300+ icons for embedded-graphics, ported from the Iconoir icon pack
-
rmodem
XMODEM (and variants) implementation in no-std Rust
-
max11300
A rust-embedded driver for the MAX11300 ADC/DAC
-
bma423
Rust driver for Bma423 accelerometer
-
spicat
Full-duplex SPI transactions from the command line
-
weather-utils
Set of common and useful weather-related computations
-
embedded-devices
Device driver implementations for many embedded sensors and devices
-
async-io-mini
Async I/O fork for embedded systems
-
tm1637-embedded-hal
A platform agnostic driver to interface with the TM1637 (7-segment LED display) using embedded-hal and embedded-hal-async
-
imxrt-rt
Startup and runtime support for i.MX RT processors
-
simink
是一个嵌入式全系统模拟器, 提供大量的板卡模拟. simink 支持 Windows, macOS and Linux
-
fdt-parser
parsing FDT
-
quadrature-decoder
Pure logic-level implementations of quadrature decoders with support for full-, half- an quad-stepping
-
charlcd
charlcd.c Linux driver (HD44780 et al.)
-
sysfs_gpio
access to GPIOs using the Linux sysfs interface
-
rhai-env
Environment package for Rhai
-
ug_max
Down-top left-right defined font. Seemly design for 5x5 display.
-
waterman
A CLI tool to easily flash code onto AVR microcontrollers using avrdude, enhancing the development workflow for embedded Rust projects
-
nrfxlib
Rust driver for the LTE stack on the Nordic nRF9160
-
atsam4ls2c-pac
Peripheral access crate for the ATSAM4LS2C microcontroller
-
c2a-core
Core of Command Centric Architecture
-
morse-codec
live decoding and encoding of morse code messages. Supports multiple embedded devices and operating systems by being no_std.
-
nmea0183
NMEA 0183 parser targetting mostly embedded devices but not limited to
-
rkaiq
Rockchip RKAIQ bindings for Rust
-
testssl
Highlevel Bindings for TestSSL
-
embedded-jsonrpc
A JSON-RPC 2.0 server implementation for embedded systems
-
fieldset
Struct to enum derivation
-
nsw-types
Implement the following non standard integers: u2, u3, u4, u5, u6, u7, u9, u10, u11, u12, u13, u14, u15, u17, u18, u19, u20, u21, u22, u23, u24, u25, u26, u27, u28, u29, u30, u31, u33…
-
pico-xs
Embedded-SDK for bare-metal development on the RP2040 Raspberry Pi Pico microcontroller
-
uln2003
28BYJ-48 stepper motor with and ULN2003 Driver on any hardware implementing embedded_hal
-
stm32g0xx-hal
Peripheral access API for STM32G0 series microcontrollers
-
embedded-nal-coap
A CoAP server and client implementation built on embedded-nal-async
-
stm32g0-staging
Device support crates for STM32G0 devices
-
deploy-temp-fringe
safe, lightweight userland context switches
-
cmsis-pack
managing CMSIS Packs
-
svd-generator
Converts device information from flattened device tree into an SVD description
-
libpower
containing algorithms commonly used in power electronics systems, targeted for use in embedded systems
-
max32660
Register mappings for the Analog Devices MAX32660 Cortex-M4 microcontroller
-
mcumgr-smp
smp protocol for microcontrollers in pure rust
-
teensycore
A kernel for the teensy4.0 microcontroller
-
embedded-c-sdk-bind-hal
Embedded C SDK bind HAL
-
i2c-multiplexer
An I2C Multiplexer library that supports the PCA9546 and TCA9546A chips
-
enc424j600
Embbeded Rust Ethernet driver for ENC424J600 Ethernet controller with SPI interface
-
embedded-layout
Extend embedded-graphics with simple layout functions
-
tf-asset-loader
loading assets from tf2 data files
-
asm-delay
no_std implementation of embedded-hal DelayMs & DelayUs based on arm::delay
-
cc1101
A platform agnostic driver to interface with the CC1101 (Sub-1GHz RF Transceiver)
-
pmsa003i
Plantower PMSA003I Driver for Embedded HAL
-
urap
Specification and library for the URAP protocol
-
r3
R3-OS: Experimental static component-oriented RTOS for deeply embedded systems
-
fallible_vec
Fallible allocation functions for the Rust standard library’s
Vec
type -
pwm-pca9685
Platform-agnostic Rust driver for the PCA9685 I2C 16-channel, 12-bit PWM/Servo/LED controller
-
cirque-pinnacle
driver for working with Cirque Pinnacle Glidepoint touchpads on embedded systems
-
cd74hc4067
A platform agnostic driver to interface with CD74HC4067
-
ellie_core
Core modules for ellie
-
neobridge-rust
Lets you control neopixels from your PC using a board
-
bxcan
STM32 bxCAN peripheral driver
-
modio-logger
Dbus service
-
sonant
port of the Sonant 4K synth with streaming support
-
lysogeny-broth
Substrate for cellular automata in Rust
-
aarch64-paging
manipulate AArch64 VMSA page tables
-
rs-max31865
Generic driver for the MAX31865 RTD to Digital converter
-
esp-bsp
Rust Bare Metal Board Support Packages for ESP32 related boards with focus on Embassy Async
-
aligned-array
A newtype with alignment of at least
A
bytes -
embassy-stm32
Embassy Hardware Abstraction Layer (HAL) for ST STM32 series microcontrollers
-
va108xx
PAC for the Vorago VA108xx family of microcontrollers
-
arm-gic
A driver for the Arm Generic Interrupt Controller version 3 or 4
-
nvme-driver
nvme driver
-
rotary-encoder-embedded
A rotary-encoder library built with embedded-hal
-
svd2rust
Generate Rust register maps (
struct
s) from SVD files -
avra-rs
Assembler for Microchip AVR Microcontroller family (similar to Atmel)
-
rp235x-hal
Embeded-HAL impl for the RP2350 microcontroller
-
mips-rt
Minimal runtime for MIPS MCU cores
-
sht31
temperature and humidity sensor
-
embedded_cotoutf8
COTO is a library that translates numerical primitives into readable ASCII UTF-8 arrays
-
phidget
Phidget library for Rust
-
rtt-log
Log facade implementation for the Segger RTT protocol
-
format_no_std
Bare metal formatting
-
keypad
Platform-agnostic driver for keypad matrix circuits
-
ms5803-14ba
embedded-hal async driver for the MS5803-14BA pressure sensor
-
trapframe
Handle Trap Frame across kernel and user space on multiple ISAs
-
infrared
remote control library
-
mos-hardware
Hardware register tables and support functions for 8-bit retro computers like the Commodore 64, MEGA65 and others
-
liboptic_edid
Parses EDIDs from raw bytes (in 100% Rust)
-
synctools
Synchronization tools for no_std
-
bitpiece
bitfields for rust
-
mil_std_1553b
MIL STD 1553B message parsing and types
-
renode-run
Run embedded programs in the renode emulator
-
wasefire-store
Key-value store for SLC flash storage
-
w5500-tls
TLS client for the Wiznet W5500 internet offload chip
-
esp32s3
Peripheral access crate for the ESP32-S3
-
ht32f523x2
Peripheral access API for HT32F523x2 microcontrollers
-
piddiy
DIY custom PID controller toolkit
-
pilkki
Flasher tool for Kampela project
-
sx126x
A driver for the SX126X Family of LoRa modems
-
stm32h7
Device support crates for STM32H7 devices
-
embedded-runner
Cargo runner for embedded projects using OpenOCD
-
mcx-pac
Peripheral Access Crate for NXP MCX Series MCUs
-
probe-rs-target
Target description schema for probe-rs
-
emcell
Reserve flash memory regions to safely keep multiple binary and library binaries (cells) on a microcontroller. The cells can call functions from other cells.
-
libertyos_kernel
The kernel for LibertyOS
-
quectel-bg77
Driver for Quectel's BG77 and BG770 eMTC and NB-IoT Modems
-
drmem-api
Traits and types used internally by the DrMem control system
-
jrsonnet-importers
More importers for jrsonnet
-
nostd_structs
Datastructures and algorithms for nostd environments
-
corncobs
COBS encode/decode for Rust no_std targets
-
dot15d4-frame
Frame parsing and building for the dot15d4 crate
-
pca9539
Abstraciton for PCA9539 I/O expander
-
avr-progmem
Progmem utilities for the AVR architectures
-
xmc4500
XMC peripheral library for XMC4500 generated from SVD
-
kaori-hsm
A performant hierarchical state machine library
-
one-wire-bus-2
1-Wire protocol for embedded-hal
-
lcd-ili9341-spi
Embedded_hal driver for ILI9341 SPI LCD, compatible with Waveshare 2,4 inch board
-
hd44780-driver
HD44780 compliant displays with embedded-hal
-
pac55xx-pac
Peripheral Access Crate (PAC) for PAC55XX
-
embedded-io-extras
Additional utilities for embedded-io, including a Cursor type for no_std environments
-
py32-hal
HAL and Embassy support for the Py32 family of microcontrollers
-
hooker
a helper for hooking functions in x64
-
cycle-menu
no-std compatible library to create a menu that can be cycled through and shown with custom input/output
-
typst-embedded-package
Support to embed typst package to the binary
-
rflow-chat
Text protocol for embedded apps
-
ruspiro-lock
Providing Spinlock, Semaphore and mutual exclusive data access for cross core usage on Raspberry Pi
-
sds011-rs
A driver for the SDS011 particle sensor based on embedded-io
-
quadrature-encoder
Hardware-level implementations of drivers for incremental encoders with support for full-, half- an quad-stepping
-
msp430g2553
Peripheral access API for MSP430G2553 microcontroller
-
embassy-net
Async TCP/IP network stack for embedded systems
-
hifmt
Format output without Rust code segment in binary to reduce the ultimate binary size
-
perfect6502-sys
Bindings to perfect6502
-
intx
Defines new integer types with non-standard but fixed sizes
-
it8951
E-Paper driver
-
flipperzero-test
Rust test harness for Flipper Zero
-
rhai-url
Url package for Rhai
-
microbit-clock
clock app for the BBC micro:bit
-
e-write-buffer
A no_std, const-generic,
core::fmt::Write
able buffer -
navigator-rs
serves as the entry point for embedding applications using Rust on Blue Robotics's Navigator
-
lcd1602-driver
A LCD1602 driver
-
mini-backtrace
Backtrace support for no_std and embedded programs
-
atsaml22j
Peripheral access API for ATSAML22J microcontrollers (generated by svd2rust)
-
ndef
#[no_std]
library to implement a NFC Data Exchange Format structures -
dma-api
Trait for DMA alloc and some collections
-
cargo-esp-build
A cargo-build extension for esp8266 chips
-
k1921vk035-pac
The peripheral access crate for k1921vk035
-
debouncing
Debounce keys in an embedded context
-
simp_protocol
simplistic protocol to communicate over serial ports. It supports ack, automated escaping and unescaping of special bytes and checksum error detection.
-
ieee1275
Safe and easy-to-use wrapper for building OpenFirmware/IEEE1275 apps
-
efm32gg12b-pac
Peripheral access API for EFM32GG12B MCU (generated using svd2rust)
-
zigbee-cluster-library
ZigBee cluster library in
no-std
based on the ZigBee Cluster Library Rev 6 Draft 1.0 -
machine-check-avr
formal verification of AVR microcontrollers by machine-check
-
xargo
The sysroot manager that lets you build and customize
std
-
discrete_count
Encapsulate counting for clocks, ab-encoders, etc
-
minimq
A minimal MQTT5 client designed for no_std platforms
-
postcard-schema
Reflection-like schemas for postcard types
-
microflow
A robust and efficient TinyML inference engine
-
ember_os
OS kernel implemented in rust, which has referenced https://os.phil-opp.com/
-
embive
A low-level sandboxing library for RISC-V bytecode
-
buffered-io
Bufferering types for embedded-io
-
liquid_crystal
a customizable library to work with alphanumeric lcd display compatible with the HD44780 controller
-
stm32wb-hci
Bluetooth HCI for the STM32WB family
-
aem10900
Driver crate for the AEM10900 Energy Harvester
-
flight-tracker
ADSB flight tracker
-
max7219
A platform agnostic driver to interface the MAX7219 (LED driver)
-
ble-peripheral-rust
A cross-platform Rust crate for building Bluetooth Low Energy peripherals
-
rp2040-multicore-per-cpu
Enable use of per-core static variables on rp2040
-
stm32g4-staging
Device support crates for STM32G4 devices
-
cody-c
zerocopy codec for encoding and decoding data in no_std environments
-
nrf52833-hal
HAL for nRF52833 microcontrollers
-
bme280-rs
query BME280 sensors over I²C
-
gc9a01-rs
SPI 4-wire driver for GC9A01 display controller
-
quectel-bg9x-eh-driver
Rust embedded-hal driver for the Quectel BG9X cellular modems
-
embedded-heatshrink
port of the heatshrink library for data compression in embedded systems
-
profont
monospace font for use with the embedded-graphics crate
-
atdf2svd
convert Atmel's ATDF files to SVD
-
stackdump-cli
capturing stack dumps
-
treadmill-rs
Common type- and API-definitions for the Treadmill distributed hardware testbed
-
stemma_soil_moisture_sensor
A pure generic I2C crate for the Adafruit STEMMA soil moisture sensor
-
digital_test_runner
Parse and run tests used in hnemann's Digital logic designer and circuit simulator
-
gt911
An embedded touchscreen driver for GT911
-
flipperzero-rt
Flipper Zero
-
printf-compat
printf reimplemented in Rust
-
wyrcan
The Container Bootloader
-
stk8ba58
Driver for the Sensortek STK8BA58 3-axis MEMS Accelerometer
-
msf60_utils
MSF receiver for embedded platforms
-
edge-nal-embassy
edge-nal based on
embassy-net
-
cs4272
Rust I2S driver for the CS4272
-
bitregions
Generate a unit structure to represent a set of bit-regions
-
naked-function
Proc macro implementation of #[naked]
-
memfault-ssf
Supporting crate for the Memfault memfaultd embedded Linux agent
-
sbus-rs
A no_std compatible SBUS protocol parser for embedded systems
-
stm32f7xx-hal
HAL for the STM32F7xx family of microcontrollers
-
atsam4ls8b-pac
Peripheral access crate for the ATSAM4LS8B microcontroller
-
rpi-st7789v2-driver
Raspberry-Pi driver for the ST7789V2 TFT display controller (WaveShare 1.69" 240x280 LCD)
-
interchange
Request/response mechanism for embedded development, using atomics
-
rfm69
A generic rust driver to support RFM69 family wireless chips
-
py32f0
Device support crates for PY32F0 devices
-
mcp25xx
MCP2510, MCP2515 and MCP25625 CAN controller library
-
sbi-spec
Definitions and constants in the RISC-V Supervisor Binary Interface (RISC-V SBI)
-
bobbin-bits
Small bit fields and ranged integers
-
naive-timer
A minimal naive timer for embedded (no_std) platforms
-
rudelblinken-sdk
SDK for developing applications for the rudelblinken platform
-
cobs-rs
A minimal no-std library for doing Consistent Overhead Byte Stuffing
-
nucleo-h743zi
Example programs for nucleo-H743zi and nucleo-H743zi2 boards
-
lilygo-epd47
driver for the LilyGo T5 4.7 inch E-Ink Display (HW-Version V2.3 / ESP32S3)
-
wasefire
High-level Wasefire applet API
-
sensehat-screen
using the 8x8-LED matrix, with RGB565 coloring, on the Raspberry Pi Sense HAT device
-
vs1003-pac
VS1003 audio codec peripheral access crate
-
rtic-monotonics
that provides implementations of the Monotonic trait from rtic-time
-
moving_median
A no-std moving median filter
-
adi-adxl355
An embedded-hal driver for the ADXL355 accelerometer
-
lora-modulation
A definition of LoRa modulation characteristics with minimal external dependencies
-
efm32lg-pac
Peripheral access API for EFM32LG MCU (generated using svd2rust)
-
ufix
Flexible and usable generic fixed-point numeric type
-
tagged-box
Box that uses tagged pointers
-
embed_rs
A template for embedded Rust projects
-
unflappable
A batteries-included embedded-hal InputPin debouncer
-
imxrt-boot-gen
Generate data structures for booting iMXRT processors
-
arduino-run
A cargo runner for Arduino boards
-
signalo
A DSP toolbox with focus on embedded environments
-
northstar-sextant
Northstar is an container runtime for Linux targetting embedded systems
-
lsm303agr
Platform-agnostic Rust driver for the LSM303AGR ultra-compact high-performance eCompass module: ultra-low-power 3D accelerometer and 3D magnetometer
-
rt
A real-time operating system capable of full preemption
-
lp586x
matrix LED driver (supports LP5860, LP5861, LP5862, LP5864, LP5868)
-
xtensa-lx-rt
Minimal startup/runtime for Xtensa LX CPUs
-
button-driver
Advanced button handling crate
-
goolog
no_std-compatible goolog logger and some macros to simplify printing logs
-
own_or_borrow
Unified references to owned or RefCell borrowed data
-
blinkt
Interface for the Pimoroni Blinkt!, and any similar APA102 or SK9822 LED strips or boards, on a Raspberry Pi
-
mk20d7
Peripheral access API for MK20D7 microcontrollers
-
dac_lib_mcp4725
A driver for the MCP4725 DAC module
-
stm32f3-discovery
Board support package for the STM32F3DISCOVERY board
-
moon_script
Fast and simple scripting language based on Rust
-
libiio-sys
Native, unsafe, bindings to the Linux libiio library. Used by industrial-io.
-
mp2667
Platform agnostic Rust driver for the MP2667, highly integrated, single-cell, Li-ion/Li-polymer battery charger IC
-
stm32f469i-disc
Board support crate for the STM32F469 DISCOVERY kit
-
rainmaker
ESP RainMaker Agent
-
scl3300
Driver for the SCL3300 inclinometer
-
ic-mu
Magnetic Off-Axis Absolute Position Encoder driver
-
umm-malloc
A global allocator implementation for embedded systems using the umm_malloc library
-
ws2812-flexio
A neopixel driver based on NXP i.MX RT's FlexIO bus
-
motion
A bare metal physics engine
-
task-stream
a global task executor, run in
no_std
-
embedded-websocket-embedded-io
A fork of the embedded-websockets crate that uses embedded-io-async for async IO
-
eva-sdk
EVA ICS v4 SDK
-
tinydyn
A lightweight dynamic dispatch library
-
embedded-time
Fully defined, inter-operable, ergonomic, and fast human-time units (both duration and rate types) with hardware timer abstraction and software timers
-
hx711
A platform agnostic driver to interface with the HX711 (load cell amplifier and ADC)
-
trenchcoat
JavaScript-ish virtual machine for embedded, LEDs, hot code reload, etc
-
booster
Firmware for the Sinara Booster device (STM32F4, Ethernet, RF power amplifiers)
-
rpk-config
RPK configuration tool
-
defmt-parser
Parsing library for defmt format strings
-
switch-hal
HAL and basic implementations for input and output switches (buttons, switches, leds, transistors)
-
gd32c1x3-hal
HAL for the GD32C1x3 family of microcontrollers
-
drmem-drv-weather-wu
DrMem driver which gets Weather Underground data
-
fringe
safe, lightweight userland context switches
-
uwheel-stats
profiling utility for uwheel
-
lis2dh12
Platform-agnostic Rust driver for the LIS2DH12 accelerometer
-
stepgen
Stepper motor speed ramp generator
-
ice40
An embedded-hal driver for configuration of ice40 FPGA devices
-
memac
A custom memory allocator using slab and buddy allocators
-
gopro-controller
Open source Rust Library for interacting with GoPro Cameras over BLE and WiFi
-
max32660-pac
Peripheral access API for MAX 32660 microcontroller
-
ubus
Work-in-progress: OpenWRT ubus client library in pure Rust
-
scd4x-rs
query SCD4x sensors over I²C
-
at32f4xx-pac
Device support crates for AT32F4 devices
-
tfmt
A tiny, fast and panic-free alternative to
core::fmt
-
ls013b7dh03
Sharp LCD driver for embedded-hal
-
sht4x-ng
Sensirion SHT4x Driver for Embedded HAL 1.0 with optional async support
-
target-gen
A cli tool to create new target files for probe-rs ot of CMSIS-Packs
-
ds1302
A platform agnostic driver to interface with the DS1302 real time clock-calendar
-
prusst
A convenient interface to the UIO kernel module for TI Programmable Real-time Units
-
panic-rtt-target
Logs panic messages over RTT using rtt-target
-
bern-kernel
Preemptive real-time kernel for microcontrollers
-
pulau-rs
allocation-free union-find library for bare metal environments
-
embedded-svc
A set of traits for services higher level than embedded-hal and typically found in embedded microcontrollers with WiFi or BLE support
-
ft6x36
Rust driver for Ft6x36 touch screen
-
sac-base
Base crate of the sac-signal and sac-control crates
-
msp430
Low level access to MSP430 microcontrollers
-
mutex-traits
An abstraction over closure-based mutexes
-
lpc546xx-pac
Device support crates for LPC546XX-PAC devices
-
lpc82x-pac
Low-level register mappings for the NXP LPC82x series of ARM Cortex-M0+ microcontrollers
-
uefi-graphics2
An embedded-graphics display driver for UEFI environments
-
ws2812-nrf52833-pwm
nrf52833 PWM driver for ws2812 leds
-
rnacos-web-dist-wrap
rnacos server's console front-end dist embed wrap project
-
fh101rf
Driver crate for the FH101RF Wake-Up Radio
-
labrador-ldpc
Encoders and decoders for CCSDS LDPC error correcting codes
-
st7920
SPI driver for the ST7920 LCD display controller
-
ens160
driver implementation
-
springql
Open-source stream processor for IoT devices and in-vehicle computers
-
ohms
Electrical units library for embedded targets
-
steami-rs
Board support crate for the STeaMi (steami.cc)
-
option-block
A minimal utility Rust crate for small, fixed-size blocks of optional types
-
shared-bus
Abstraction for sharing a bus between multiple devices
-
spo-rhai
Embedded scripting for Rust
-
mimxrt685s-pac
Peripheral Access Crate for MIMXRT685s devices
-
qingke
Low level access to WCH's QingKe RISC-V processors
-
avrd
Device-specific constants and information for all AVR microcontrollers
-
crossbus
A Platform-Less Runtime-Less Actor Computing Model
-
ds323x
Platform-agnostic Rust driver for the DS3231, DS3232 and DS3234 extremely accurate real-time clocks (RTC)
-
edge-nal
Hosts a bunch of traits which are not yet available in the embedded-nal-async crate
-
uefi-raw
Raw UEFI types and bindings for protocols, boot, and runtime services. This can serve as base for an UEFI firmware implementation or a high-level wrapper to access UEFI functionality from an UEFI image.
-
scalpel-bin
binary modification tool, cut, stitch, replace, sign
-
w5500-dns
DNS client for the Wiznet W5500 internet offload chip
-
dac8564
platform agnostic library for the Texas Instruments DAC8564
-
afe4404
driver for Rust embedded-hal
-
efm32wg-pac
Peripheral access API for EFM32WG MCU (generated using svd2rust)
-
care-script
Input script processing crate for the care tool
-
a121-rs
Rust driver for the Acconeer A121 radar sensor
-
icewrap
Port of Heatshrink to Rust
-
aarch64_sysreg
Address translation of system registers
-
bq34z100
embedded_hal driver for the fuel gauge series bq34z100
-
pimoroni_gfx_pack
Driver for LCD GFX PACK by Pimoroni
-
wake-rs
Wake protocol library written in Rust
-
esp-alloc
A heap allocator for Espressif devices
-
eeprom24x
Platform-agnostic Rust driver for the 24x series serial EEPROMs
-
simavr-ffi
Low-level bindings to simavr
-
ssd1331-async
Async driver for SSD1331-based displays with SPI interface
-
bosch-bme680
A pure rust implementation for the BME680 environmental sensor
-
tinylivecode
a tiny language for embedded live coding
-
is31fl3741
Driver for Lumissil Microsystem's IS31FL3741 IC
-
px4flow_bsp
A board support package for the PX4FLOW optical flow sensor board
-
pio-uart
A software UART implementation for the RP2040 using the PIO feature
-
himpp
Hi3XXX MPP API for Rust bindings
-
embedded-graphics-core
Core traits and functionality for embedded-graphics
-
analog-multiplexer
A platform agnostic driver for 4051 and 4067 series analog multiplexers targetting the Rust embedded-hal
-
buddyalloc
Safe and simple drop-in allocator for Rust running on embedded or bare metal systems (no_std)
-
stm32_i2s_v12x
Driver for I2S communication (using SPI peripherals) for some STM32 microcontrollers
-
ssd1309
display-interface
compatible driver for the SSD1309 OLED display controller -
canadensis_can
A Cyphal implementation: Cyphal/CAN (CAN and CAN FD) transport layer
-
drone-nrf-map-svd
Nordic Semi nRFx SVD to bindings for Drone, an Embedded Operating System
-
ruspiro-arch-aarch64
access to Aarch64 system registers as well as specific usefull aarch64 assembly instructions
-
swm341-pac
Peripheral Access Crate for Synwit's swm341 microcontroller
-
embassy-rp
Embassy Hardware Abstraction Layer (HAL) for the Raspberry Pi RP2040 microcontroller
-
aya-ebpf-cty
Type aliases to C types like c_int for use with bindgen
-
embedded-vintage-fonts
Vintage fonts from embedded-graphics 0.6 back release 0.7
-
orion_cfmt
Format output without Rust code segment in binary to reduce the ultimate binary size
-
persistent-buff
A buffer that stays persistent in ram between boots
-
lfsr
Galois linear feedback shift registers
-
embassy-embedded-hal
Collection of utilities to use
embedded-hal
andembedded-storage
traits with Embassy -
radio-sx128x
Driver for the Semtec sx1280 2.4GHz RF IC
-
ds4432
Platform-agnostic Rust driver for the Maxim DS4432 Dual-Channel, I2C, 7-Bit Sink/Source Current Digital To Analog (DAC) converter
-
ssd1680
Driver for the SSD1680 e-Paper display (EPD) controller, for use with embedded-hal
-
nrf52840-hal
HAL for nRF52840 microcontrollers
-
r3_portkit
writing a port of R3
-
pic32-config-sector
Calculate constant values for PIC32 configuration words
-
emc230x
An async driver for the EMC230x family of fan controllers
-
stm32l0xx-hal
Peripheral access API for STM32L0 series microcontrollers
-
ambiq-apollo4p-pac
Peripheral access API for Ambiq Apollo 4 Plus microcontrollers
-
lpc55-pac
Peripheral access API for NXP LPC55 microcontrollers
-
panic-persist
Persist panic messages in the targets' RAM
-
edge-executor
Async executor suitable for embedded environments
-
alt-stm32f30x-hal
Alternative HAL impl for the STM32F30x family of microcontrollers
-
l293x
Platform agnostic library for the L293 and L293D motor drivers using embedded-hal
-
embedded-registers
Procedural macro for effortless definitions of registers in embedded device drivers
-
hss-tty-flasher
TTY Flasher for PolarFire SoC with HSS bootloader
-
websocket-std
Websocket implementation using std support, focus on microcontrollers and interoperability with other languages like C through the ffi
-
genio
type safe, low level replacement for
std::io
. Supportsno_std
for embedded development, just disable cargo featurestd
. Because of limitations ofstd::io::Error
type,genio
providesRead
and… -
drs-0x01
Easily communicate with Dongbu Robot servomotors Herkulex DRS 0101 and DRS 0201
-
embedded-nal-tcpextensions
Extensions to embedded-nal's TCP parts around the more precise use of the stack's buffers
-
ft6x06-rs
A pure Rust driver for the FT6x06 capacitive touch screen controller
-
modbus_buffer
Circular buffer implementation tailored for Modbus communication in no_std environments
-
gba_env
detecting the environment for GameBoy Advance ROMs (GBA/NDS/mGBA/VBA/gpSP/etc)
-
embedded-io
Embedded IO traits
-
ak09915_rs
interacting with the AK09915 magnetometer
-
a7105
Rust embedded-hal driver for the A7105 2.4GHz FSK/GFSK Transceiver
-
a653rs-xng
a653rs partition library for xng hypervisor
-
mathx
A mathematics library designed to work with no_std
-
mci
MultiMedia Card Interface (SD, MMC, SDIO) implementation using MCI
-
ssd1306-i2c
SSD1306 I2C driver
-
wm8960
Register map and embedded-hal based driver for Wolfson WM8960 Audio Codec
-
wiringx
safe and Rusty bindings to the wiringX library
-
xmc4200
Peripheral access library for XCM4200 ARM Cortex-M
-
atsam4lc8c-pac
Peripheral access crate for the ATSAM4LC8C microcontroller
-
hpm-riscv-rt
Low level access to HPMicro's RISC-V processors
-
kobo
interacting with Kobo devices
-
baryuxn
Uxn stack machine as a no_std library
-
dcmimu
no_std DCM IMU implementation
-
cichlid
A color math library for programming addressable LEDs
-
cc2650
Device support for TI CC2650 microcontrollers
-
cortex-m-log
Logging facilities for Cortex-M processors
-
efm32gg11b-pac
Peripheral access API for EFM32GG11B MCU (generated using svd2rust)
-
pcf8563
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
embedded-midi
embedded hal uart to send and receive midi
-
avr-boot
Self Programming functions for AVR MCUs
-
tiny-led-matrix
direct control of a small monochrome LED display
-
pygamer
Board Support crate for the Adafruit PyGamer
-
imxrt-hal
Hardware abstraction layer for NXP i.MX RT microcontrollers
-
lvgl
LVGL bindings for Rust. A powerful and easy-to-use embedded GUI with many widgets, advanced visual effects (opacity, antialiasing, animations) and low memory requirements (16K RAM, 64K Flash).
-
aarch64_define
aarch64 架构以及一些配置定义
-
gd32f1
Device support crate for GD32F1 devices
-
stm32l4
Device support crates for STM32L4 devices
-
ldproxy
A linker proxy tool
-
lpc55-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
foc
various Field Oriented Control algorithms
-
canopeners
CANOpen client library
-
itla
ITLA (micro laser) non-blocking control library using embedded-hal
-
lps28dfw
Platform-agnostic Rust driver for the LPS28DFW pressure sensor
-
pca9535
PCA 9535 IO-Expander driver using embedded-hal
-
iowarrior-embedded-hal
that provides access to the IOWarrior GPIO, I2C, PWM, SPI and ADC peripherals
-
oorandom
A tiny, robust PRNG implementation
-
atsamv71q21
Peripheral access API for ATSAMV71Q21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
ssd1675
Driver for the SSD1675 e-Paper display (EPD) controller, for use with embedded-hal
-
bitwrap
pack/unpack data into byte array
-
embedded-simple-ui
UI elements (LED, hw switch, etc.) with implementations on top of embedded-hal and embedded-time crates
-
aht10-embedded
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor, tested on Rasberry Pi Pico
-
mlx9064x
interfacing with Melexis MLX9064* thermal cameras
-
sht25
Rust driver for SHT25 temperature/humidity sensor
-
rgbled
driver for controlling RGB LEDs using PWM, with built-in gamma correction
-
rotary-encoder-hal
platform agnostic rotary encoder library using embedded_hal
-
e310x
With svd2rust generated peripherals for Freedom E310 MCU's
-
m95320
Driver for STMicroelectronics M95320 32-Kbit serial SPI bus EEPROM
-
va416xx
PAC for the Vorago VA416xx family of MCUs
-
overlay_macro
A proc-macro for implementing Overlay, to reinterpret a slice of bytes as a bit/byte packed struct
-
cargo-dfu
cargo extension for flashing embedded rust programs via dfu
-
megadrive-sys
Bindings to the Sega Mega Drive (Genesis) hardware
-
fp
Fast & safe fixed-point arithmetic via compile-time checks
-
herkulex-drs-0x01-stm32f1xx
A driver for servomotors Herkulex DRS-0101 and DRS-0201 using USART on stm32f1xx
-
thumb2-stack-size
estimates stack space requirements of thumb2 programs
-
ellie_vm
Ellie VM for running Ellie ByteCode
-
aw2013
Driver for the AW2013 3-Channel LED Controller
-
nmos6502
A no_std compliant NMOS6502 emulator suitable for embedded environments
-
ufmt_float
A rough implementation of a writer for f32 and f64 for ufmt
-
postform_decoder
Decoder for the Postform logging framework, an efficient logging framework for mcu's
-
arm7tdmi_aeabi
proc-macro to put aeabi functions into your code
-
ibus-rs
A no_std compatible IBUS RC protocol parser for embedded systems
-
embedded-ads1220
Embedded Driver for the Texas Instruments ADS1220 ADC
-
cargo-embassy
Get up and running with Embassy in seconds
-
ad9912
1 GHz DDS SPI driver
-
aw-fel
dealing with Allwinner devices in FEL mode, in pure Rust
-
wave
A no-std no-alloc gesture recognition library for low resolution TOF-Sensors
-
air-navigator-rs
serves as the entry point for embedding applications using Rust on Blue Robotics's Navigator
-
ssd1315
OLED driver
-
sgpc3
Rust driver for the Sensirion SGPC3 gas sensor
-
embedded-nrf24l01
A driver for NRF24L01(+) transceivers on embedded-hal platforms
-
tinymqtt
A very tiny no-std MQTT client, mainly for embedded systems
-
nucleo-h7xx
Board support crate for the STMicroelectronics STM32H7 Nucleo-144 boards
-
stockbook
1-bit image embedding at compile time
-
cortex-m-interrupt
Function-like, trait-based interrupt handler registration
-
nrf24l01-commands
Register bitfields and commands for the nRF24L01
-
txmodems
various MODEM file transfer protocols
-
urukul
Sinara Urukul quad 1 GHz DDS driver
-
aws-greengrass-nucleus
aws greengrass nucleus in Rust (unofficial)
-
multi-mono-font
Multi mono font mixed typesetting for embedded-graphics
-
esp32c3
Peripheral access crate for the ESP32-C3
-
drmem-drv-sump
DrMem driver which monitors a sump pump
-
usbd-ethernet
Communication Device Class Network Control Model (CDC-NCM) class for usb-device
-
privilege_level
Quick and simple access to the current privilege level of the CPU
-
adp5360
An async embedded-hal driver for the ADP5360 Power Management IC
-
sparkfun-openlog
A platform-agnostic, embedded-hal driver for the Sparkfun OpenLogger
-
purua
PU-RU-A is a PUre RUst luA implementation (to be)
-
bma400
A platform-agnostic Rust driver for the BMA400 12-bit ultra-low-power 3-axis accelerometer
-
rda5807m
driver for Rust
-
care-ef-scp
SCP effector for the care tool
-
timed-signal
Helper crate for generating time-dependent signals
-
lpc550x
Register mappings for the NXP LPC550x/LPC55S0x family of Cortex-M33 microcontrollers
-
rx8900
device driver for the Epson RX8900SA/CE I2C-Bus Interface Real Time Clock Module
-
rflow
Text protocol for embedded apps
-
embassy-usb-synopsys-otg
embassy-usb-driver
implementation for Synopsys OTG USB controllers -
stm32h7-staging
Device support crates for STM32H7 devices
-
ellie_fmt
Formatter for ellie
-
ssd1322_rs
A no-std async Rust driver for the SSD1322 OLED screen
-
hx711_spi
A platform agnostic driver to interface with the HX711 using SPI
-
embedded-timers
Softwaretimers and -delays (ms/us) based on a Clock implementation
-
ltr303
Platform agnostic Rust driver for the LTR-303 Ambient Light Sensor
-
embedded-msgpack
MessagePack serialization implementation for Rust optimized for embedded/no_std environments
-
heatshrink
A minimal implementation of the heatshrink compression algorithm for no_std environments
-
nstr
A no_std, no_alloc, embedded-friendly string library
-
fdt-rs
A flattened device tree parser for embedded no-std environments
-
sths34pf80
ST STHS34PF80 driver
-
espsign
signing ESP32 firmware images for ESP RSA Secure Boot V2
-
defmt-or-log
Logging macros that forward to either defmt or log
-
mcp3425
Platform agnostic Rust driver for the Microchip MCP3425/6/7/8 ADC
-
itron
Interface to operating systems based on μITRON and its derivatives
-
da14531
Peripheral access crate for the DA14531 microcontroller
-
dtb_parser
no std but alloc depended device tree blob parsing lib
-
one-fpga
One FPGA general traits and types
-
stm32l0x1-hal
Peripheral access API for STM32L0x1 microcontrollers
-
serial-sensors-proto
wire format for transmitting MEMS sensor data and friends
-
embedded-display-controller
Traits for display controllers
-
endian-type-rs
Type safe wrappers for types with a defined byte order
-
vgastream-rs
High level VGA(0xB8000) library in freestanding Rust
-
air001-pac
Peripheral Access Crate for Air001 microcontroller
-
moondancer-pac
A peripheral access crate for the Cynthion Moondancer SoC
-
ape-fatfs
versitile FAT library for embedded systems
-
core_ux
no_std implementation of the non-standard types u/i1..=63
-
simple-fatfs
A simple-to-use FAT filesystem library for Rust (mainly targeted at embedded systems)
-
pac194x
Platform-agnostic Rust driver for the PAC194x 9V, 16-bit power monitor with alerts
-
cargo-n64
Cargo subcommand to build Nintendo 64 ROMs
-
mini-rxtx
serialization and communications for embedded
-
adafruit_nxp
Driver for Adafruit Precision NXP 9-DOF Breakout Board - FXOS8700 + FXAS21002 modules
-
qtest
Connector for working with the QTest socket
-
riscv-rt
Minimal runtime / startup for RISC-V CPU's
-
ogc-rs
wrapper library for devkitPro's libogc
-
relox
ELF32 relocation compression and decompression
-
pdf417
No-std PDF417 encoder
-
robokit
Build custom firmware for simple robotic automation
-
iso7816_tx
ISO7816 Smart Card T=1 Transmission protocol
-
rvideo
Real-time video server for embedded apps
-
edge-net
no_std and no-alloc async implementations of various network protocols
-
sfsm-base
Traits for the sfsm crate
-
hcsr04_async
A no-std driver for the HC-SR04 ultrasonic sensor using async and Embassy
-
hpm-metapac
Peripheral Access Crate (PAC) for all HPM's MCU chips, including metadata
-
lpc81x-pac
Device support crates for LPC81X-PAC devices
-
time-series-filter
Filters such as exponential weighted moving average (IIR LPF)
-
pico-tflmicro-sys
Rust bindings of TensorFlow Lite for Microcontrollers for Raspberry Pi Pico
-
epicinium_keycode
A small utility crate for generating lossy unique ids encoded with base32
-
k64
Peripheral access API for Kinetis K64 microcontrollers
-
rv8803
RTC clock driver for the rv8803 chip via I2C
-
stm32f4
Device support crates for STM32F4 devices
-
sparreal-rt
Sparreal OS Runtime
-
asm6502
A basic 6502 assembler
-
w5500-ll
Low level driver for the Wiznet W5500 internet offload chip
-
noted
creating ELF notes
-
atsam3u4c
Peripheral access API for ATSAM3U4C microcontrollers (generated using svd2rust)
-
efm32gg-pac
Peripheral access API for EFM32GG MCU (generated using svd2rust)
-
cstream
libc::FILE
streams ‘c streams’ -
urpc
uRPC (pronounced micro RPC) is a simple and lightweight RPC framework designed with embedded systems in mind
-
defmt-test
A test harness for embedded devices
-
cu40026
display driver for the CU40026 vacuum fluorescent display (VFD)
-
ws2811-spi
SPI-based driver for ws2811 chips
-
allocvec
A vector type that preserves the index of every inserted element
-
panic-probe
Panic handler that exits
probe-run
with an error code -
encoded_pin
Binary encoded OutputPin, e.g. for encoded SPI chip select
-
tdc1000
no_std driver for the TDC1000 Ultrasonic Sensing Analog Front End
-
atsam3n00b
Peripheral access API for ATSAM3N00B microcontrollers (generated using svd2rust)
-
ft6x06
A platform agnostic driver for the FT6x06 type touch panel controller used on STM32F4 series board
-
esp32-wroom-rp
Rust-based Espressif ESP32-WROOM WiFi driver crate for RP2040 series microcontroller boards
-
modio-logger-db
modio-logger Dbus service
-
fring
Lightweight, no_std, and *fast* ring buffer
-
lc3-codec
LC3 audio codec for embedded systems (no_std)
-
ieee802_3_miim
abstractions for the IEEE 802.3 Media Indepedent Interface, providing access to registers defined in the standard, and with optional implementations of this abstraction for commonly used PHYs
-
w5500-mqtt
MQTT client for the Wiznet W5500 internet offload chip
-
spwm_generator
cli tool for genrate SPWM lookup tables
-
at24cx
A rust-embedded async driver for the Atmel AT24Cx eeprom storage family
-
imxrt-dcd
Device Configuration Data (DCD) generator for i.MX RT1060 series firmware images
-
rtforth
Forth implemented in Rust for realtime application
-
armv7
Low level routines for the armv7 instruction set with VMSA
-
sogi_pll
SOGI-PLL imlementation
-
lis2dtw12
no_std library for the LIS2DTW12 dual motion and temperature sensor using embedded-hal traits
-
hdc302x-async
An embedded-hal-async driver for the HDC302x(-Q1) low-power humidity and temperature digital sensor
-
ad9850
Embedded driver for the AD9850 DDS synthesizer chip
-
ina226-tp
Rust Driver for device INA226 High-Side or Low-Side Measurement, Bi-Direcional Current and Power Monitor
-
embedded-ads111x
ADS111x 16bit ADCs I2C rust driver no_std
-
font_7seg
7セグメントLED風数字フォント
-
adxl345-eh-driver
Rust embedded-hal device driver for the ADXL345 Analog Devices Digital Accelerometer
-
pt-rtd
Calculation of resistance and temperature for platinum type RTDs, e.g. PT100.
-
pcie
driver for enumerating devices
-
a121-sys
Raw bindings to the A121 radar sensor C SDK
-
avr
AVR emulator
-
satrs-mib
Helper crate of the sat-rs framework to build a mission information base (MIB) from the On-Board Software (OBSW) code directly
-
arducam-legacy
Driver for Arducam legacy cameras based on embedded-hal
-
stm32f3xx-hal-v2
Peripheral access API for STM32F3 series microcontrollers
-
do_syscall
raw syscall
-
femtopb-build
A code generator for
femtopb
-
critical-section-lock-mut
Provide locks for mutable data using
critical-section
crate -
adxl345_driver2
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
ArmlabRadio
interfacing with CC1200 Radios
-
bit_op
Bit manipulation
-
arm-gic-driver
A driver for the Arm Generic Interrupt Controller version 1-4
-
klaptik
Experimental UI rendering framework for LCD/OLED displays
-
drive_74hc595
Drive for IC 74HC595 Shift Register
-
lcd1602rgb-rs
Native Rust driver for the waveshare LCD1602-RGB display module
-
atsams70n21
Peripheral access API for ATSAMS70N21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
oxide-spark
enables sensor sampling & LED strips control over Wifi/MQTT on ESP Rust Board
-
quad-compat-rhai
Embedded scripting for Rust
-
drogue-http-client
An HTTP client for embedded devices, based on drogue-network
-
dp32g030
Peripheral Access Crate for the DP32G030 microcontroller
-
yogurt-yaml
Get embedded yaml from yogurt files
-
msp430fr247x
Peripheral access crate for TI MSP430FR247x microcontroller
-
mju-bits
no_std typed bitfield access for u8, u16, u32 and u64
-
il0373
Driver for the IL0373 e-Paper display (EPD) controller, for use with embedded-graphics
-
diff-in-place
A no_std, zero-copy, in-place diff trait for constant sized arrays
-
atsam3n4b
Peripheral access API for ATSAM3N4B microcontrollers (generated using svd2rust)
-
chademo-rs
An embedded-hal crate for bi-directional CHAdeMO EV charging based on IEEE Std 2030.1.1-2021
-
sega-controller
Embedded driver for reading Sega controller input
-
rustos
Writing an OS in Rust
-
uart8250
provide a struct with many methods to operate uart 8250
-
avr-libcore
Minified version of libcore for AVR
-
lorawan-device
LoRaWAN device stack implementation
-
menmos-antidns
Menmos Embedded DNS Server
-
spl06-007
Driver for the SPL06-007 barometric pressure sensor
-
backlash
processor for signal conditioning
-
sx1509-eh
An embedded-hal focused driver for the SX1509 GPIO expander
-
fullhouse
statically-allocated deque
-
svisual
Base Rust structures and traits for SVisual client
-
is31fl3193
I2C driver for the IS31FL3193 RGB LED driver
-
cloudmqtt
A pure Rust MQTT client and server library
-
stm32f1-staging
Device support crates for STM32F1 devices
-
bounced
Debouncing and Testing for Signals and Buttons
-
pollster-lite
“we have
pollster
at#![no_std]
home” -
afe4400
An
embedded-hal
compatible driver for the TI AFE4400 pulse oximetry analog front-end chip -
lcd_1602_i2c
I2C character LCD displays that use the AiP31068L chip with embedded-hal
-
tm16xx
Embedded drivers for TM16xx display controllers
-
stm32ral
Register access layer for all STM32 microcontrollers
-
ramlink
RAM-based, producer-consumer, one-way communication for microcontrollers, using a ring buffer
-
retro-display
Embedded display drivers for retro computers
-
unmp
-
cic-fixed
CIC filter implementation for fixed point numbers
-
interrupt
-
msp430-atomic
Atomic operations for MSP430 microcontrollers
-
canadensis_filter_config
Automatic receive filter configuration for Cyphal
-
stm32h5-staging
Device support crates for STM32H5 devices
-
l0g
Opinionated l0gging facade meant for the no_std libraries
-
thermostat-eem
Firmware for the Sinara Thermostat-EEM temperature controller
-
cty
Type aliases to C types like c_int for use with bindgen
-
lora-phy
A LoRa physical layer implementation enabling utilization of a range of MCU/LoRa board combinations within embedded frameworks supporting embedded-hal-async
-
ruspiro-error
Definition of the Error trait and error handling related types to make error handling more convinient. This is some kind of the duplicate of the rust
std::error::*
stuff which does not work in ``#… -
atsame70q21b
Peripheral access API for the ATSAME70Q21B MCU from Microchip (generated using svd2rust 0.28.0)
-
tinybmp
No-std, low memory footprint BMP image loader
-
AT42QT2120
Platform agnostic Rust driver for the AT42QT2120
-
sx127x_lora
A platform-agnostic driver for Semtech SX1276/77/78/79 based boards
-
atsam3sd8b
Peripheral access API for ATSAM3SD8B microcontrollers (generated using svd2rust)
-
atsam3s1b
Peripheral access API for ATSAM3S1B microcontrollers (generated using svd2rust)
-
atsam3a4c
Peripheral access API for ATSAM3A4C microcontrollers (generated using svd2rust)
-
atsam3a8c
Peripheral access API for ATSAM3A8C microcontrollers (generated using svd2rust)
-
atsam3u2e
Peripheral access API for ATSAM3U2E microcontrollers (generated using svd2rust)
-
atsam3x8h
Peripheral access API for ATSAM3X8H microcontrollers (generated using svd2rust)
-
atsam3u1c
Peripheral access API for ATSAM3U1C microcontrollers (generated using svd2rust)
-
atsam3s1a
Peripheral access API for ATSAM3S1A microcontrollers (generated using svd2rust)
-
ma734
Platform agnostic Rust driver for the MA734, digital angle sensor that detects the absolute angular position of a permanent magnet
-
tca62724fmg
RGB LED driver for embedded hal
-
canopen_rust
A CANOpen implementation for Rust
-
mcp4728
Platform agnostic rust driver for the MCP4728 4-channel, 12-bit I2C DAC
-
bmp280-driver
A platform agnostic driver to interface with the BMP280 pressure sensor
-
atsam3n2b
Peripheral access API for ATSAM3N2B microcontrollers (generated using svd2rust)
-
tmc5072
A TCM5072 driver compatible with
embedded-hal
-
arm_gicv2
ARM Generic Interrupt Controller version 2 (GICv2) register definitions and basic operations
-
can-bit-timings
procedural macro to calculate CAN bus timings
-
embassy-net-tuntap
embassy-net driver for Linux TUN/TAP interfaces
-
r3_port_riscv
RISC-V port for the R3-OS original kernel
-
lis3dh-spi
no_std driver for the ultra-low-power high-performance 3-axis "nano" accelerometer LIS3DH using SPI
-
unmp-link-serial
serial link for unmp
-
honeycomb
A portable parser combinator library that does not require a runtime
-
arrform
String formatting without memory allocator
-
volatile-mem
managing volatile memory
-
embedded-threadsafe
safe global or thread-local cells for embedded devices
-
bfcore
An interpreter for BrainF*ck without std or alloc
-
ubench
stopgap rust benchmarking solution for microcontrollers
-
bm1397-protocol
Rust protocol driver for the BM1397 Bitcoin Mining ASIC
-
gpio
Fast GPIO interfaces for Linux
-
apu_pcengines_hal
A safe wrapper around the direct memory interface of the APU2+ hardware
-
mk20d7-hal
HAL for the MK20D7 family of microcontrollers
-
yaxpeax-avr
AVR instruction set decoder for yaxpeax
-
bmp280-core
Driver for BMP280
-
esp32s2
Peripheral access crate for the ESP32-S2
-
w7500x-pac
Peripheral Access Crate for Wiznet's W7500x microcontrollers
-
hmc5983
magnetometer driver for embedded hal
-
starb
STAtic Ring Buffers
-
unid
Automate device security provisioning with edge intelligence
-
atsams70q20b
Peripheral access API for the ATSAMS70Q20B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70q21b
Peripheral access API for the ATSAMS70Q21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsame70j20b
Peripheral access API for the ATSAME70J20B MCU from Microchip (generated using svd2rust 0.28.0)
-
on-off-sequence-output
Sends a sequence of on/off states to a GPIO Pin
-
freertos-sys
Builds FreeRTOS from source for specific device families and provides easy linking
-
r3_port_arm
Armv7-A port for the R3-OS original kernel
-
mcp23017
driver for the MCP23017 (16-Bit I2C I/O Expander with Serial Interface)
-
unmp-protocol-raw
raw protocol for unmp
-
stackdump-core
stack dump definitions
-
dht11
Platform-agnostic Rust driver for the DHT11 temperature and humidity sensor
-
megatiny_hal
A hardware abstraction layer for attiny and atmega avr devices
-
usbd-ctaphid
usb-device driver for CTAPHID
-
flash-algorithm
write CMSIS-DAP flash algorithms for flashing embedded targets
-
rpk-common
RPK common fields between config tool and firmware builder
-
atsamv70q19b
Peripheral access API for the ATSAMV70Q19B MCU from Microchip (generated using svd2rust 0.28.0)
-
adafruit-bluefruit-protocol
A
no_std
parser for the Adafruit Bluefruit LE Connect controller protocol -
m24c64
A rust-embedded driver for the STMicroelectronics M24C64(-D) EEPROM
-
atsam3s2b
Peripheral access API for ATSAM3S2B microcontrollers (generated using svd2rust)
-
periphery
peripheral I/O (GPIO, PWM, SPI, I2C, MMIO) in Linux
-
defmt-ringbuf
defmt persistent ring buffer logger
-
atsam3s1c
Peripheral access API for ATSAM3S1C microcontrollers (generated using svd2rust)
-
atsam3s4a
Peripheral access API for ATSAM3S4A microcontrollers (generated using svd2rust)
-
atsam3u2c
Peripheral access API for ATSAM3U2C microcontrollers (generated using svd2rust)
-
atsam3n00a
Peripheral access API for ATSAM3N00A microcontrollers (generated using svd2rust)
-
atsam3n4a
Peripheral access API for ATSAM3N4A microcontrollers (generated using svd2rust)
-
atsam3n2a
Peripheral access API for ATSAM3N2A microcontrollers (generated using svd2rust)
-
rt-xenomai
xenomai
-
daisy
A board support package for the Electro-Smith Daisy Seed and Patch SM
-
gpt-partition
GptPartitionCursor implements the Read + Write + Seek + Debug. It's used for backing up or restoring partition images, such as in embedded upgrades.
-
seminix
内核标准库
-
atsam3s4c
Peripheral access API for ATSAM3S4C microcontrollers (generated using svd2rust)
-
atsam3s4b
Peripheral access API for ATSAM3S4B microcontrollers (generated using svd2rust)
-
atsam3x4c
Peripheral access API for ATSAM3X4C microcontrollers (generated using svd2rust)
-
p9813
RGB controller
-
atsam3n0b
Peripheral access API for ATSAM3N0B microcontrollers (generated using svd2rust)
-
lsm6dsox
Platform-agnostic embedded-hal driver for the ST LSM6DSOX iNEMO inertial module
-
p256-cortex-m4-sys
Low-level bindings to P256-Cortex-M4
-
dac5578
Texas Instruments DAC5578 Driver for Rust Embedded HAL
-
static-alloc
A bump allocator on static memory for the alloc-traits crate
-
fs1027-dg-hal
FS1027-DG Gas Flow Sensor Module driver for no_std embedded-hal
-
scd30pi
Interfaces the SCD30 i2c CO2, temperature and humidity sensor from Sensirion for Raspberry Pi
-
embassy-traits
-
atsams70n21b
Peripheral access API for the ATSAMS70N21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsame70q19b
Peripheral access API for the ATSAME70Q19B MCU from Microchip (generated using svd2rust 0.28.0)
-
deforest
efficient
#![no_std]
parser for devicetree blobs -
ape-table-trig
implementations of sin, cos, and tan using precalculated tables
-
mks979b
no_std driver for the MKS 979B Atmosphere to Vacuum Transducer. Based on the embedded-hal traits.
-
kc11b04
Driver for the KC11B04 4-button analog keypad
-
zg-co2
ZyAura CO₂ sensor protocol implementation
-
atomic-polyfill
Atomic polyfills, for targets where they're not available
-
a800xl-utils
misc utilities for mos-a800xl-none target (Atari 800XL/XE)
-
avr-vm
VM with JIT-compiler for ATMega32
-
dcc-rs
NMRA Digital Command Control for driving model trains
-
s32k118-pac
Device Support Crate for NXP S32K118 Devices
-
smolusb
An experimental lightweight library for implementing USB on embedded systems
-
defmt-itm
Transmit defmt log messages over the ITM (Instrumentation Trace Macrocell) stimulus port
-
smbus-request-parser
Parse SMBus requests. Register functions to call for each type of write/read request. Agnostic regarding polling, irq, dma usage.
-
platform-switch
Namespace facades for switching between platforms
-
usbd-blaster
USB Blaster for Embedded Devices
-
atsamv71n20b
Peripheral access API for the ATSAMV71N20B MCU from Microchip (generated using svd2rust 0.28.0)
-
crc8-rs
A heapless no-std library for doing 8-bit cyclic redundancy checks
-
pac22
Device support crates for PAC22 devices
-
mt9v034-i2c
mt9v034 image sensor two-wire programming driver
-
swap-n
an n argument extension to std::mem::swap
-
minimult_cortex-m
A minimal multitask library, or RTOS, for Cortex-M microcontrollers
-
pimoroni-trackball-driver
embedded driver for the pimoroni trackball
-
wpilib-sys
FRC's WPILib system bindings for rust
-
tm1637
A platform agnostic driver to a LED-display powered by the TM1637 chip
-
embedded-controls
Based on switch-hal library that allows to handle primitive controls(buttons, encoders and etc.)
-
xs-lib
command-line tool (xs) and a Rust library (xs_lib) for recording and retrieving sequential streams of payloads. It uses Lightning Memory-Mapped Database (LMDB) for local data storage.
-
max7797x-driver
An embedded async driver for the MAX77975/MAX77976 battery charger
-
rak-rui3-eh-driver
Rust embedded-hal driver for the RAK LoRaWAN modules running RUI3 firmware in AT mode
-
rust-forth-compiler
A Forth compiler written in Rust
-
sae-j1939
both embedded and non-embedded use cases
-
mavlink-bindgen
used by rust-mavlink
-
atsame70n21b
Peripheral access API for the ATSAME70N21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70j20b
Peripheral access API for the ATSAMS70J20B MCU from Microchip (generated using svd2rust 0.28.0)
-
apds9253
Driver for APDS9253 light sensor
-
arm_pl011
ARM Uart pl011 register definitions and basic operations
-
lp50xx
platform agnostic library for the Texas Instruments LP50XX led driver
-
msp430-rt
Minimal runtime / startup for MSP430 microcontrollers
-
ogc-sys
Rust bindings for devkitPro's libogc
-
phm
Pretty HAL Machine
-
lvgl-sys
Raw bindings to the LVGL C library
-
mimxrt500-bootstub
Glue code to make cortex-m-rt work with NXP i.MX RT500 series chips when booting from FlexSPI NOR flash
-
stuw81300
An embedded-hal driver for the STuW81300
-
embedded-i2s
An embedded Inter-IC Sound (I2S) abstraction layer
-
atsamv70n19b
Peripheral access API for the ATSAMV70N19B MCU from Microchip (generated using svd2rust 0.28.0)
-
ltc690x
driver crate for LTC690x serial programmable oscillator
-
drogue-boot
A cortex-m bootloader toolkit
-
nucleo-l031k6-bsp
Board support crate for the ST L031K6-NUCLEO
-
picotoml
A
no_std
TOML deserializer build for embedded systems. Can be used without an allocator -
rhai_codegen
Procedural macros support package for Rhai, a scripting language and engine for Rust
-
microasync-util
very small async runner
-
mimxrt600-fcb
Flash Configuration Block for MIMXRT600 devices
-
atsam3s8b
Peripheral access API for ATSAM3S8B microcontrollers (generated using svd2rust)
-
nrf-modem-nal
An embedded-nal implementation for the nrf9160 modem
-
lpc55s6x-pac
Peripheral access API for NXP LPC55s6x microcontrollers
-
ads122x04
Platform-agnostic driver for the ADS122C04 and ADS122U04 analog to digital converters
-
seeed-erpc
Driver crate for interacting with seeed-studio eRPC Wifi devices
-
midi-stream-parser
Parser to convert bytes from a MIDI stream into messages
-
apds9960
Platform-agnostic Rust driver for the APDS9960 digital proximity, ambient light, RGB and gesture sensor
-
nuki-backend-hifb
A HiFB + HiTDE drawing backend for the Nuki 2D immediate GUI library
-
mii
A rust-embedded implementation of the monome ii protocol
-
rp2040-panic-usb-boot
On panic, boot to USB mode implemented in ROM
-
huber-pilot-one
huber Pilot ONE library
-
emc2101
Platform-agnostic Rust driver for the EMC2101 temperature sensor and fan sensor/controler
-
libalgobsec-sys
Unsafe bindings to the Bosch BSEC library
-
cargo-ruspiro-push
Cargo tool to push new RusPiRo Kernel's from the development machine (PC) to the Raspberry Pi if connected through a serial port
-
one-wire-bus
1-Wire protocol for embedded-hal
-
device-register-async
A
no_std
library to describe the registers permissions of a device to ease async driver development -
vorago-reb1
Board Support Crate for the Vorago REB1 development board
-
hds
Heapless Data Structures for
no_std
environments -
diskio
trait for handling disk IO devices
-
cmsis-rtos2
wrapper for the CMSIS-RTOS2 API, which should be provided by another library, and linked into the consuming library or application
-
bluetooth-hci
Bluetooth HCI
-
micropnm
lightweight, zero-dependency Rust crate for parsing binary PPM image files. It is designed to with minimal memory usage and is suitable for embedded contexts and WebAssembly.
-
spb_rs
Sparkplug-B client library
-
atsamv70q20b
Peripheral access API for the ATSAMV70Q20B MCU from Microchip (generated using svd2rust 0.28.0)
-
gc9a01a
SPI driver for the GC9A01A LCD display controller
-
r3_support_rza1
Supporting package for running R3-OS on Renesas RZ/A1
-
qwiic-button-led
A driver for the SparkFun Qwiic Button LED
-
ezo_i2c_rs
interface to interact with Atlas Scientific Ezo Devices, using the I2C protocol
-
rtic-macros
Procedural macros, syntax parsing, and codegen of the RTIC crate
-
max6955
A platform agnostic driver to interface with MAX6955 LED Display Driver
-
grapple-config
Grapple Robotics' configuration structs and traits for use on embedded-hal projects
-
rpi_embedded
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals. Forked from RPPAL
-
atsamv71q21b
Peripheral access API for the ATSAMV71Q21B MCU from Microchip (generated using svd2rust 0.28.0)
-
bmp388
A platform agnostic driver to interface with the BMP388 pressure sensor
-
krab
minimalistic interpreted programming language written in Rust
-
xtensa-lx106-rt
Low level access for xtensa lx6 processors and peripherals
-
jh71xx-pac
Peripheral access crate for the JH71xx SoCs
-
atsams70n19b
Peripheral access API for the ATSAMS70N19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsame70n20b
Peripheral access API for the ATSAME70N20B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsame70j21b
Peripheral access API for the ATSAME70J21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70j19b
Peripheral access API for the ATSAMS70J19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70q19b
Peripheral access API for the ATSAMS70Q19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsame70q20b
Peripheral access API for the ATSAME70Q20B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70j21b
Peripheral access API for the ATSAMS70J21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsams70n20b
Peripheral access API for the ATSAMS70N20B MCU from Microchip (generated using svd2rust 0.28.0)
-
si70xx
series relative humidity and temperature sensor driver
-
freebsd-embedded-hal
embedded-hal
traits for FreeBSD devices -
lcd_i2c_rs
interfacing with I2C LCDs on the ESP32 using the ESP-IDF HAL
-
atsam3sd8c
Peripheral access API for ATSAM3SD8C microcontrollers (generated using svd2rust)
-
atsam3n2c
Peripheral access API for ATSAM3N2C microcontrollers (generated using svd2rust)
-
atsam3n0c
Peripheral access API for ATSAM3N0C microcontrollers (generated using svd2rust)
-
atsam3s2c
Peripheral access API for ATSAM3S2C microcontrollers (generated using svd2rust)
-
atsam3x4e
Peripheral access API for ATSAM3X4E microcontrollers (generated using svd2rust)
-
atsam3u4e
Peripheral access API for ATSAM3U4E microcontrollers (generated using svd2rust)
-
atsam3n1c
Peripheral access API for ATSAM3N1C microcontrollers (generated using svd2rust)
-
atsam3x8e
Peripheral access API for ATSAM3X8E microcontrollers (generated using svd2rust)
-
atsam3u1e
Peripheral access API for ATSAM3U1E microcontrollers (generated using svd2rust)
-
atsam3n4c
Peripheral access API for ATSAM3N4C microcontrollers (generated using svd2rust)
-
ad5328
A rust-embedded driver for the Analog Devices ad5328 DAC
-
thumby
TinyCircuits Thumby device
-
at42qt1070
Embedded-hal implementation for the AT42QT1070
-
k510-pac
Peripheral access API for Canaan K510 SoC generated from unofficial SVD file
-
atsamv71q19b
Peripheral access API for the ATSAMV71Q19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv70j20b
Peripheral access API for the ATSAMV70J20B MCU from Microchip (generated using svd2rust 0.28.0)
-
ft5336
A platform agnostic driver for the FT5336 touch screen driver used on the STM32F746 Discovery board, built using the embedded-hal
-
asm-delay-embedded-time
no_std implementation of embedded-hal DelayMs & DelayUs based on arm::delay, featuring embedded-time
-
nu-isp
Nuvoton ISP_HID protocol library
-
lpc54606-pac
Low-level register mappings for the NXP LPC54606 series of ARM Cortex-M4 microcontrollers
-
mnemos
A tiny embedded operating system kernel
-
e-ring
A no_std append only ring buffer, when full new element replace oldest one
-
wm8731
HAL for the WM8731 audio codec
-
saelient
SAE-J1939 support library
-
smlang-macros
Procedual macros for the smlang crate
-
not-io
A synthesis between no-std, no-alloc and std::io
-
tmledkey-hal-drv
HAL based driver for Titan Micro 7 segment LED controllers and key scanners
-
allegro-motor-drivers
Allegro microsystems motor controller driver registers
-
smbus-adapter
smbus standardized transfers to i2c devices
-
pid-ctrl
A flexible PID controller
-
s32k144
Peripheral access API for NXP S32K144 microcontrollers (generated using svd2rust)
-
ruperl
embedding perl in your rust project
-
gihex-hc-sr04
access HC-SR04 ultrasonic sensor
-
unsize
A stable alternative to CoerceUnsize
-
coap-zero
CoAP protocol implementation for no_std without alloc
-
max32660-hal
Hardware Abstraction Layer (HAL) for the MAX 32660 microcontroller
-
esp-display-interface-spi-dma
Rust Bare Metal SPI Display Interface with DMA support for ESP32 chips
-
bl61x-pac
Embedded Rust's Peripheral Access Crate for BL616/BL618 microcontrollers
-
stm32g4
Device support crates for STM32G4 devices
-
postcard-dyn
Dynamic ser/de for postcard
-
shiftreg-spi
SPI-based driver for shift registers such as 74HC595 with embedded-hal API
-
clerk
A fully featured hardware agnostic HD44780 LCD controlling library
-
jt808-rs
JT808 protocol
-
axp2101
embedded-hal drivers
-
phm-worker
The Embedded Worker for Pretty HAL Machine
-
microchip-tc72r-rs
A platform agnostic driver to interface with the Microchip TC72 (temperature sensor) through SPI using embedded-hal
-
bmi088
6DOF IMU driver for embedded hal
-
aevum
A CLI utility to calculate timer register values for STM32 microcontrollers
-
mwatch-sdk
A development SDK for applications on the https://github.com/MWatch
-
svm40
Rust driver for the Sensirion SVM40 sensor
-
dwf
Digilent WaveForms library Rust wrapper
-
espup
installing and maintaining Espressif Rust ecosystem
-
atsamv71n21b
Peripheral access API for the ATSAMV71N21B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv70n20b
Peripheral access API for the ATSAMV70N20B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv71n19b
Peripheral access API for the ATSAMV71N19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv71j19b
Peripheral access API for the ATSAMV71J19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv70j19b
Peripheral access API for the ATSAMV70J19B MCU from Microchip (generated using svd2rust 0.28.0)
-
atsamv71q20b
Peripheral access API for the ATSAMV71Q20B MCU from Microchip (generated using svd2rust 0.28.0)
-
usbd-microsoft-os
Microsoft OS USB descriptors for usb-device
-
ufmt-utils
μfmt
utilities -
rkrga-sys
Rockchip RGA FFI bindings for Rust
-
aarch64-std
implementations of standard library components for bare-metal aarch64
-
fchashmap
A fixed capacity no_std hashmap
-
avr-std-stub
Contains simple implementations of required language items that
libstd
normally defines on other targets -
uart_xilinx
provide a struct with many methods to operate uarts in Xilinx's FPGA: XPS UART Lite, AXI UART Lite
-
ea-big
open ea .big game files
-
max7219-canvas
built for rust that makes setting and getting pixels from co-ordinates easy, aswell as handling displaying different layers on top of each other. Works with the max7219 crate on 8x8 matrix displays.
-
bmx055
platform agnostic Rust driver for the BMX055 small, versatile 9-axis sensor module: 3D accelerometer, 3D gyroscope and 3D magnetometer
-
ueight
Helpers for raw AVR programming
-
async-embedded-traits
A set of async traits for embedded systems
-
num_x
Implement the following non standard integers: u1, u2, u3, u4, u5, u6, u7, u9, u10, u11, u12, u13, u14, u15, u17, u18, u19, u20, u21, u22, u23, u24, u25, u26, u27, u28, u29, u30, u31…
-
rwedid
Read and write EDID data over an I2C bus
-
microchip-eeprom-25x
A platform agnostic driver to interface with the Microchip 25xxxx EEPROM through SPI
-
df2301q
Gravity Offline Voice Recognition Module Rust Driver
-
GPS-Gunnlaug_18
individual-assignment 7 in mechatronics 1: Crate up
-
exe2swf
Extract Flash .swf files from Windows .exe files
-
sdio_sdhc
driver to drive sdhc over SDIO, no filesystem, only test stm32f407 board,other stm32f4xx boards have no test
-
max485
embedded-hal driver for operating the MAX485 uart to rs485 module in half duplex mode
-
lvbitfile2rust-cli
Command line entrypoint for the lvbitfile2rust crate
-
blend-srgb
A small,
#![no_std]
-compatible sRGB conversion and blending library designed for performance -
rust-forth-tokenizer
A Forth tokenizer written in Rust
-
mcp4725-async
An async driver for the MCP4725 DAC
-
reg-map
Derive volatile accesses to a register map and memory-mapped IO
-
nu-isp-cli
CLI tool for Nuvoton ISP_HID Bootloaders
-
ke04z4-pac
PAC for NXP Kinetis MKE04Zx microcontrollers
-
mics-vz-89te
driver implementation
-
u32err
A neat error type for FFI functions (where non-zero = failure)
-
hd44780_menu
A menu system for use with the HD44780 display
-
embedded_font
Font rendering (ttf and otf) with embedded-graphics
-
efm32zg222-pac
Peripheral access API for EFM32ZG222 MCU (generated using svd2rust)
-
efm32zg210-pac
Peripheral access API for EFM32ZG210 MCU (generated using svd2rust)
-
efm32zg110-pac
Peripheral access API for EFM32ZG110 MCU (generated using svd2rust)
-
efm32zg108-pac
Peripheral access API for EFM32ZG108 MCU (generated using svd2rust)
-
ht32f1xxxx
Device support crates for HT32F1XXXX devices
-
hvac
hvac controller state machine
-
ambiq-apollo3-pac2
Peripheral access API for APOLLO3 microcontrollers
-
sdp8xx
Platform agnostic Rust driver for the Sensirion SDP8xx differential pressure sensor
-
lcd-pcf8574
Hitachi HD44780-compatible LCD display attached to PCF8574 I2C expander
-
mcf-config-demo-settings
A Proof of Concept
-
embedded-flight-scheduler
Embedded flight real-time scheduler library
-
rart-rs
A async runtime to use the benefits of the availables embedded OS
-
ehlcd2d
embedded-hal driver for HD44780 with async support
-
mallocator
Use malloc() and free() for memory management in Rust
-
i2c-reg
Create registers for reading and writing with I2C interface
-
kernaux-sys
Unsafe no-std binding to libkernaux - auxiliary library for kernel development
-
bitmap-font
Bitmap fonts for the embedded-graphics crate that don't require generics
-
teensy4-selfrebootor
A self-rebooting implementation of teensy's rebootor for teensy4
-
tfmicro
Rust bindings of TensorFlow Lite for Microcontrollers
-
axp20x
Rust driver for axp20x Power Management Unit
-
u8dl
Universal 8bit Device Library for driving monochrome devices like OLEDs and LCDs
-
pololu-smc
A driver for the Pololu Simple Motor Controller G2
-
pebble-rust
Pebble bindings for Rust. See repository for instructions.
-
driver-3461bs-rs
Driver for 3461BS LED driver
-
drv2605l
A platform agnostic driver for the drv2605l haptic driver
-
trinamic
Motion Control Language (TMCL) in Rust
-
r0
Initialization code ('crt0') written in Rust
-
stemma_soil_sensor
reading data from Adafruit STEMMA Soil Sensor
-
senseair
Protocol implementations to communicate with Senseair devices
-
sensirion-rht
Driver for several temperature and humidity sensors from Sensirion
-
cubic-splinterpol
efficient cubic spline interpolation on no_std
-
ht32f2xxxx
Device support crates for HT32F2XXXX devices
-
static-linkedlist
A linked list implementation on a static array. Intended for use in environments without dynamic memory allocation.
-
beepy-display
Embedded graphics DrawTarget for Beepy
-
i3g4250d
A platform agnostic driver to interface the I3G4250D (gyroscope)
-
debounced-pin
A platform-agnostic debounce library. It also adds a wrapper for an
InputPin
that debounces it’sis_high()
andis_low()
methods -
unmp-protocol-etp
etp protocol for unmp
-
rp-binary-info
Code and types for creating Picotool compatible Binary Info metadata
-
anachro-icd
The Interface Control Document for Anachro-PC
-
mcp9600
Basic embedded-hal-based I2C driver for the MCP9600 and MCP9601 thermocouple amplifier ICs
-
embedded-fps
Frames Per Second counter for embedded devices
-
dps422
A platform agnostic driver to interface with the DPS422 barometric pressure & temp sensor through I2C
-
iaq-core
Platform-agnostic Rust driver for the iAQ-Core indoor air quality sensor. Compatible with iAQ-Core-C and iAQ-Core-P.
-
dfr0299
serial protocol for the DFR0299 MP3 player module
-
can_aerospace_lite
A lite version of CAN Aerospace Implementation according to 'Interface specification for airborne CAN applications V 1.7'
-
emb-ssdraw
embedded screen saver that draws random points on a display
-
embeddy
Resource embedding
-
ht32f2yyy
Device support crates for HT32F2YYY devices
-
esp-storage
embedded-storage traits to access unencrypted ESP32 flash
-
si5351
A platform agnostic driver for the Si5351 clock generator
-
bbq10kbd
An Embedded-HAL driver for @arturo182's bbq10kbd PMOD
-
atsam4n8a-pac
Peripheral access crate for the ATSAM4N8A microcontroller
-
riot
RIOT OS bindings for Rust
-
picoborgrev
A controller library for PiBorg's PicoBorg Reverse motor driver board designed for use with the Raspberry Pi
-
sh1122-rppal
A user mode driver for SH1122 (Raspberry PI interface)
-
vfork
vfork-rs is used in embedded low memory to run an external program
-
lc709203
Platform-agnostic Rust driver for the LC709302 battery gauge sensor
-
bq27xxx
(bq27426, bq27427) platform-agnostic driver
-
adc-interpolator
An interpolator for analog-to-digital converters
-
ina219
current/power monitor driver
-
da14531-hal
HAL crate for the DA14531 microcontroller
-
aarch64-arch-helpers
Helper functions to access aarch64 CPU registers
-
stackdump-capture-probe
capturing stack dumps of embedded devices with a debugging probe
-
trallocator
A no_std lbrary for wrapping an existing allocator and tracking the heap usage
-
tsl2591
embedded hal driver for the TSL2591
-
ist7920
SPI driver for the IST7920 LCD display controller
-
drone-tisl-map
Texas Instruments SimpleLink™ peripheral mappings for Drone, an Embedded Operating System
-
max112x
Driver for the 24-bit MAX11214 and similar ADCs
-
drogue-grove-uart-spi
Grove's SPI over UART protocol
-
msp430fr5962
Peripheral access crate for MSP430FR5962 microcontroller
-
mcp23017-tp
Rust Driver for device MCP23017 16-Bit I2C I/O Expander with Serial Interface
-
rn2xx3
Rust driver for Microchip RN2483 and RN2903 LoRaWAN modules. [WIP]
-
bq24195-i2c
I2C driver for Texas Instruments BQ24195 Single Cell Charger
-
ist8310
magnetometer driver for embedded hal
-
monotron-synth
1980's home computer style synthesiser that sounds pretty bad
-
embedded-mqtt
no_std encoder/decoder for MQTT 3.1.1 protocol packets for embedded devices
-
ls7366
Rust interface to the LS7366 quadrature encoder buffer
-
esb
Nordic's Enhanced ShockBurst communication protocol
-
embedded-threads
generic embedded scheduler & IPC
-
nintendo64-pac
A peripheral access crate for the Nintendo 64
-
mini-slcan-ng
Serial Line CAN (SLCAN) protocol decoder/encoder
-
pir-motion-sensor
PIR motion sensors
-
vcgencmd
Bindings for Raspberry Pi's vcgencmd utility
-
tai-time
Nanosecond-precision monotonic clock timestamps based on the TAI time standard
-
is31fl3733
A platform agnostic driver to interface with the IS31FL3733 (16x12 LED Matrix Driver) written in Rust
-
wm8731-another-hal
Thin abstraction for the Cirrus Logic/Wolfson WM8731 audio codec IC
-
keypad2
reading a 3X4 keypad with embedded-hal
-
channel-bridge
Blocking and async Sender and Receiver traits and implementations
-
bmp280-ehal
A platform agnostic driver to interface with the BMP280 pressure sensor
-
hcs-12ss59t
Platform-agnostic embedded-hal driver for Samsung HCS-12SS59T VFD displays
-
bern-conf-type
Bern RTOS configuration type
-
rsportal
A higher-level interface to the Adafruit PyPortal
-
max17320
An embedded hal driver for the MAX17320 (2S-4S ModelGauge m5 Fuel Gauge with Protector, Internal Self-Discharge Detection and SHA-256 Authentication)
-
lpc43xx
Register definitions for the NXP LPC43xx microcontroller platform, generated through svd2rust
-
shared
A macro for safely sharing data between application and interrupt context on cortex-m systems
-
as7331-rs
as7331 driver in Rust for embedded devices
-
bern-conf
Bern RTOS default configuration
-
crosstrait
Cast from
dyn Any
to other trait objects, with no_std, no alloc support -
mcp795xx
A driver for the MCP795xx real time clock. Uses the embedded-hal crate.
-
sparreal-kernel
Sparreal OS kernel
-
adxl355
A platform agnostic driver to interface with the ADXL355 (accelerometer) through SPI
-
cyclone-v
Cyclone V FPGA programming library for Rust
-
synergetic
Minimal tick-based async executor for constrained environments
-
is31fl3743a
Driver for Lumissil Microsystem's IS31FL3743A IC
-
CESE4015_Concurrency_RJN_JVL
This progrmam is a concurrent version of grep. It uses
-
icm20689
ICM-20689 6DOF IMU driver for embedded hal
-
sgp41
Rust driver for the Sensirion SGP41 series. VOC and NOx Sensor.
-
freertos-cargo-build
lib for building & using FreeRTOS in rust projects inside the build.rs
-
metrics-controller
Metrics Controller is a project to collect metrics for Mozilla IOT projects
-
vl53l1x-simple
driver for the VL53l1X TOF ranging sensor
-
monotron-app
Support crate for writing Monotron applications
-
max31855-rs
MAX31855 Cold-Junction Compensated Thermocouple-to-Digial Converter
-
opcua-core
Core components for OPC UA used by client and server
-
embedded-hdc1080-rs
Rust driver for the HDC1080 low-power humidity and temperature digital sensor
-
gpio-expander
A platform-independent driver for interacting with the products GPIO Port Expander (Troyka Module), Troyka HAT and Slot Expander Expansion Board
-
avr-libc
Rust bindings to avr-libc
-
wurth-calypso
Driver for the Würth Elektronik Calypso Wi-Fi radio module
-
efm32tg11b540-pac
Peripheral access API for EFM32TG11B540 MCU (generated using svd2rust)
-
efm32tg11b120-pac
Peripheral access API for EFM32TG11B120 MCU (generated using svd2rust)
-
efm32tg11b340-pac
Peripheral access API for EFM32TG11B340 MCU (generated using svd2rust)
-
efm32tg11b520-pac
Peripheral access API for EFM32TG11B520 MCU (generated using svd2rust)
-
efm32jg12b500-pac
Peripheral access API for EFM32JG12B500 MCU (generated using svd2rust)
-
efm32gg12b310-pac
Peripheral access API for EFM32GG12B310 MCU (generated using svd2rust)
-
efm32gg12b430-pac
Peripheral access API for EFM32GG12B430 MCU (generated using svd2rust)
-
efm32gg11b110-pac
Peripheral access API for EFM32GG11B110 MCU (generated using svd2rust)
-
efm32gg11b820-pac
Peripheral access API for EFM32GG11B820 MCU (generated using svd2rust)
-
efm32tg11b320-pac
Peripheral access API for EFM32TG11B320 MCU (generated using svd2rust)
-
efm32gg12b830-pac
Peripheral access API for EFM32GG12B830 MCU (generated using svd2rust)
-
efm32gg12b530-pac
Peripheral access API for EFM32GG12B530 MCU (generated using svd2rust)
-
efm32jg1b200-pac
Peripheral access API for EFM32JG1B200 MCU (generated using svd2rust)
-
efm32gg12b130-pac
Peripheral access API for EFM32GG12B130 MCU (generated using svd2rust)
-
efm32gg11b520-pac
Peripheral access API for EFM32GG11B520 MCU (generated using svd2rust)
-
efm32gg12b510-pac
Peripheral access API for EFM32GG12B510 MCU (generated using svd2rust)
-
efm32gg11b840-pac
Peripheral access API for EFM32GG11B840 MCU (generated using svd2rust)
-
efm32gg12b390-pac
Peripheral access API for EFM32GG12B390 MCU (generated using svd2rust)
-
efm32tg11b140-pac
Peripheral access API for EFM32TG11B140 MCU (generated using svd2rust)
-
efm32jg1b100-pac
Peripheral access API for EFM32JG1B100 MCU (generated using svd2rust)
-
efm32gg11b320-pac
Peripheral access API for EFM32GG11B320 MCU (generated using svd2rust)
-
efm32gg11b420-pac
Peripheral access API for EFM32GG11B420 MCU (generated using svd2rust)
-
efm32gg11b120-pac
Peripheral access API for EFM32GG11B120 MCU (generated using svd2rust)
-
efm32gg12b810-pac
Peripheral access API for EFM32GG12B810 MCU (generated using svd2rust)
-
efm32gg12b330-pac
Peripheral access API for EFM32GG12B330 MCU (generated using svd2rust)
-
efm32gg12b410-pac
Peripheral access API for EFM32GG12B410 MCU (generated using svd2rust)
-
efm32gg12b110-pac
Peripheral access API for EFM32GG12B110 MCU (generated using svd2rust)
-
efm32wg942-pac
Peripheral access API for EFM32WG942 MCU (generated using svd2rust)
-
efm32wg995-pac
Peripheral access API for EFM32WG995 MCU (generated using svd2rust)
-
efm32wg232-pac
Peripheral access API for EFM32WG232 MCU (generated using svd2rust)
-
efm32wg295-pac
Peripheral access API for EFM32WG295 MCU (generated using svd2rust)
-
efm32lg290-pac
Peripheral access API for EFM32LG290 MCU (generated using svd2rust)
-
efm32lg330-pac
Peripheral access API for EFM32LG330 MCU (generated using svd2rust)
-
efm32lg900-pac
Peripheral access API for EFM32LG900 MCU (generated using svd2rust)
-
efm32lg295-pac
Peripheral access API for EFM32LG295 MCU (generated using svd2rust)
-
efm32wg900-pac
Peripheral access API for EFM32WG900 MCU (generated using svd2rust)
-
efm32tg232-pac
Peripheral access API for EFM32TG232 MCU (generated using svd2rust)
-
efm32tg110-pac
Peripheral access API for EFM32TG110 MCU (generated using svd2rust)
-
efm32wg330-pac
Peripheral access API for EFM32WG330 MCU (generated using svd2rust)
-
efm32lg280-pac
Peripheral access API for EFM32LG280 MCU (generated using svd2rust)
-
efm32wg280-pac
Peripheral access API for EFM32WG280 MCU (generated using svd2rust)
-
efm32tg840-pac
Peripheral access API for EFM32TG840 MCU (generated using svd2rust)
-
efm32wg880-pac
Peripheral access API for EFM32WG880 MCU (generated using svd2rust)
-
efm32wg390-pac
Peripheral access API for EFM32WG390 MCU (generated using svd2rust)
-
efm32hg350-pac
Peripheral access API for EFM32HG350 MCU (generated using svd2rust)
-
efm32wg895-pac
Peripheral access API for EFM32WG895 MCU (generated using svd2rust)
-
efm32wg840-pac
Peripheral access API for EFM32WG840 MCU (generated using svd2rust)
-
efm32wg360-pac
Peripheral access API for EFM32WG360 MCU (generated using svd2rust)
-
efm32tg210-pac
Peripheral access API for EFM32TG210 MCU (generated using svd2rust)
-
efm32wg940-pac
Peripheral access API for EFM32WG940 MCU (generated using svd2rust)
-
efm32hg310-pac
Peripheral access API for EFM32HG310 MCU (generated using svd2rust)
-
efm32hg110-pac
Peripheral access API for EFM32HG110 MCU (generated using svd2rust)
-
efm32lg232-pac
Peripheral access API for EFM32LG232 MCU (generated using svd2rust)
-
ina260
A platform agnostic driver to interface with the I2C based TI INA260 power monitor
-
efm32gg880-pac
Peripheral access API for EFM32GG880 MCU (generated using svd2rust)
-
efm32gg395-pac
Peripheral access API for EFM32GG395 MCU (generated using svd2rust)
-
efm32gg980-pac
Peripheral access API for EFM32GG980 MCU (generated using svd2rust)
-
efm32gg900-pac
Peripheral access API for EFM32GG900 MCU (generated using svd2rust)
-
efm32gg842-pac
Peripheral access API for EFM32GG842 MCU (generated using svd2rust)
-
efm32gg940-pac
Peripheral access API for EFM32GG940 MCU (generated using svd2rust)
-
efm32gg995-pac
Peripheral access API for EFM32GG995 MCU (generated using svd2rust)
-
efm32gg230-pac
Peripheral access API for EFM32GG230 MCU (generated using svd2rust)
-
efm32wg980-pac
Peripheral access API for EFM32WG980 MCU (generated using svd2rust)
-
efm32lg840-pac
Peripheral access API for EFM32LG840 MCU (generated using svd2rust)
-
efm32lg942-pac
Peripheral access API for EFM32LG942 MCU (generated using svd2rust)
-
efm32tg825-pac
Peripheral access API for EFM32TG825 MCU (generated using svd2rust)
-
efm32lg360-pac
Peripheral access API for EFM32LG360 MCU (generated using svd2rust)
-
efm32hg322-pac
Peripheral access API for EFM32HG322 MCU (generated using svd2rust)
-
efm32wg230-pac
Peripheral access API for EFM32WG230 MCU (generated using svd2rust)
-
efm32wg890-pac
Peripheral access API for EFM32WG890 MCU (generated using svd2rust)
-
efm32tg225-pac
Peripheral access API for EFM32TG225 MCU (generated using svd2rust)
-
efm32lg395-pac
Peripheral access API for EFM32LG395 MCU (generated using svd2rust)
-
efm32tg842-pac
Peripheral access API for EFM32TG842 MCU (generated using svd2rust)
-
efm32lg880-pac
Peripheral access API for EFM32LG880 MCU (generated using svd2rust)
-
efm32tg230-pac
Peripheral access API for EFM32TG230 MCU (generated using svd2rust)
-
efm32tg108-pac
Peripheral access API for EFM32TG108 MCU (generated using svd2rust)
-
efm32wg290-pac
Peripheral access API for EFM32WG290 MCU (generated using svd2rust)
-
efm32lg980-pac
Peripheral access API for EFM32LG980 MCU (generated using svd2rust)
-
efm32hg108-pac
Peripheral access API for EFM32HG108 MCU (generated using svd2rust)
-
efm32gg390-pac
Peripheral access API for EFM32GG390 MCU (generated using svd2rust)
-
efm32gg895-pac
Peripheral access API for EFM32GG895 MCU (generated using svd2rust)
-
efm32hg309-pac
Peripheral access API for EFM32HG309 MCU (generated using svd2rust)
-
efm32wg380-pac
Peripheral access API for EFM32WG380 MCU (generated using svd2rust)
-
efm32lg230-pac
Peripheral access API for EFM32LG230 MCU (generated using svd2rust)
-
efm32lg380-pac
Peripheral access API for EFM32LG380 MCU (generated using svd2rust)
-
efm32gg332-pac
Peripheral access API for EFM32GG332 MCU (generated using svd2rust)
-
efm32gg380-pac
Peripheral access API for EFM32GG380 MCU (generated using svd2rust)
-
efm32gg330-pac
Peripheral access API for EFM32GG330 MCU (generated using svd2rust)
-
efm32gg990-pac
Peripheral access API for EFM32GG990 MCU (generated using svd2rust)
-
efm32gg232-pac
Peripheral access API for EFM32GG232 MCU (generated using svd2rust)
-
efm32gg290-pac
Peripheral access API for EFM32GG290 MCU (generated using svd2rust)
-
efm32gg280-pac
Peripheral access API for EFM32GG280 MCU (generated using svd2rust)
-
efm32tg222-pac
Peripheral access API for EFM32TG222 MCU (generated using svd2rust)
-
efm32lg895-pac
Peripheral access API for EFM32LG895 MCU (generated using svd2rust)
-
efm32g880-pac
Peripheral access API for EFM32G880 MCU (generated using svd2rust)
-
efm32g842-pac
Peripheral access API for EFM32G842 MCU (generated using svd2rust)
-
efm32lg940-pac
Peripheral access API for EFM32LG940 MCU (generated using svd2rust)
-
efm32gg890-pac
Peripheral access API for EFM32GG890 MCU (generated using svd2rust)
-
efm32g800-pac
Peripheral access API for EFM32G800 MCU (generated using svd2rust)
-
efm32g210-pac
Peripheral access API for EFM32G210 MCU (generated using svd2rust)
-
efm32g232-pac
Peripheral access API for EFM32G232 MCU (generated using svd2rust)
-
efm32tg822-pac
Peripheral access API for EFM32TG822 MCU (generated using svd2rust)
-
efm32gg295-pac
Peripheral access API for EFM32GG295 MCU (generated using svd2rust)
-
efm32hg210-pac
Peripheral access API for EFM32HG210 MCU (generated using svd2rust)
-
efm32hg308-pac
Peripheral access API for EFM32HG308 MCU (generated using svd2rust)
-
efm32gg942-pac
Peripheral access API for EFM32GG942 MCU (generated using svd2rust)
-
efm32lg990-pac
Peripheral access API for EFM32LG990 MCU (generated using svd2rust)
-
efm32lg995-pac
Peripheral access API for EFM32LG995 MCU (generated using svd2rust)
-
efm32g200-pac
Peripheral access API for EFM32G200 MCU (generated using svd2rust)
-
efm32g890-pac
Peripheral access API for EFM32G890 MCU (generated using svd2rust)
-
efm32g230-pac
Peripheral access API for EFM32G230 MCU (generated using svd2rust)
-
efm32hg222-pac
Peripheral access API for EFM32HG222 MCU (generated using svd2rust)
-
efm32lg842-pac
Peripheral access API for EFM32LG842 MCU (generated using svd2rust)
-
efm32g290-pac
Peripheral access API for EFM32G290 MCU (generated using svd2rust)
-
efm32g840-pac
Peripheral access API for EFM32G840 MCU (generated using svd2rust)
-
efm32g222-pac
Peripheral access API for EFM32G222 MCU (generated using svd2rust)
-
tpa2016d2
Embedded-hal driver for the Texas Instruments TPA2016D2 Class-D amplifier
-
msg_store_server_api
The backbone of the msg-store api that can be embedded into various server implementations
-
yarn-spool
parsing and evaluating Yarn Dialogue scripts
-
ssd1327-i2c
SSD1327 I2C Driver
-
gp2d12
Driver for the GP2D12 infrared distance sensor
-
mcp346x
Platform-agnostic driver for MCP346x Sigma-Delta ADC
-
ssd1307fb
using embedded-graphics with framebuffer provided by ssd1307fb driver
-
simink_spinlock
simink 自旋锁
-
as5048a
Rust driver for AMS AS5048A Magnetic Rotary Encoder
-
cbor-smol
Streamlined serde serializer/deserializer for CBOR
-
hzgrow-r502
A USART driver for the HZ Grow R502 fingerprint reader module. May also be useful for other, similar modules.
-
efm32wg990-pac
Peripheral access API for EFM32WG990 MCU (generated using svd2rust)
-
efm32wg842-pac
Peripheral access API for EFM32WG842 MCU (generated using svd2rust)
-
efm32wg332-pac
Peripheral access API for EFM32WG332 MCU (generated using svd2rust)
-
sbus-parser
Futaba SBUS parser using loop and byte swap
-
stm32f1xx-hal
HAL for the STM32F1xx family of microcontrollers
-
qei
A wrapper that allows to extend quadratic encoder interface (QEI)
-
ruspiro-register
definitions to conviniently work with register field values that are typically presented by a set of bit fields
-
ux_serde
Implement the following non standard integers: u2, u3, u4, u5, u6, u7, u9, u10, u11, u12, u13, u14, u15, u17, u18, u19, u20, u21, u22, u23, u24, u25, u26, u27, u28, u29, u30, u31, u33…
-
grove-matrix-led-my9221-rs
Rust driver for Grove RGB Matrix Led with my-9221 Driver
-
embedded-flight-control
Embedded flight control library
-
embedded-test
A test harness and runner for embedded devices
-
panic-custom
Small panicking rust crate that allows to easily set the behavior of panicking for embedded or regular no_std binaries
-
ssd1681
Driver for the SSD1681 e-Paper display (EPD) controller, for use with embedded-hal
-
cfap_screen
An embedded-hal based driver for ePaper displays from Crystalfontz
-
sht4x
Sensirion SHT4x Driver for Embedded HAL
-
mcp9808
Platform agnostic Rust driver for the Microchip MCP9808 temperature sensor
-
embedded-counters
Performance counters for embedded driver benchmarking
-
nostd_async
An asyncronous runtime for a single-threaded no_std environment
-
ad57xx
Analog Devices AD57xx SPI DAC driver
-
bern-test
test framework for hardware integration tests
-
burble-fs
Bluetooth LE file system storage backend
-
phm-cli
The Interface Control Document (ICD) for Pretty HAL Machine
-
ufloat
Wrappers around floating point numbers with ufmt trait implementations
-
msp430fr4133
Peripheral access crate for MSP430FR4133 microcontroller
-
weensy
A collection of useful bits and bobs for programming the Teensy 4.1 microcontroller
-
xmc1100
Low-level register mappings for the XMC1100 series of ARM Cortex-M0 microcontrollers
-
flipperzero-alloc
Flipper Zero
-
defmt-listener
decode and print defmt-itm data received from tcp
-
fs3000
Basic embedded-hal-based I2C driver for the FS3000-1005 and FS3000-1015 air velocity sensors
-
i-kdl
Inline-KDL Embedded Document Language
-
hub75-remastered
A completely rewritten driver for HUB75 displays
-
npl_utils
NPL receiver for embedded platforms
-
stemma-soil-sensor-embassy
Interface with Adafruit's STEMMA Soil Sensor while using embassy
-
systemview-target
RTOS tracing trait implementation for SEGGER SystemView
-
rs-com
A Really simple serial communication terminal
-
stm32f100xx
Peripheral access API for STM32F100XX microcontrollers
-
trellis_m4
Board Support crate for the Adafruit NeoTrellis M4 Express
-
shared-pin
An abstraction to share rust embedded_hal pins between functions
-
arm64_virt
simink 程序
-
efm32gg11b310-pac
Peripheral access API for EFM32GG11B310 MCU (generated using svd2rust)
-
efm32gg11b510-pac
Peripheral access API for EFM32GG11B510 MCU (generated using svd2rust)
-
ws2812-blocking-spi
Driver based on embedded_hal::blocking::spi::Write for WS2812
-
aarch64-intrinsics
AArch64 optimized compiler intrinsics
-
efm32lg390-pac
Peripheral access API for EFM32LG390 MCU (generated using svd2rust)
-
efm32lg890-pac
Peripheral access API for EFM32LG890 MCU (generated using svd2rust)
-
efm32wg395-pac
Peripheral access API for EFM32WG395 MCU (generated using svd2rust)
-
efm32hg321-pac
Peripheral access API for EFM32HG321 MCU (generated using svd2rust)
-
efm32gg840-pac
Peripheral access API for EFM32GG840 MCU (generated using svd2rust)
-
efm32lg332-pac
Peripheral access API for EFM32LG332 MCU (generated using svd2rust)
-
efm32g280-pac
Peripheral access API for EFM32G280 MCU (generated using svd2rust)
-
spms_ring
Single publisher, multiple subscriber ring buffer for pubsub
-
cortex-m-rt-macros
Attributes re-exported in
cortex-m-rt
-
uefi-graphics
An embedded-graphics display driver for UEFI environments
-
utrace_rtt
Instrumentation-based profiling library for embedded targets with async support
-
embedded-nal-async-xtra
Hosts a bunch of traits which are not yet available in the embedded-nal-async crate
-
mips32
low-level reg read/write for mips32
-
oxide-spark-utils
exposes public parts of oxide-spark
-
panic-write
Write panic messages to a core::fmt::Write and then halt
-
bbbase64
Bare-Bones Base64: no-std, heapless, memory-safe encoding/decoding library for embedded
-
mm-std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
htu2xd
Driver for the TE Connectivity Measurement Specialties HTU20D and HTU21D series I2C temperature and humidity sensors
-
embedded_types
Types useful in embedded, no_std amd hw development
-
levarint64
Little-Endian VARiable-length INTeger codec, compatible with no_std
-
tm040040
An embedded-hal driver for the TM040040 Cirque Circle touchpad (and Pinnacle touchpads in general)
-
one_alloc
A custom allocator that allows a singular allocation of a specific size known ahead of time
-
tt21100-async
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
embedded-graphics-transform
coordinate transforms for embedded display drivers
-
esp-at-nal
Network layer client for ESP-AT modems
-
lcd1602-diver
A driver for the LCD1602 display using the PCF8574 I2C bus
-
embedded-crc32c
A
const
, single-choice opinionated tiny CRC32 implementation -
st7032i
Platform agnostic Rust driver for the Sitronix ST7032i Dot Matrix LCD Controller
-
goertzel_algorithm
Goertzel algorithm implementation
-
blimp
Terminal based status page for embedded devices
-
egui-stylist
An embeddable theme editor for egui
-
da14531-sdk
DA14531 SDK Rust bindings
-
eg-seven-segment
Seven-segment displays for embedded-graphics
-
jrk-g2-rs
embedded driver for pololu Jrk G2
-
simink_entry
simink 启动运行时环境初始化
-
hpm-rt
Minimal runtime / startup for HPMicro MCUs
-
max14578e-driver
An embedded async driver for the MAX14578E/MAX14578AE USB charger detector
-
thermostat
Finite state machine for a thermostat controlling a centralized HVAC system or other heating and/or cooling apparatus
-
drmem-db-simple
backend for DrMem control system
-
drv2605-async
An async rust-embedded driver for the Texas Instruments DRV2605 haptic driver
-
mips
Low-level abstraction of MIPS processors
-
ssd1362
Driver to interface with SSD1362 based 256x64 OLED displays through SPI
-
embed-rust-in-rust
A handy library allowing you to embed Rust 🚀 in Rust 🚀
-
lfsr-instances
Some Galois linear feedback shift registers with predefined parameters
-
nrf51-hal
HAL for nRF51 microcontrollers
-
uefi-macros
Procedural macros for the
uefi
crate -
rrt0
cross-platform runtime / startup (like crt0)
-
simink-build
simink build
-
memcom
Command-line tool to interact with shared-mem-queue queues
-
eei_vfd
An embedded-hal based driver for VFD displays from EEI Tech
-
efm32pg12-pac
Peripheral access API for Silicon Labs EFM32PG12 microcontrollers
-
grapple-m24c64
embedded-hal driver for the M24C64 I2C EEPROM
-
i2c_hung_fix
Attempts to unhang the I2C bus after an ungraceful reset using traits from the embedded-hal
-
ssd1322_di
display-interface
compatible driver for the SSD1322 OLED display controller -
adxl313
A platform agnostic driver to interface with the ADXL313 (accelerometer) through SPI
-
em7180
driver for the EM7180 (Sensor hub with MPU9250 gyro/accelerometer, embedded Asahi Kasei AK8963C magnetometer, Measurement Specialties' MS5637 Barometer, and ST's M24512DFC I2C EEPROM module)
-
mcp320x
Platform agnostic driver written using embedded-hal traits to interface with the MCP320X ADC's
-
fomu-rt
Minimal runtime / startup for RISC-V on Fomu
-
msvc-alloca
MSVC's _alloca for the most bare metal of bare metal projects
-
xmc4400
XMC peripheral library for XMC4400 generated from SVD
-
processor
simink 处理器操作底层封装
-
tps6507x
platform agnostic Rust driver for the TPS6507x series Texas Instruments power management ICs
-
SKEAZN642
Device support crate for KEAZN64 devices
-
bnx-cal
Bnx Core Abstraction Layer
-
can-utils
Handy modules and utilities for manipulating CAN data and interfaces
-
rf4463
no-std library for interfacing with the SI4463 transceiver IC
-
array-utils
A no-std heapless set of array utils making use of const generics
-
pavo-common
Common Types for the Pavo Framework
-
k1921vk01t-pac
API доступа к периферии микроконтроллера НИИЭТ К1921ВК01Т
-
lcd
Hitachi HD44780-compatible LCD screen support for embedded development
-
uart
A clean implementation of the UART_16550 device functionality
-
imxrt1170evk-fcb
FlexSPI configuration block for NXP's IMXRT1170EVK
-
edc2svd
Convert register description from the EDC format to the SVD format
-
ep-pin-toggle
embedded-profiling
implementation using a GPIO toggle -
cortex-m-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
unmp-link
unmp
-
pscontroller-rs
A hardware-level platform agnostic driver for PlayStation 1 or 2 contoller peripherals. Requires soldering. 😁
-
stm32l0x1
Peripheral access API for STM32L0x1 microcontrollers
-
nrf51-pac
Peripheral Access Crate for Nordic's nrf51 microcontroller
-
imxrt1060evk-fcb
FlexSPI configuration block for NXP's IMXRT1060EVK
-
va108xx-hal
HAL for the Vorago VA108xx family of microcontrollers
-
ra2e1
Peripheral access API for ra2e1 microcontrollers (generated using svd2rust)
-
utrace_core
Instrumentation-based profiling library for embedded targets with async support
-
oc2-hlapi
Rust bindings for the OpenComputers II Minecraft mod's HLAPI
-
himpi-sys
Hi35XX MPI API for Rust unsafe bindings
-
springql-core
SpringQL: Open-source stream processor for IoT devices and in-vehicle computers
-
serial-embedded-hal
embedded-hal for non-embedded platforms
-
defrag
safe and low overhead defragmenting memory manager for microcontrollers
-
bit-byte-structs
A bus-agnostic trait and structs for interfacing with register based peripherals
-
cst816s
touchscreen driver for embedded hal / no_std
-
kiibohd-log
Basic log wrapper for the kiibohd project. Supports multiple backends (e.g. rtt, semi-hosting).
-
bmetal
bare-bones crate for working with bare-metal targets
-
imxrt1010evk-fcb
FlexSPI configuration block for NXP's IMXRT1010EVK
-
stm32hal
A HAL for all stm32 devices
-
stm32g0
Device support crates for STM32G0 devices
-
bnx-sal
Bnx System Abstraction Layer
-
nucleo-f446re
Board Support Package crate for the Nucleo-F446RE board
-
embtk-rotary-encoder
Embedded Toolkit helpers for handling rotary encoder input
-
embedded-snake
Snake game implementation in Rust with no-std. It uses embedded-graphics as a display target.
-
pmw3901-ehal
PMW3901 optical flow driver for embedded-hal no_std applications
-
mcp47x6
Driver for Microchip MCP4725 DAC
-
ldc1x1x
TI LDC1312/LDC1314/LDC1612/LDC1614 inductance-to-digital converter driver for
embedded-hal
-
k8055_rs
Cross platform driver code for the Velleman K8055 kit
-
st7306
TFT LCD driver with embedded-graphics support
-
groundhog-nrf52
A rolling timer abstraction for the nrf52
-
embedded-morse
A driver for morse output on embedded platforms
-
umm-malloc-sys
FFI bindings to the umm_malloc memory allocator
-
turtlebot2
To drive Turtlebot2 (a.k.a Kobuki)
-
burble-crypto
Bluetooth LE cryptographic toolbox
-
simp6502
Opcode definition and interpreter for 6502 assembly
-
overlay
trait for reinterpreting a slice of bytes as an arbitrary type
-
anyleaf
Driver for AnyLeaf sensors
-
mh-zx-driver
MH-Z* family (MH-Z14/Z19/Z19B) CO2 sensor driver built on top of
embedded-hal
primitives -
max3263x
svd2rust generated peripheral crate for the max3263x
-
ext4-view
No-std compatible Rust library for reading ext2/ext4 filesystems
-
lsm303dlhc
A platform agnostic driver to interface with the LSM303DLHC (accelerometer + compass)
-
pl011
simink pl011 串口驱动实现
-
stm32f0x0-hal
HAL for the STM32F0x0 family of microcontrollers
-
defmt-rtt-target
defmt logger implementation using the rtt-target crate
-
figments
A high performance graphics API for microcontrollers
-
es-wifi-driver
Driver for the es-wifi adapter from Inventek
-
unmp-link-websocket
websocket link for unmp
-
minireq
Lightweight support for MQTT-based request/response handling interfaces
-
hub75
A driver for hub75 rgb matrix displays
-
mcp4725-rs
Platform agnostic Rust driver for the Microchip MCP3425 ADC
-
t67xx
Driver for Telaire T67XX CO2 sensor modules
-
ringbuffer-iteration
A no-std ring buffer implementation with iterator support
-
epd-waveshare-uart
An embedded-hal based driver for ePaper displays from Waveshare that use UART. Only 4.3 is supported
-
load_switch
Load Switch library for Solar Racing @ GT
-
bitrate
Extension traits that add convenience methods for working with bitrates and frequencies
-
libosdp
IEC 60839-11-5 OSDP (Open Supervised Device Protocol)
-
PY32c670xx-pac
Peripheral Access Crate for Puya's PY32c670xx microcontroller
-
wasefire-scheduler
Wasefire scheduler
-
ssd1351
Driver crate for the SSD1351 16bit colour OLED display driver
-
bmi323
Platform agnostic Rust driver for the BMI323 IMU
-
dw1000
Driver for the Decawave DW1000 UWB wireless transceiver chip, providing radio communication based on IEEE 802.15.4 and distance measurement
-
s32k116-pac
Device Support Crate for NXP S32K116 Devices
-
cortex-m-rt
Minimal runtime / startup for Cortex-M microcontrollers
-
blinker
easily creating async blinky programs for embedded systems
-
hd44780-ntb
A non-text buffer embedded hal driver for hd44780 like LCD display controllers
-
drv8833-driver
A driver for DRV8833 motor driver
-
free-flight-stabilization
PID flight stabilization functions. no_std, no-alloc.
-
knightrs
The Knight programming language, in Rust
-
ppm_decode
Parser for the Pulse Position Modulation (PPM/CPPM) radio control (RC) protocol
-
defmt-bbq
A generic bbqueue based transport for defmt log messages
-
rtic-time
Basic definitions and utilities that can be used to keep track of time
-
axp192
A driver for the AXP192 power management IC
-
srex
managing SRecord files
-
cargo-minicov
Code coverage support for no_std and embedded programs
-
rn4870
A platform agnostic driver for the RN4870 BLE module
-
bt-hci
Bluetooth HCI data types
-
openthread-rust
Sample for Rust bindings for OpenThread
-
st7567_rs
ST7567 LCD driver with embedded-graphics support
-
defmt-tcp
Prints defmt logs received from a TCP interface
-
kyrax-stm32f401re
Peripherals package for stm32f401re
-
calliope
Board support crate for the Calliope Mini (calliope.cc)
-
embedded-list
A list component for embedded-graphics
-
panic-serial
Print panics on serial port
-
arm-pl011-rs
PL011 UART driver
-
xmc4-hal
Peripheral access API for XMC4 series microcontrollers
-
fe_rtos
OS for Arm Cortex-M CPUs
-
ag-lcd
port of the LiquidCrystal arduino library
-
origen_metal
Bare metal APIs for the Origen SDK
-
mcan
Unofficial MCAN Hardware Abstraction Layer
-
pinetime-lvgl
LVGL Bindings for Mynewt on PineTime Smart Watch
-
embedded-nrf24l01-async
A driver for NRF24L01(+) transceivers on embedded-hal-async platforms(base on embedded-nrf24l01)
-
sh1108
display-interface
compatible driver for the SH1108 OLED display controller -
care
configuration management, reconciling, and tracking over time
-
git-tags-semver
extract SemVer Version Information from annotated git tags
-
liboscore
Rust wrapper around the libOSCORE implementation of OSCORE (RFC8613), a security layer for CoAP
-
riscv_plic
RISC-V platform-level interrupt controller (PLIC) register definitions and basic operations
-
efm32g-pac
Peripheral access API for EFM32G MCU (generated using svd2rust)
-
scpi-contrib
SCPI/IEEE488.2 contrib library
-
pinetime-mynewt
Mynewt Bindings for PineTime Smart Watch
-
embassy-net-driver-channel
High-level channel-based driver for the
embassy-net
async TCP/IP network stack -
lsm303dlhc-ng
A platform agnostic driver to interface with the LSM303DLHC (accelerometer + compass)
-
daisy_bsp
A board support package for the Electro-Smith Daisy Seed
-
bitbang-hal
Implements embedded-hal traits by bitbanging
-
signalo_filters
A collection of filters used in 'signalo' umbrella crate
-
rpi_sim868
RPi SIM868 is a crate designed to facilitate interaction with the Waveshare SIM868 HAT for Raspberry Pi
-
variegated-board-cfg
Store pin and other HAL configurations for your embedded project in a TOML file
-
xmc1100-hal
Hardware Abstraction Layer (HAL) for the XMC1100 series of ARM Cortex-M+ microcontroller
-
scoped-mutex
An abstraction over closure-based mutexes
-
atsaml21e15b
Device crate for the Microchip ATSAML21E15B, generated from its SVD file
-
mips-mcu-alloc
A heap allocator for MIPS based microcontrollers
-
hf2-cli
CLI for Microsoft HID Flashing Library for UF2 Bootloaders
-
ch32v103-hal
WCH CH32v103 MCU HAL
-
rusty-os
kernel for embedded systems written in Rust
-
phidget-sys
Low-level, unsafe, Rust wrapper for the phidget22 library
-
usbd-hid-descriptors
Low-level, wire-format enums/bitfields used in HID descriptors
-
max3010x
Platform-agnostic Rust driver for the MAX3010x high-sensitivity pulse oximeter and heart-rate sensor for wearable health
-
ruspiro-timer
This crates provides simple timing functions to pause the current processing for a specific amount of time. The core pausing is called on will block.
-
bitwrap_extra
pack/unpack data into byte array
-
panic-msp430
Halting panic implementation for MSP430 microcontrollers
-
tock/tock-cells
A secure embedded operating system for microcontrollers
-
fel-cli
CLI tools for dealing with Allwinner devices in FEL mode, in pure Rust
-
iqs323-driver
An embedded async driver for the IQS323 IQ Switch ProxFusion touch and proximity sensing controller
-
nourl
Url primitive for no_std environments
-
vga-framebuffer
A text console output over a VGA compatible signal
-
postform_rtt
Decodes Rtt logs for Postform, an efficient logging framework for mcu's
-
ppproto
Point-to-Point Protocol (PPP) for embedded systems.
no-std
compatible, no alloc (heap) required. -
embassy-time-driver
Driver trait for embassy-time
-
safe-ftdi
A safe wrapper around libftdi
-
efm32hg309f64-pac
Peripheral Access Crate for EFM32HG309 series MCU from Silicon Labs
-
manchester-code
A no-std library to allow Manchester encoding and decoding of datagrams
-
ht32f1yyy
Device support crates for HT32F1YYY devices
-
cyw43
Rust driver for the CYW43439 WiFi chip, used in the Raspberry Pi Pico W
-
gdbstub
GDB Remote Serial Protocol in Rust
-
embedded-hal-async
An asynchronous Hardware Abstraction Layer (HAL) for embedded systems
-
bmp180-driver
A driver for BMP180 Digital Pressure Sensor
-
efm32tg-pac
Peripheral access API for EFM32TG MCU (generated using svd2rust)
-
pac55xx-hal
Hardware Abstraction Layer (HAL) for PAC55XX
-
microamp
Asymmetric Multi-Processing on microcontrollers
-
xdevs-no-std
no-std implementation of xDEVS for real-time simulation on embedded systems
-
epd-spectra
Driver for Spectra EPDs from Pervasive Displays Inc
-
m24c64-driver
embedded-hal(-async) driver for the M24C64 I2C EEPROM
-
s32k144-pac
Device Support Crate for NXP S32K144 Devices
-
pimoroni_gfx_pack_button
Driver for LCD GFX PACK buttons by Pimoroni
-
thingy-91-nrf9160-bsp
BSP for the Nordic Thingy:91 nRF9160
-
northstar-nstar
Northstar is an container runtime for Linux targetting embedded systems
-
ral-registers
MMIO registers abstraction with a macro API
-
sk6812_rpi
SK6812RGBW library for RaspberryPi
-
p256-cortex-m4
Idiomatic, misuse-resistent bindings to P256-Cortex-M4
-
Rusty_CryptoAuthLib
A platform agnostic I2C driver for Microchip’s Crypto Authentication HW (i.e. secure element
ATECC608A
), written in pure Rust. -
ublox-cellular-rs
Driver crate for u-blox cellular devices, implementation follows 'UBX-13002752 - R65'
-
microscpi
creating SCPI interfaces
-
ads7924
no_std driver for the ADS7924 external analog-to-digital converter (ADC)
-
aw9523b
A general driver for AW9523B which is 16 bit gpio explander & led driver
-
embedded-spi
Rust embedded driver helper package (new releases at spi-hal)
-
ch32-metapac
Peripheral Access Crate (PAC) for all WCH's MCU chips, including metadata
-
playdate-cli
The CLI tools for playdate-rs
-
nrf24l01
A pure Rust user space driver for NRF24L01(+) transceivers on Linux
-
simavr-section
Add simavr-compatible metadata to your binary
-
lpc13xx-pac
Device support crates for LPC13XX-PAC devices
-
drmem-drv-ntp
DrMem driver which monitors ntpd daemons
-
ghostfat
Virtual FAT16 file system for embedded USB Mass Storage Device use
-
bbqueue-ng
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
teensy4-panic
Panic handler for the Teensy 4. Part of the teensy4-rs project
-
udatatable
creating data tables in an embedded no_std environment without an allocator
-
system76_ecflash
Flashing and querying with System76 Embedded Controllers
-
ldc1614
TI LDC1614 inductance-to-digital converter user-friendly driver for
embedded-hal
-
dtb
Device tree blob manipulation
-
canadensis_data_types
Automatically generated types for all Cyphal public regulated data types
-
msp430-periph
Peripheral definition for all MSP430s
-
lsm6dso
A platform-agnostic driver for the LSM6DSO 6-DoF Accel + Gyro IMU
-
nrf-dfu-target
Nordic nRF DFU protocol for devices
-
lpc845-pac
Low-level register mappings for the NXP LPC845 series of ARM Cortex-M0+ microcontrollers
-
athenna
light weight highly performant neural net framework for creating and using AI's cross platform and language
-
bxcan-ng
STM32 bxCAN peripheral driver
-
smoltcp-slip
SLIP network interface on top of smoltcp
-
atsams70n20
Peripheral access API for ATSAMS70N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
drmem-drv-tplink
DrMem driver for TP-Link devices
-
atsam3s2a
Peripheral access API for ATSAM3S2A microcontrollers (generated using svd2rust)
-
tsl2591-eh-driver
Rust embedded-hal driver for the TSL2591 Light Sensor
-
embassy-boot
A lightweight bootloader supporting firmware updates in a power-fail-safe way, with trial boots and rollbacks
-
w5500-dhcp
DHCP client for the Wiznet W5500 internet offload chip
-
pl011-uart
A driver for the Arm PL011 UART
-
embedded-nano-mesh-linux-examples
Lightweight mesh communication protocol for linux
-
atsame54p
Peripheral access API for ATSAME54P microcontrollers (generated using svd2rust)
-
avr_delay
AVR providing software-based delay functions
-
bmp390
Asynchronous driver for the BMP390 pressure sensor
-
wasefire-stub
Stubs for the Wasefire applet API
-
atsam4lc4c-pac
Peripheral access crate for the ATSAM4LC4C microcontroller
-
async-pool
Statically allocated pool providing a std-like Box, with async functionality
-
eeprom
emulation on top of FLASH for STM32
-
stm32f3-staging
Device support crates for STM32F3 devices
-
efm32gg-hal
HAL for the EFM32GG (EFM32 Giant Gecko) family of microcontrollers
-
lilos-handoff
Synchronous rendezvous structure for lilos
-
ht32-usbd
'usb-device' implementation for HT32 microcontrollers
-
andes-riscv
Low level access to Andes' AndeStar V5 RISC-V processors
-
dwt-systick-monotonic
RTIC Monotonic implemenation based on Systick and DWT
-
drone-stm32-map
STM32 peripheral mappings for Drone, an Embedded Operating System
-
pa-spl
A no-std embedded-hal I2C driver for the PCB Artists SPL module
-
veml7700
Platform-agnostic Rust driver for the VEML7700 High Accuracy Ambient Light Sensor
-
rudelblinken-filesystem
Minimalistic zero-copy flash filesystem optimized for embedded systemse
-
sensd
The ultimate data logger and control system
-
minicbor-embedded-io
Async reader and writer types for minicbor
-
utrace
Instrumentation-based profiling library for embedded targets with async support
-
dht-embedded
reading temperature and humidity from the DHT11 and DHT22 sensors
-
stm32f1xx-hal-bxcan
HAL for the STM32F1xx family of microcontrollers
-
efm32hg-pac
Peripheral access API for EFM32HG MCU (generated using svd2rust)
-
ad983x
Platform-agnostic Rust driver for the AD9833, AD9834, AD9837 and AD9838 low-power programmable waveform generators / direct digital synthesizers
-
ufmt-stdio
C stdio writer for ufmt
-
mctp
Management Component Transport Protocol (MCTP) base types and traits
-
cs47l63
driver for the CS47L63 DSP
-
fomu-pac
svd2rust generated pac for the fomu
-
esp-idf-sys
Bindings for ESP-IDF (Espressif's IoT Development Framework)
-
avr-mcu
Pragmatic structures for all AVR microcontrollers
-
blynk_io
Blynk.io streaming API integration in Rust
-
device-driver-generation
Code generation for the
device-driver
crate -
wasefire-wire
Wasefire wire format
-
stackdump-capture
capturing stack dumps
-
n32g4
Device support crate for N32G4 devices
-
s32k142-pac
Device Support Crate for NXP S32K142 Devices
-
telit-me310g1
interoperate with the Telit ME310G1 LTE-M radio with AT commands
-
jtagice_mkii
client for AVRice MKII JTAG debuggers
-
microbit-common
details for the BBC Micro:bit board support crates
-
defmt-brtt
Defmt logs over RTT as well as through a BBQueue
-
lsm9ds1
A platform agnostic driver to interface with LSM9DS1 3D accelerometer, 3D gyroscope, 3D magnetometer sensor module
-
openmv_h7_bsp
Board support crate for OpenMV H7 machine vision board
-
pot-conditioner
Signal conditioner for analog potentiometer readouts
-
drogue-embedded-timer
Macro to shim heterogeneous HAL timers to embedded-time
-
embedded-hal-error
core::error::Error for embedded-hal Errors
-
dyn-smooth
Dynamic smoothing filter based on an algorithm by Andrew Simper
-
barebones-watchface
Barebones Watch Face for Mynewt on PineTime Smart Watch
-
wasm-embedded-rt
Runtime for embedded-wasm applications
-
winpipe2serial
link a windows named pipe to a serial COM port
-
tinyrlibc
Tiny, incomplete C library for bare-metal targets, written in Stable (but Unsafe) Rust
-
rkrga
Rockchip RGA bindings for Rust
-
drogue-esp8266
Networking stack for ESP8266 Wifi offload board
-
esp32
Peripheral access crate for the ESP32
-
lpc11uxx
Register mappings for the NXP LPC11Uxx family of ARM Cortex-M0+ microcontrollers
-
standard-pid
Standard PID implementation in Rust for serious embedded projects
-
edge-frame
Yew & Wasm-based user interface for microcontrollers
-
otm8009a
Hardware Abstraction Layer for OTM8009A LCD controller IC
-
simmer
A temperature unit library for Rust. It's intended to be minimal, embedded-aware, and easy to use!
-
bsec
Rust API to the Bosch BSEC library
-
ens160-aq
ScioSense ENS160 driver
-
ade791x
Driver for the ADE7912/ADE7913 3-Channel, Isolated, Sigma-Delta ADC with SPI
-
seven_segment
driver for seven segment displays
-
stm32f1
Device support crates for STM32F1 devices
-
sdio-host
SD host protocol library
-
xmc4700
XMC peripheral library for XMC4700 generated from SVD
-
i2cdev
API for safe access to Linux i2c device interface
-
mkl25z4
Peripheral access API for NXP KL25Z microcontrollers
-
stm32l1xx-hal
Peripheral access API for STM32L1 series microcontrollers
-
care-parse-ncl
Nickel script parsing crate for the care tool
-
mcxn947-pac
Peripherals Access Crate for NXP mcxn947
-
esp-hal-embassy
Embassy support for esp-hal
-
jaylink
communicate with J-Link USB devices
-
sen0177
Read air quality data from the SEN0177 and PMSA003I sensors
-
nisty
NIST P256 signatures for Cortex-M4 microcontrollers
-
keyberon
Parse command line argument by defining a struct
-
sm2335egh
Driver for the SM2335EGH LED controller found in the SwitchBot Color Bulb
-
bno080
AHRS driver
-
embedded-graphics-sparklines
Sparklines for rust's embedded-graphics
-
embedded-error
Universal error kinds for embedded systems
-
esp32c2
Peripheral access crate for the ESP32-C2
-
sram23x
Platform-agnostic Rust driver for the 23xx series serial SPI SRAMs
-
teensy4-pins
Helpers for configuring and using a Teensy 4's pins. Part of the teensy4-rs project
-
embedded-utils
embedded-utils
provides some features in Rust(no_std) embedded systems -
sensor_lib_as5600
A driver for the AS5600 sensor module
-
a653rs-postcard
Extension traits for sending types via a653rs channels using postcard
-
dht-hal-drv
HAL based driver for digital humidity and temperature sensors DHT11, DHT21, DHT22
-
mcp3424
Async Rust driver for the MCP3422/3/4 ADC
-
led
Various LED implementations built on the embedded-hal traits
-
plan9_asm
Plan9 Assembly wrapper
-
rtt-logger
An rtt-target logger implementation for Cortex-M embedded platforms
-
xmc4800
XMC peripheral library for XMC4800 generated from SVD
-
loadstone
Portable secure bootloader for Cortex-M MCUs
-
stm32f7-staging
Device support crates for STM32F7 devices
-
lm75
Platform-agnostic Rust driver for the LM75 temperature sensor and thermal watchdog
-
rvideo-view
A lightweight video viewer for rvideo
-
ublox-short-range-rs
Driver crate for u-blox short range devices, implementation follows 'UBX-14044127 - R40'
-
adafruit-lcd-backpack
Unofficial driver for the Adafruit I2C LCD backpack
-
emcell-macro
A macro crate for emcell
-
embassy-net-adin1110
embassy-net driver for the ADIN1110 ethernet chip
-
imxrt-usbd
USB driver for NXP iMX RT processors
-
stm32wlxx-hal
Hardware abstraction layer for the STM32WL series microcontrollers
-
efm32pg-pac
Peripheral access API for EFM32PG MCU (generated using svd2rust)
-
cotton-unique
Deterministic per-device unique IDs for embedded systems
-
pcd8544
communicate and write to PCD8544 using embedded_hal as abstraction layer. WIP
-
pcf85063a
An embedded-hal driver for the pcf85063a RTC
-
unmp-id
unmp
-
esp-ota
Easy OTA updates for ESP32 chips using only safe Rust. Transport agnostic.
-
jetgpio
Peripheral Abstraction Layer for Jetson Nano Devices
-
socketcand
parser for small systems
-
ad5668
Rust Embedded HAL driver for Analog Devices AD5668 DAC
-
lm3s6965
Interrupt bindings for the LM3S6965 microcontroller
-
sn3193
Driver for SN3193 3-Channel Fun LED Driver
-
probe-rs-mi
The probe-rs machine interface for computers interfacing probe-rs
-
satrs
A framework to build software for remote systems
-
stackdump-trace
tracing stack dumps
-
bl602-sdk
Rust Wrapper for BL602 IoT SDK
-
light_seq
Raspberry Pi based light show program reacting to the audio input
-
hal-sim
An embedded-hal and embedded-graphics Display simulator
-
senml-deser
serialization and deserialization using SenML specifications
-
the-bridge
Efficient Binary Protocol Bridge for std and no_std Environments
-
ti-lp55231
Linux I2C driver for Texas Instruments LP55231 LED controller
-
sensor-temp-humidity-sht40
Driver for SHT40 temperature and humidity sensor
-
pac25
Device support crates for PAC25 devices
-
flem
Flexible, Light-weight, Embedded Messaging Protocol
-
ham-cats
Reference implementations for CATS, the ham radio protocol
-
cotton-usb-host-msc
USB mass-storage host for embedded devices
-
nobcd
BCD number primitive for no_std environments
-
is31fl3218
A rust-embedded driver for the Lumissil Microsystems IS31FL3218 LED driver
-
embedded-bacnet
A bacnet library for embedded systems (no_std)
-
adxl345_driver
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
canadensis_serial
A Cyphal implementation: Cyphal/Serial transport
-
juggle
Async task switching for cooperative multitasking in single thread environments with no_std support
-
is31fl3731
Driver for Lumissil Microsystem's IS31FL3731 IC
-
serial-can
Serial CAN (slcan) for small systems
-
smart-leds-matrix
DrawTarget implementation for smart led based matrixes. It allows the usage of the embedded-graphics Drawables.
-
scd4x
Rust driver for the Sensirion SCD4x series. Carbon Dioxide / Temperature / Humidity sensors.
-
ruspiro-console
Lightweight console abstraction for bare metal implementations to print strings to an output channel that could be easely configured/attached
-
kernaux
Safe binding to libkernaux - auxiliary library for kernel development
-
ads129xx
Driver crate for the Texas Instruments ADS1292 24-bit 2-channel low-power analog front end for ECG applications
-
w5500-sntp
SNTP client for the Wiznet W5500 internet offload chip
-
dwm1001
Board Support Crate for the Decawave DWM1001 module and development board
-
bmp085-180-rs
Driver for BMP085 & BMP180 sensors
-
embedded-dma
Traits to aid in the creation of sound DMA abstractions
-
gd32e2
Device support crate for GD32E2 devices
-
rtos-trace
RTOS tracing trait
-
mpfs-hal
Hardware Abstraction Layer for PolarFire SoC
-
bytex
8bit helper functions, mostly for AVR
-
mcp4725
Microchip MCP4725 DAC Driver for Rust Embedded HAL
-
embedded-plots
Heapless plotting library for embedded targets based on embedded-graphics crate
-
lsm303dlhc-registers
A typed map of the STMicroelectronics LSM303DLHC E-Compass registers
-
gpiocdev-embedded-hal
providing embedded-hal wrappers around gpiocdev Requests
-
avrisp
AVR ISP library
-
lfsr-base
Linear feedback shift register base traits
-
cortex-m-asyncrt
A minimal async runtime for Cortex-M devices
-
rtcc
Real-time clock / calendar (RTC / RTCC) traits
-
tm-wheel
Low-level hierachical timing wheel based timer driver implementation
-
stm32f7
Device support crates for STM32F7 devices
-
atsaml21e17b
Device crate for the Microchip ATSAML21E17B, generated from its SVD file
-
astarte-device-sdk-mock
Mock implementation of the traits in the astarte-device-sdk
-
postform_persist
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
aya-ufmt
A fork of
ufmt
tweaked to play nice with the eBPF kernel verifier -
bcm2835-lpa
Peripheral access crate for BCM2835 found in the Raspberry Pi 1 and Zero
-
hal_sensor_dht
A Embedded HAL driver for the DHT humidity and temperature sensors
-
aht10-async
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor
-
atsam4ls2a-pac
Peripheral access crate for the ATSAM4LS2A microcontroller
-
poller
File I/O events library for Rust
-
ws2812-nrf52833-hal-pwm
nrf52833 PWM driver for ws2812 leds
-
esp-max31865
An ergonomic wrapper for interfacing with Max31865 SPI RTD devices using an ESP32
-
bluenrg
Interface to ST Micro BlueNRG Bluetooth radios
-
jh71xx-hal
Hardware abstraction library for the JH71xx SoCs
-
wasefire-board-api
Wasefire board API
-
usbd-ccid
usb-device driver for CCID
-
r528-pac
Peripheral access API for Allwinner R528 SoC generated from unofficial SVD file
-
atsam3x8c
Peripheral access API for ATSAM3X8C microcontrollers (generated using svd2rust)
-
rk3399-pac
Peripheral Access Crate (PAC) for the RK3399 SoC from Rockchip
-
r3_kernel
The R3-OS original kernel
-
vl53l0x-simple
driver for the VL53l0X TOF ranging sensor
-
embedded-menu
interactive menu for embedded devices
-
stm32f3
Device support crates for STM32F3 devices
-
kea-hal
HAL for NXP KEA devices
-
care-ef-zeroinstall
0install effector for the care tool
-
msp430f2619-pac
A peripheral access crate (PAC) for TI's MSP430F2619 mcu
-
imxrt1062-semc
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
defmt-semihosting
Transmit defmt log messages over the Cortex-M Semihosting protocol
-
drone-stm32-map-svd
STM32 SVD to bindings for Drone, an Embedded Operating System
-
blue_hal
Embedded Hardware Abstraction Layer
-
defmt-print
that decodes defmt logs and prints them to the console
-
sevseg_3642bs
Driver crate for the 3642BS seven segment display
-
esp-tm1637
platform agnostic driver for a LED-display powered by TM1637 chip
-
tockloader-proto
A #[no_std] implementation of the protocol used by tockloader and the TockOS bootloader
-
max6675-hal
An embedded-hal driver for the MAX6675 digital thermocouple converter
-
si7021-t-rh
Si7021 driver (7013, 7020 and 7021)
-
atsamd21e
Peripheral access API for ATSAMD21E microcontrollers (generated using svd2rust)
-
lsm303c
A platform agnostic driver to interface with the LSM303C (accelerometer + compass)
-
pca9548a
I2C-Expander driver using embedded-hal
-
ssd1322
SPI driver for the SSD1322 OLED display controller
-
microbit-text
Scrolling text on a 5×5 (micro:bit) display
-
lpc8xx-hal
Hardware Abstraction Layer (HAL) for the NXP LPC800 series of ARM Cortex-M0+ microcontrollers
-
vl53l1x-uld
source port of the ULD driver for the VL53L1X
-
rkaiq-sys
Rockchip RKAIQ FFI bindings for Rust
-
nrf24radio
Asynchronous embedded driver for NRF24L01(+) devices
-
scd30-modbus
SCD30 driver implementation
-
tcs3472
Platform-agnostic Rust driver for the TCS3472 RGB color light to digital converter with IR filter
-
atsams70q19
Peripheral access API for ATSAMS70Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
metro_m0
Board Support crate for the Adafruit Metro M0
-
drone-nrf-map
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
rust-mqtt
MQTT client for both embedded and non-embedded devices
-
tca9548-eh
An embedded-hal focused driver for the TCA9548 I2C multiplexer
-
signalo_sinks
A collection of filters used in 'signalo' umbrella crate
-
percore
Safe per-CPU core mutable state on no_std platforms through exception masking
-
embedded-drivers
Platform-agnostic Rust drivers for BME280/BMP280/BMP180, LM75, PMSx003
-
max31865
generic driver for the MAX31865 RTD to Digital converter
-
atsam3n0a
Peripheral access API for ATSAM3N0A microcontrollers (generated using svd2rust)
-
bbqueue-sync
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
s32k148-pac
Device Support Crate for NXP S32K148 Devices
-
pca9555
A rust-embedded driver for the (P|T)CA9555 i/o port expander
-
stm32f0xx-hal
Peripheral access API for STM32F0 series microcontrollers
-
kpal
An extensible and RESTful control system for physical computing
-
lpc546xx-hal
Peripheral access API for LPC546xx series microcontrollers
-
assign-resources
Macro to split up fields of a Peripherals struct into new structs
-
gpio-utils
Command-line utilities for interacting with GPIOs under Linux This wraps the
sysfs_gpio
crate in a form usable by both Rust applications or any other applications -
nrf9160-hal
HAL for nRF9160 system-in-package
-
soft-i2c
Soft i2c for any open drain pin
-
defmt-decoder
Decodes defmt log frames
-
hifb-sys
Hi35XX FB API for Rust unsafe bindings
-
stm32f1xx-lal
LAL for the STM32F1xx family
-
axp173
Device-agnostic X-Powers AXP173 power management IC driver
-
akafugu_twidisplay
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
adi-adxl355-async
An embedded-hal-async driver for the ADXL355 accelerometer
-
opt300x
Platform-agnostic Rust driver for the OPT300x ambient light sensors. Compatible with OPT3001, OPT3002, OPT3004, OPT3006 and OPT3007
-
awrite
awrite!(): the async write!()/format!() scratch buffer
-
megamorse
morse code translator
-
rumio
Control your MMIO and CPU registers without pain
-
l3gd20
A platform agnostic driver to interface the L3GD20 (gyroscope)
-
w25q32jv
An embedded-hal driver for the W25Q32JV
-
vorago-peb1
Board Support Crate for the Vorago PEB1 development board
-
harsark
Safe and lightweight real-time Kernel
-
scd30-interface
An I2C driver for the SCD30 sensor in Rust
-
is25lp064a
An embedded-hal driver for the IS25LP064A
-
device-register
A
no_std
library to describe the registers permissions of a device to ease driver development -
p256-cm4
P256-Cortex-M4 re-written in rust
-
mwatch_kernel
A embedded 'Smart' watch
-
grounded
A toolkit for managing unsafe statics
-
stm32f429
Peripheral access API for STM32F429 microcontrollers
-
rs-matter
Native Rust implementation of the Matter (Smart-Home) ecosystem
-
gd32vf103-hal
Hardware abstract layer (HAL) for RISC-V microcontroller GD32VF103
-
n64-pac
low-level CPU and register abstractions for the Nintendo 64 console
-
efm32pg23-pac
Peripheral access API for EFM32PG23 MCU (generated using svd2rust)
-
async-embedded-sdmmc
Embedded sdmmc driver with async support
-
is31fl3729
Driver for Lumissil Microsystem's IS31FL3729 IC
-
ruspiro-mailbox
Raspberry Pi mailbox property tag interface API
-
ralte32
Arithmetic Library Testing Environment for embedded RISC-V 32-bit
-
regmock-rs
Register mocking library to allow host unittests of embedded software, build on svd2pac
-
tmp451
Platform-agnostic Rust driver for the TMP451 remote and local temperature sensor
-
escw-mcu
Embedded software C wrapper of MCU
-
bcm2837-lpa
Peripheral access crate for BCM2837 found in the Raspberry Pi 3 and Zero 2W
-
ublox-sockets
Common sockets layer for host-based ublox devices
-
gbl
GBL firmware file handling library
-
s32k146-pac
Device Support Crate for NXP S32K146 Devices
-
wasm-embedded-spec
Embedded WASM WITX specification
-
northstar-client
Northstar is an container runtime for Linux targetting embedded systems
-
atsam4ls4a-pac
Peripheral access crate for the ATSAM4LS4A microcontroller
-
imxrt-log
Logging extensions for i.MX RT processors
-
stratum-v1
Stratum v1 client. This provides a
#[no_std]
library to implement a Stratum v1 client -
sen5x-rs
embedded-hal driver for the sen5x environmental sensor node for HVAC and air quality applications
-
anpp
Advanced Navigation Packet Protocol
-
lbfgs
L-BFGS algorithm
-
embassy-usb-logger
log
implementation for USB serial usingembassy-usb
-
w5500-regsim
Register simulation for the Wiznet W5500 internet offload chip
-
embassy-boot-nrf
Bootloader lib for nRF chips
-
saks
Swiss Army Knife Shield for Raspberry Pi
-
eds
Easy data separator
-
embedded-hal-nb
Non-blocking Hardware Abstraction Layer (HAL) for embedded systems using the
nb
crate -
std-embedded-time
embedded-time Clocks using std::time
-
vcnl36825t-rs
Vishay VCNL36825T proximity sensor driver for embedded-hal i2c traits
-
probe-rs-cli-util
Helper library for CLI applications based on probe-rs
-
bmi160
Platform-agnostic Rust driver for the BMI160 inertial measurement unit (IMU)
-
alazar
randomness
-
enumap
A HashMap and HashSet like interface for enums backed by an array
-
embedded-nal-minimal-coapserver
A minimal CoAP server implementation built on embedded-nal
-
mmio
Abstractions for performing memory-mapped I/O
-
spin-seq
Fork of the
seqlock
crate that can be used on bare metal -
sb-rotary-encoder
Rotary encoder processor for embedded systems
-
nrf52840-dk-bsp
BSP for the nRF52840-DK
-
esp32c6
Peripheral access crate for the ESP32-C6
-
embedded-sgp30
Platform-agnostic Rust driver for the SGP30 gas sensor for indoor air quality applications
-
apds9151
platform agnostic Rust driver for the APDS9151 Digital Proximity and RGB Color I2C Sensor
-
am2301
interface with an AM2301 humidity and temperature sensor
-
atsam3x
Device support crates for ATSAM3X devices
-
memory-lcd-spi
A driver for Sharp's Memory LCD or JDI's Memory In Pixel display, LPM013M126A, LPM009M360A, LS027B7DH01, etc
-
byte-slab
A statically allocated slab of bytes
-
external-memory-tools
HAL to keep data in memory that could not be directly mapped to RAM
-
xmc4300
XMC peripheral library for XMC4300 generated from SVD
-
drone-stm32-map-periph-gpio
STM32 peripheral mappings for Drone, an Embedded Operating System
-
stm32wb-hal
Hardware abstraction layer for the STM32WB55 chips
-
arduino
Reusable components for the Arduino Uno
-
micropb-gen
Generate Rust module from Protobuf files
-
playdate-rs-sys
Raw unsafe Rust bindings for the Playdate SDK C-API
-
framed
Send and receive data over lossy streams of bytes
-
is31fl32xx
A rust-embedded driver for the Lumissil Microsystems IS31FL3205 LED driver
-
serial-settings
Embedded device settings management over serial terminal and flash
-
atsamd51j
Peripheral access API for ATSAMD51J microcontrollers (generated using svd2rust)
-
arducam-mega
SPI driver for the Arducam Mega
-
nrf52810-hal
HAL for nRF52810 microcontrollers
-
chip-select
Chip select GPIO support traits
-
wasefire-logger
Wasefire platform logging
-
embedded-mogeefont
Pixel font for embedded-graphics
-
esp32h2
Peripheral access crate for the ESP32-H2
-
atsaml21e18b
Device crate for the Microchip ATSAML21E18B, generated from its SVD file
-
longan-nano
Board support package for the Longan Nano board
-
canadensis_bxcan
Bridge between Canadensis and the BXCAN peripherals found in some microcontrollers
-
gdb-server
A gdb stub implementation for on chip debugging and flashing of ARM chips
-
scsi
A
no-std
library for easily interfacing with SCSI-based storage devices -
nrf52832-hal
HAL for nRF52832 microcontrollers
-
samd11_bare
Support crate for the ATSAMD11C
-
nrf-softdevice
Rust interface to nRF SoftDevice
-
block_device
BlockDevice trait
-
lps25hb
A platform agnostic driver to interface with LPS25HB pressure sensor module
-
esptools
(esptool, espsecure and espefuse) bundler
-
dummy-pin
Dummy implementations of the input/output pin embedded-hal traits
-
ch58x-hal
HAL for the CH583/CH582/CH581 RISC-V BLE microcotrollers from WCH
-
tock/riscv-csr
RISC-V CSR interface developed for Tock
-
epd-gde021a1
An embedded-hal based driver for ePaper displays with chip: GDE021A1 (172x72 B/W via SPI)
-
rustot
AWS IoT
-
e310x-hal
HAL for the E310x family of microcontrollers
-
itm
A decoding library for the ARM Cortex-M ITM/DWT packet protocol
-
push2_pong
Ableton Push2 Embedded-graphics display driver
-
pavo-traits
Traits for the Pavo Framework
-
unmp-link-udp
udp link for unmp
-
imxrt1062-dcp
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
scoped-mutex-traits
An abstraction over closure-based mutexes
-
max2034x
Driver crate for the MAX20343/MAX20344 family of buck/boost converters
-
houseflow-types
Types for Houseflow
-
rainmaker-components
Component abstractions for rainmaker
-
riscv-target
RISC-V target string manipulation utilities
-
jrk-g2
embedded driver for pololu Jrk G2
-
mh-z19c
Pure rust implementation to read out the Winsen MH-Z19C CO2 sensor
-
atsam4ls8c-pac
Peripheral access crate for the ATSAM4LS8C microcontroller
-
embedded-hal-bus
Bus/Device connection mechanisms for embedded-hal, a Hardware Abstraction Layer (HAL) for embedded systems
-
avr-config
An AVR foundational crate for retrieving details, such as the CPU clock frequency, at runtime
-
liboscore-msgbackend
libOSCORE's CoAP messages based on the cjGoap-message crate
-
atsam3n1a
Peripheral access API for ATSAM3N1A microcontrollers (generated using svd2rust)
-
embassy-net-enc28j60
embassy-net driver for the ENC28J60 ethernet chip
-
anachro-forth-core
A forth-inspired, bytecode-compiled scripting language for Anachro Powerbus
-
postform_serial
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
gd32f2
Device support crate for GD32F2 devices
-
atsams70j21
Peripheral access API for ATSAMS70J21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
nrf52840
Peripheral access API for nrf52840 microcontrollers
-
tca9539
(also PCA9539) 16-Bit I2C I/O Expander with I2C Interface
-
himipi-sys
Hi35XX MIPI API for Rust unsafe bindings
-
l3gd20-ng
A platform agnostic SPI driver to interface with the L3GD2 gyroscope
-
drone-core
The core crate for Drone, an Embedded Operating System
-
smart-leds-trait
A trait for implementing effects, modifiers and drivers for programmable leds
-
samd-timer
High-level API for the TC/TCC peripherals found on the Microchip SAM MCUs
-
embedded-io-async
Async embedded IO traits
-
systick-monotonic
RTIC Monotonic implementation based on SysTick
-
epd
Drivers for EPD(E-Paper Displays), WIP
-
efm32tg11b-pac
Peripheral access API for EFM32TG11B MCU (generated using svd2rust)
-
i2c-write-iter
Exports iterator based parallels to embedded-hal & embedded-hal-async for Write & WriteRead
-
lpc11xx
Register mappings for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
w25q
A generic driver for different SPI Flash and EEPROM chips
-
lilos-rwlock
A read-write / writer-preferred lock for use with lilos
-
nrfdfu
A flashing tool for the nRF bootloader
-
embedded-runtime-nrf52840
A tiny async runtime for embedded devices, with predefined runtime hooks for the nrf52840
-
blinq
An embedded-hal blinking queue
-
efm32pg1b200-pac
Peripheral access API for EFM32PG1B200 MCU (generated using svd2rust)
-
microbit-v2
Board support crate for the BBC Micro:bit V2
-
lpc55-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
defmt-json-schema
defmt JSON schema
-
ruspiro-mmio-register
macros to conviniently define memory mapped I/O (MMIO) registers
-
mqttrust
MQTT Client
-
gdeh0154d67
Driver for the GDEH0154D67 E-Paper display
-
palloc
portable linked-list allocator for baremetal systems
-
va416xx-hal
HAL for the Vorago VA416xx family of MCUs
-
signalo_traits
A collection of traits used in 'signalo' umbrella crate
-
embedded-picofont
The PICO-8 font to use with embedded-graphics
-
stm32l4x6
Memory map for STM32L4x6 microcontrollers
-
r3_port_arm_m
Cortex-M port for the R3-OS original kernel
-
nrf24-rs
Platform agnostic Rust driver for the nRF24L01 2.4 GHz transciever for wireless communication between embedded devices
-
drogue-bme680
interface with the BME680 environmental sensor
-
bcm2711-lpa
Peripheral access crate for BCM2711 found in the Raspberry Pi 4
-
edge-mqtt
Implements the embedded-svc MQTT traits on top of the rumqttc crate
-
tb6612fng
A
no_std
driver for the TB6612FNG motor driver -
ab1024-ega
An embedded-hal SPI driver for AB1024-EGA/AC057TC1 (as used in Inkplate 6 COLOR)
-
eva-robots
Commons for EVA ICS v4
-
aht20-async
A platform agnostic driver to interface with the AHT20 temperature/humidity sensors
-
mnemos-userspace
A tiny embedded operating system userspace library
-
esp-ieee802154
Low-level IEEE 802.15.4 driver for the ESP32-C6 and ESP32-H2
-
littlefs2-sys
Low-level bindings to littlefs
-
embedded-multi-page-hmi
Multi page HMI targetting embedded devices with a few of buttons input and a constrainted display
-
zerocrush
Low-overhead compression for sparse files
-
pybadge-high
High Level Board Support crate for the Adafruit pybadge
-
stm32l4xx-hal
Hardware abstraction layer for the stm32l4xx chips
-
erdnuss-comms
A small RS-485 comms protocol
-
ht32f5xxxx
Device support crates for HT32F5XXXX devices
-
lp5018
no_std driver for the lp5018 i2c LED driver
-
imxrt-dma
DMA driver for i.MX RT processors
-
embedded-nal-minimal-coaptcpserver
A minimal CoAP-over-TCP server implementation built on embedded-nal
-
embedded-nal-async
An Async Network Abstraction Layer (NAL) for Embedded Systems
-
embedded-profiling
Profiling for
no-std
embedded targets -
embedded-can
HAL traits for Controller Area Network (CAN) devices
-
max170xx
Platform-agnostic Rust driver for the MAX170xx 1-cell/2-cell fuel-gauge systems with ModelGauge for lithium-ion (Li+) batteries. Compatible with MAX17043, MAX17044, MAX17048 MAX17049, MAX17058 and MAX17059
-
atsam4lc4b-pac
Peripheral access crate for the ATSAM4LC4B microcontroller
-
riscv-pac
Low level access to RISC-V processors
-
mwatch-kernel-stm32l4
A embedded 'Smart' watch
-
usb-host
Traits for USB host driver development
-
xca9548a
Platform-agnostic Rust driver for the TCA954xA and PCA954xA I2C switches/multiplexers
-
i2cdriver
Use Excamera I2CDriver and I2CMini devices from Rust, optionally via embeddded-hal traits
-
bl702-hal
HAL for the Bouffalo Lab BL702 microcontroller family
-
mcumeter
Firmware for my MCU power meter based upon STM32F042 and INA260
-
nuttx-embedded-hal
Rust Embedded HAL for Apache NuttX RTOS
-
nrf52805-hal
HAL for nRF52805 microcontrollers
-
qingke-rt
Minimal runtime / startup for WCH's RISC-V MCUs, managed by the ch32-rs team
-
imxrt-uart-panic
Panic handler for i.MX RT that reports to UART
-
riscv-rt-macros
Attributes re-exported in
riscv-rt
-
snowgoons4809-device
Register access crate for ATmega4809. DO NOT USE unless you have a good reason.
-
utrace_parser
Instrumentation-based profiling library for embedded targets with async support
-
aemics-stm32g4xx-hal
Hardware abstraction layer (HAL) for STM32G473
-
lpc11xx-async-hal
Asynchronous HAL for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
groundhog
A rolling timer abstraction
-
cmim
Move your data to interrupt context
-
atsaml21g16b
Device crate for the Microchip ATSAML21G16B, generated from its SVD file
-
hx1230
Driver for the HX1230 display
-
cyw43-pio
RP2040 PIO SPI implementation for cyw43
-
tm4c123x
Peripheral access API for TI TM4C123x microcontrollers
-
topq
A Timeout Priority Queue
-
canadensis_encoding
A Cyphal implementation: Transfer encoding and decoding
-
edge-nal-std
A STD implementation of edge-nal based on
async-io
-
esp32s3-ulp
Peripheral access crate for the ESP32-S3's RISC-V ULP coprocessor
-
lps22hb
A platform agnostic driver to interface with LPS22HB pressure sensor module
-
nrf5340-app-hal
HAL for nRF5340 app SoC
-
esp-riscv-rt
Minimal runtime / startup for RISC-V CPUs from Espressif
-
clint
CLosure INTerrupt handlers
-
imxrt1062-lcdif
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
gfx-xtra
embedded-graphics xtras
-
atsamd11c
Peripheral access API for ATSAMD11C microcontrollers (generated using svd2rust)
-
microasync
Very small async runner
-
std-embedded-nal-async
embedded-nal-async
traits for large devices that support the standard library -
efm32pg1b100-pac
Peripheral access API for EFM32PG1B100 MCU (generated using svd2rust)
-
atsam3n1b
Peripheral access API for ATSAM3N1B microcontrollers (generated using svd2rust)
-
atsams70q21
Peripheral access API for ATSAMS70Q21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
cpuio
Bare metal (no_std) inb, outb, inw, outw, inl, outw instructions with Rust-like API
-
microamp-tools
Build a μAMP application
-
sevensegment
A platform agnostic driver to interface with 7-segment LED displays
-
bme68x-rust
interacting with Bosch BME68x chips over I2C and SPI
-
probe-rs-rtt
Host side implementation of the RTT (Real-Time Transfer) I/O protocol over probe-rs
-
atsam4lc8a-pac
Peripheral access crate for the ATSAM4LC8A microcontroller
-
apa102-spi
SPI-based Driver for apa102 leds
-
atsams70j19
Peripheral access API for ATSAMS70J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
s32k144w-pac
Device Support Crate for NXP S32K144W Devices
-
icm20948-async
Async driver for the ICM20948 (Imu+Mag) for no_std environments
-
atsamd-usb-host
usb-host driver support for Atmel SAMD* microcontrollers
-
embassy-net-esp-hosted
embassy-net driver for ESP-Hosted
-
nrf-hal
Hardware abstraction layer for Nordic nRF5x chips
-
hitde-sys
Hi35XX TDE API for Rust unsafe bindings
-
ruspiro-gpio
This crates provides a GPIO peripheral abstraction of the Raspberry Pi
-
escw-mcu-stm32
Embedded software C wrapper of STM32
-
ruspiro-singleton
easy to use singleton pattern
-
stm32f2
Device support crates for STM32F2 devices
-
bern-arch
Bern RTOS hardware specific implementation
-
canadensis_linux
Linux SocketCAN compatibility for canadensis (Cyphal)
-
cardputer
M5Stack Cardputer
-
gmqtt
A no_std, no_alloc MQTTv5 packet parsing library for embedded devices
-
atsam3s8c
Peripheral access API for ATSAM3S8C microcontrollers (generated using svd2rust)
-
tmp1x2
Platform-agnostic Rust driver for the TMP102 and TMP112 digital temperature sensors
-
lunasoc-hal
Hardware Abstraction Layer implementation for LunaSoC cores
-
bl702-pac
Embedded Rust's Peripheral Access Crate for BL702/BL704/BL706 RISC-V BLE + Zigbee microcontroller
-
ds18b20
temperature sensor driver for embedded-hal
-
bhi160
driver for the Bosch Sensortec BHI160(B) smart sensors
-
phm-icd
The Interface Control Document (ICD) for Pretty HAL Machine
-
embedded-storage-inmemory
An in-memory implementation of embedded-storage
-
kiibohd-usb
Kiibohd USB HID Interface
-
wasefire-protocol-usb
Wasefire USB protocol between platform and host
-
mpr121-hal
MPR121 proximity capacitive touch sensor controller hal driver implementation
-
atsamd21j
Peripheral access API for ATSAMD21J microcontrollers (generated using svd2rust)
-
smccc
Functions and constants for the Arm SMC Calling Convention (SMCCC) 1.4 and Arm Power State Coordination Interface (PSCI) 1.1 on aarch64
-
choreographer
A color pattern sequencer, intended for groups of RGB LEDs
-
eeprom25aa02e48
Platform-agnostic Rust driver for the 25AA02E48 EEPROM
-
esp32c6-lp
Peripheral access crate for the ESP32-C6's LP coprocessor
-
tmag5170
A platform agnostic driver to interface with the TMAG5170-Q1 (3D hall sensor)
-
lora-e5-bsp
Board support package for the seeed LoRa-E5 development kit
-
fundamentum-edge-mcu-http-client
An HTTP Client for provisioning EdgeMCU devices
-
drone-stm32-map-periph-dma
STM32 peripheral mappings for Drone, an Embedded Operating System
-
efm32jg1b-pac
Peripheral access API for EFM32JG1B MCU (generated using svd2rust)
-
ruspiro-uart
convinient access API to the Raspberry Pi 3 UART0 (PL011) and UART1 (miniUART) peripherals
-
flem-serial-rs
A serial port implementation of the FLEM protocol for host computers running Windows, Linux, or MacOS
-
wasefire-error
Wasefire API errors
-
embedded-storage-async
A Storage Abstraction Layer for Embedded Systems
-
wasefire-cli
Wasefire CLI to manage applets and platforms
-
wasefire-cli-tools
Command-line utilities for Wasefire
-
atsams70j20
Peripheral access API for ATSAMS70J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
probe-run
Runs embedded programs just like native ones
-
cortex-m-asm
ASM intrinsics for Cortex-M CPUs
-
lis2dw12
A no_std compatible Rust driver for the low power ST 3-Axis MEMS 14-bit accelerometer LIS2DW12 using the SPI bus in async or blocking mode
-
drone-cortex-m
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
gd32f3
Device support crates for GD32F3 devices
-
gd32f4
Device support crates for GD32F4 devices
-
atsam4ls8a-pac
Peripheral access crate for the ATSAM4LS8A microcontroller
-
efm32pg12b500-pac
Peripheral access API for EFM32PG12B500 MCU (generated using svd2rust)
-
ina3221
Embedded driver for INA3221 triple-channel power monitor
-
atsam4ls2b-pac
Peripheral access crate for the ATSAM4LS2B microcontroller
-
embedded-crc-macros
Macros implementing portable CRC calculation algorithms for use in no_std
-
embassy-time-queue-utils
Timer queue driver trait for embassy-time
-
bossa
Rust cxx wrapper around BOSSA SAM-BA library
-
embedded-io-adapters
Adapters between the
embedded-io
traits and other I/O traits -
mcp4x
Platform-agnostic Rust driver for the MCP4x digital potentiometers
-
liboscore-cryptobackend
libOSCORE's cryptographic primitives backend based on Rust implementations
-
mlx9061x
Platform-agnostic Rust driver for the MLX90614 and MLX90615 non-contact infrared thermometers
-
ke06z4-pac
PAC for NXP Kinetis MKE06Zx microcontrollers
-
bme280-multibus
BME280 driver with support for SPI and I2C
-
brotli-no-stdlib
brotli decompressor that does not use the rust stdlib. This makes it suitable for embedded devices and kernels. It is designed with a pluggable allocator so that the standard lib's allocator may be employed…
-
bh1730fvc
no-std driver for the BH1730FVC ambient light sensor
-
atsaml21e18a
Device crate for the Microchip ATSAML21E18A, generated from its SVD file
-
stmpe1600
Platform-agnostic Rust driver for the STMPE1600 I/O expander
-
embassy-boot-rp
Bootloader lib for RP2040 chips
-
nrf52811-hal
HAL for nRF52811 microcontrollers
-
probe-rs-t2rust
A collection of ARM chips for the
probe-rs
crate -
hifive1
Board support crate for HiFive1 and LoFive boards
-
gd32e5
Device support crate for GD32E5 devices
-
mutex-trait
Foundational mutex trait and helpers
-
fancp
Types and methods for parsing/ creating Fan Control Protocol messages
-
lcd1602_gpio
Abstraction layer for interfacing between raspberry pi and the lcd1602 - 16x2 lcd display module through GPIO
-
stm32h5
Device support crates for STM32H5 devices
-
tudelft-lm3s6965-pac
Customized version of the lm3s6965 PAC to also provide interrupt support. Manually fixed SVD generation bugs.
-
s32k142w-pac
Device Support Crate for NXP S32K142W Devices
-
microasync-rt
A runtime for the very small async runner
-
oled_async
Driver for various OLED display controllers. e.g. SH110x SSD130X works with embedded-graphics
-
arduino_mkrzero
Board Support crate for the Arduino MKRZERO
-
ch32v0
Device support crates for CH32V0 devices
-
efm32zg-pac
Peripheral access API for EFM32ZG MCU (generated using svd2rust)
-
xgzp6897d
i2c Driver for the XGZP6807D differential pressure sensor
-
gyuvl53l0x
driver for the VL53L0X (Time-of-Flight I2C laser-ranging module)
-
ch32l1
Device support crates for CH32L1 devices
-
gd32vf103xx-hal
HAL for GD32VF103 microcontrollers
-
atsamd51g
Peripheral access API for ATSAMD51G microcontrollers (generated using svd2rust)
-
stm32f407g-disc
Board support crate for the STM32F407G DISCOVERY microcontroller board
-
ral
Base layer for generated libraries for specific MCUs
-
riscv-semihosting
Semihosting for RISCV processors
-
bq2515x
Device driver for the BQ2515x family of Texas Instruments linear battery chargers
-
stm32l0
Device support crates for STM32L0 devices
-
noproto
no-std, no-alloc protocol buffers implementation for embedded systems
-
inverted-pin
Embedded-hal input/output pin trait implementations with inverted level logic
-
lm4f120
A set of drivers for writing bare-metal code for the Texas Instruments LM4F120
-
ovl-atsamx7x-hal
HAL and peripheral access API for ATSAME70 microcontrollers
-
onewire
using embedded_hal as abstraction layer, based on arduino OneWire library. WIP
-
cortex-r
Low level access to Cortex-R processors
-
nrf-softdevice-s140
Low-level bindings for the Nordic nRF SoftDevice S140
-
xtensa-lx
Low-level access to Xtensa LX processors and peripherals
-
ufmt-write
μfmt
’suWrite
trait -
kolben
A collection of COBS
-
lcd1604_gpio
Abstraction layer for interfacing between Raspberry Pi and 16x2 or 16x4 LCD display modules through GPIO
-
rtic-common
lib TODO
-
embassy-usb-driver
Driver trait for
embassy-usb
, an async USB device stack for embedded devices -
zorio
Subset of standard library I/O ported to no_std
-
stm32l1
Device support crates for STM32L1 devices
-
lilos-semaphore
A counting semaphore for use with lilos
-
rpi-mh-z19c-exporter
Export CO2 concentration measured with a Winsen MH-Z19C sensor on a Raspberry Pi to Prometheus
-
kiibohd-hid-io
HID-IO protocol implementation for the C kiibohd firmware
-
mips-mcu
Low level access to MIPS MCU cores
-
embedded-qmp6988
Platform-agnostic Rust driver for the QMP6988 barometric pressure sensor
-
embassy-net-wiznet
embassy-net driver for WIZnet SPI Ethernet chips
-
hftwo
working with the HF2 protocol
-
canadensis_pnp_client
Client library for Cyphal plug-and-play node ID allocation
-
teleprobe-meta
Embed teleprobe metadata into ELF binaries
-
gd32e1
Device support crate for GD32E1 devices
-
tmp006
Platform-agnostic Rust driver for the TMP006/TMP006B non-contact infrared (IR) thermopile temperature sensor
-
atsamd51p
Peripheral access API for ATSAMD51P microcontrollers (generated using svd2rust)
-
nucleo-wl55jc-bsp
Board support package for the NUCLEO-WL55JC
-
max116xx-10bit
Driver crate for the MAX116xx 10-bit ADC devices
-
psp
building full PSP modules, including both PRX plugins and regular homebrew apps
-
imxrt1062-pmu
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
esp32s2-ulp
Peripheral access crate for the ESP32-S2's RISC-V ULP coprocessor
-
opensensor
streaming and archiving measurements from sensors
-
ws2812-async
Async SPI driver for ws2812 leds
-
peripherals
Microcontroller peripherals definition and ergonomic access
-
nrf5340-net-hal
HAL for nRF5340 net SoC
-
panic-semihosting
Report panic messages to the host stderr using semihosting
-
atsam4lc2c-pac
Peripheral access crate for the ATSAM4LC2C microcontroller
-
microbit-bsp
An embassy-based boards support package (BSP) for BBC Micro:bit v2
-
ms8607
A platform agnostic driver for the MS8607 Pressure, Temperature, and Humidity Sensor from TE Connectivity
-
atsaml21j17bu
Device crate for the Microchip ATSAML21J17BU, generated from its SVD file
-
drone-stm32-map-periph-exti
STM32 peripheral mappings for Drone, an Embedded Operating System
-
rp2040-monotonic
RTIC Monotonic implementation based on RP2040's Timer peripheral
-
efm32jg12b-pac
Peripheral access API for EFM32JG12B MCU (generated using svd2rust)
-
si1145
No-std driver for the Si1145 ambient light sensor
-
esp8266-hal
HAL for ESP8266 microcontrollers
-
kll-core
KLL state-machine implementation focused on no_std embedded/bare-metal targets
-
rzcobs
Reverse-Zerocompressing-COBS encoding
-
tm4c129x
Peripheral access API for TI TM4C129x microcontrollers
-
lpc55s6x-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
tt21100
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
rv64emu
A riscv64 emulator written in rust,it can run on Linux, Windows and MacOS. Even on the embedded device, such as
ESP32
andSTM32
which support Embeded RUST -
stm32f3-copterust
Device support crates for STM32F3 devices
-
f3
Board Support Crate for the STM32F3DISCOVERY
-
stm32-device-signature
Device electronic signature 'driver' for STM32 microcontrollers
-
enc28j60
A platform agnostic driver to interface the ENC28J60 (Ethernet controller)
-
sh1106
I2C/SPI driver for the SH1106 OLED display controller
-
riscv-slic
RISC-V Software-Level Interrupt Controller
-
dps310
A platform agnostic driver to interface with the DPS310 barometric pressure & temp sensor through I2C
-
stm32f0
Device support crates for STM32F0 devices
-
tm4c-hal
Common bits of HAL for the TM4C123x/TM4C129x family of microcontrollers
-
emstr
Helpers for working with string types for embedded devices
-
atsam4lc2a-pac
Peripheral access crate for the ATSAM4LC2A microcontroller
-
spark-ser7seg
An embedded-hal driver for the SparkFun Serial 7 Segment Display
-
embassy-net-ppp
embassy-net driver for PPP over Serial
-
atsame53n
Peripheral access API for ATSAME53N microcontrollers (generated using svd2rust)
-
ch32x0
Device support crates for CH32X0 devices
-
ds1307
Platform-agnostic Rust driver for the DS1307 real-time clock
-
ruspiro-allocator
lightweight heap memory allocator for Raspberry Pi baremetal environments
-
rza1
Peripheral access API for the Renesas RZ/A1 MPU family
-
embedded-platform
Holistic embedded device support in a batteries-included manner
-
lilos-list
Allocation-free intrusive doubly-linked wait queues for lilos
-
imxrt1062-ccm-analog
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
tsic
Platform-agnostic access to TSIC sensors via embedded-hal
-
dht-sensor
Driver for the DHT11/DHT22 sensor based on embedded-hal
-
d1-mini
A Board Support Package (BSP) which provides a type-safe API for the WEMOS/LOLIN D1 mini
-
stm32wl
Device support crates for STM32WL devices
-
efm32pg22-pac
Peripheral access API for EFM32PG22 MCU (generated using svd2rust)
-
imxrt1062-pwm1
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
atsamd51n
Peripheral access API for ATSAMD51N microcontrollers (generated using svd2rust)
-
canadensis_crc
access to Cyphal software image CRCs
-
embassy-net-driver
Driver trait for the
embassy-net
async TCP/IP network stack -
ruspiro-interrupt
Providing a simple and convenient way to implement interrupt handler for Raspberry Pi interrupts
-
atsam4-hal
HAL for the ATSAM4 microcontrollers
-
embedded-error-chain
Easy error handling in no-alloc and no-std environments
-
atsam4ls4b-pac
Peripheral access crate for the ATSAM4LS4B microcontroller
-
panic-itm
Log panic messages using the ITM (Instrumentation Trace Macrocell)
-
atsaml21g18b
Device crate for the Microchip ATSAML21G18B, generated from its SVD file
-
probe-rs-targets
A collection of on chip debugging tools to comminicate with ARM chips
-
stm32l4-stm32hal
(Custom for stm32-hal) Device support crates for STM32L4 devices
-
embassy-time-queue-driver
Timer queue driver trait for embassy-time
-
embedded-trace
A Future tracing utility for embedded systems
-
nrf-softdevice-s132
Low-level bindings for the Nordic nRF SoftDevice S132
-
hts221
Interface to ST Micro HTS221 humidity and temperature sensor
-
drone-stm32-map-periph-i2c
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsamd11d
Peripheral access API for ATSAMD11D microcontrollers (generated using svd2rust)
-
atsame70j19b
Peripheral access API for the ATSAME70J19B MCU from Microchip (generated using svd2rust 0.29.0)
-
drone-stm32-map-pieces-4
STM32 peripheral mappings for Drone, an Embedded Operating System
-
kiibohd-hall-effect
Analysis crate for intepreting hall-effect keyboard switches (e.g. Silo Switches)
-
xuantie
Low level access to T-Head XuanTie RISC-V processors
-
mcp49xx
Platform-agnostic Rust driver for the MCP49xx and MCP48xx digital-to-analog converters (DAC)
-
drone-svd
CMSIS-SVD parser for Drone, an Embedded Operating System
-
l3gd20-registers
A typed map of the STMicroelectronics L3GD20 Gyroscope registers
-
wasefire-protocol
Wasefire protocol between platform and host
-
nrf-smartled
A Smart LED (WS2812) driver using hardware acceleration
-
ruspiro-boot
Bare metal boot strapper code for the Raspberry Pi 3 to conviniently start a custom kernel within the Rust environment without the need to deal with all the initial setup like stack pointers…
-
atsam4ls4c-pac
Peripheral access crate for the ATSAM4LS4C microcontroller
-
ws2812-timer-delay
Timer-based driver for ws2812 leds
-
gemma_m0
Board Support crate for the Adafruit Gemma M0
-
nrf52-hal-common
Common HAL for the nRF52 family of microcontrollers. More specific HAL crates also exist.
-
stm32f30x
Peripheral access API for STM32F30X microcontrollers
-
async-stm32f1xx
Abstractions for asynchronous programming on the STM32F1xx family of microcontrollers
-
stm32l5
Device support crates for STM32L5 devices
-
wasefire-applet-api
Low-level Wasefire applet API
-
iso-tp
Async ISO-TP (ISO 15765-2) implementation for embedded devices
-
imxrt1062-usb1
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
samd21_mini
Board Support crate for the Sparkfun SAMD21 Mini Breakout
-
nrf-softdevice-s112
Low-level bindings for the Nordic nRF SoftDevice S112
-
atsaml21e16b
Device crate for the Microchip ATSAML21E16B, generated from its SVD file
-
atsam4lc4a-pac
Peripheral access crate for the ATSAM4LC4A microcontroller
-
ch58x
Device support crates for CH58X devices
-
wio_lite_w600
Board Support crate for the Wio Lite W600
-
lilos-watch
Cheap sharing with change notification for lilos
-
aligned
A newtype with alignment of at least
A
bytes -
atsame51n
Peripheral access API for ATSAME51N microcontrollers (generated using svd2rust)
-
atsame70n19
Peripheral access API for ATSAME70N19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
drone-stm32-map-periph-spi
STM32 peripheral mappings for Drone, an Embedded Operating System
-
esp-wifi-sys
Bindings to Espressif's WiFi and Bluetooth low-level drivers
-
kiibohd-hall-effect-keyscanning
Hall Effect keyscanning for strobed matrices
-
ssd1331
I2C/SPI driver for the SSD1331 OLED display controller
-
atsame53j
Peripheral access API for ATSAME53J microcontrollers (generated using svd2rust)
-
stm32wb-stm32hal
(Custom for stm32-hal) Device support crates for STM32WB devices
-
mcp794xx
Platform-agnostic Rust driver for the MCP794xx real-time clock / calendar (RTC) family. Compatible with MCP7940N, MCP7940M, MCP79400, MCP79401, MCP79402, MCP79410, MCP79411 and MCP79412.
-
atsam4lc2b-pac
Peripheral access crate for the ATSAM4LC2B microcontroller
-
gd32f3x0-pac
Peripheral access API for GD32F3x0 chips (generated using svd2rust)
-
atsame51j
Peripheral access API for ATSAME51J microcontrollers (generated using svd2rust)
-
is31fl3743b
Bare-metal no_std driver for the Lumissil IS31FL3743B
-
kll-hid
USB HID enum mapping for kll-core
-
vexriscv
Low level access to the VexRiscv processor
-
kll-compiler
KLL (Keyboard Layout Language) Compiler - Rust Edition
-
imxrt1062-system-control
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
stm32mp1
Device support crates for STM32MP1 devices
-
nrf-softdevice-s113
Low-level bindings for the Nordic nRF SoftDevice S113
-
spi-memory-async
A generic driver for different SPI Flash and EEPROM chips
-
stm32wb
Device support crates for STM32WB devices
-
k210-pac
Peripheral access API for K210 SoC
-
atsaml21g17b
Device crate for the Microchip ATSAML21G17B, generated from its SVD file
-
atsam4lc8b-pac
Peripheral access crate for the ATSAM4LC8B microcontroller
-
hardware-registers
Generic, embedded-friendly hardware registers support, including traits and types for understanding I2C registers
-
atsame54n
Peripheral access API for ATSAME54N microcontrollers (generated using svd2rust)
-
sps30-i2c
Platform-agnostic Rust driver for the SPS30 particulate matter sensor
-
st7567s
Driver for the ST7567S LCD controller
-
embedded-ccs811
Platform-agnostic Rust driver for the CCS811 ultra-low power digital gas sensor for monitoring indoor air quality
-
esp32p4
Peripheral access crate for the ESP32-P4
-
esp32c2-hal
HAL for ESP32-C2 microcontrollers
-
drone-stm32-map-periph-rtc
STM32 peripheral mappings for Drone, an Embedded Operating System
-
mma8x5x
Platform-agnostic Rust driver for the MMA8451, MMA8452, MMA8453, MMA8652 and MMA8653 tri-axis accelerators
-
atsame70n19b
Peripheral access API for the ATSAME70N19B MCU from Microchip (generated using svd2rust 0.28.0)
-
ch32v1
Device support crates for CH32V1 devices
-
esp32-hal
HAL for ESP32 microcontrollers
-
ruspiro-i2c
Raspberry Pi - I²C bus interface implementation
-
atsam4s16c-pac
Peripheral access crate for the ATSAM4S16C microcontroller
-
canadensis_core
A Cyphal implementation: Common definitions
-
tm4c123x-hal
HAL for the TM4C123x family of microcontrollers
-
nrf-softdevice-s122
Low-level bindings for the Nordic nRF SoftDevice S122
-
imxrt1062-usdhc1
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
gd32c1
Device support crate for GD32C1 devices
-
atsam4sp32a-pac
Peripheral access crate for the ATSAM4SP32A microcontroller
-
cortex-m-quickstart
A template for building applications for ARM Cortex-M microcontrollers
-
ch32v3
Device support crates for CH32V3 devices
-
si4703
Platform-agnostic Rust driver for the Si4703 and Si4702 FM radio turners (receivers)
-
esp32s3-hal
HAL for ESP32-S3 microcontrollers
-
feather_m0
Board Support crate for the Adafruit Feather M0
-
esp32c3-hal
HAL for ESP32-C3 microcontrollers
-
atsame51g
Peripheral access API for ATSAME51G microcontrollers (generated using svd2rust)
-
mm32f5
Peripheral access API for MM32F5270 and MM32F5280 microcontrollers
-
esp8266
Peripheral access crate for the ESP8266
-
kiibohd-keyscanning
Kiibohd gpio keyscanning module for momentary push button switches (keyboards)
-
atsam4n16b-pac
Peripheral access crate for the ATSAM4N16B microcontroller
-
atsam4n16c-pac
Peripheral access crate for the ATSAM4N16C microcontroller
-
imxrt1180evk-fcb
FlexSPI configuration block for NXP's IMXRT1180EVK
-
imxrt1062-adc-etc
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
nrf-softdevice-mbr
Low-level bindings for the MBR included in all Nordic nRF SoftDevices
-
atsamv71j21b
Peripheral access API for the ATSAMV71J21B MCU from Microchip (generated using svd2rust 0.28.0)
-
feather_m4
Board Support crate for the Adafruit Feather M4
-
arduino_nano33iot
Board Support crate for the Arduino Nano 33 IOT
-
drone
CLI utility for Drone, an Embedded Operating System
-
esp32s2-hal
HAL for ESP32-S2 microcontrollers
-
drone-stm32-map-pieces-6
STM32 peripheral mappings for Drone, an Embedded Operating System
-
hid-io-protocol
HID-IO protocol implementation for both servers and devices. Devices are optimized for Cortex-M devices, but may work for other platforms
-
ch32v2
Device support crates for CH32V2 devices
-
atsamd51j20a
Peripheral access API for ATSAMD51J20A microcontrollers (generated using svd2rust)
-
metro_m4
Board Support crate for the Adafruit Metro M4
-
imxrt1062-pxp
imxrt1062-pac subcrate. See the imxrt1062-pac for more details. This crate is not maintained. Consider using the register access layer provided by the imxrt-rs…
-
atsam4n8c-pac
Peripheral access crate for the ATSAM4N8C microcontroller
-
drone-nrf-map-periph-uarte
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
atsam4s16b-pac
Peripheral access crate for the ATSAM4S16B microcontroller
-
drone-stm32-map-pieces-11
STM32 peripheral mappings for Drone, an Embedded Operating System
-
tm4c129x-hal
HAL for the TM4C129x family of microcontrollers
-
arduino_mkrvidor4000
Board Support crate for the Arduino MKR VIDOR 4000
-
atsam4e8e-pac
Peripheral access crate for ATSAM4E8E microcontrollers
-
ch56x
Device support crates for CH56X devices
-
ruspiro-cache
Raspberry Pi cache maintenance operation API
-
ch59x
Device support crates for CH59X devices
-
cortex-m-semihosting
Semihosting for ARM Cortex-M processors