-
portable-atomic
Portable atomic types including support for 128-bit atomics, atomic float, etc
-
embedded-hal
A Hardware Abstraction Layer (HAL) for embedded systems
-
elf
A pure-rust library for parsing ELF files
-
postcard
A no_std + serde compatible message library for Rust
-
rhai
Embedded scripting for Rust
-
embedded-hal-mock
A collection of mocked devices that implement the embedded-hal traits
-
fixed
Fixed-point numbers
-
smoltcp
A TCP/IP stack designed for bare-metal, real-time systems without a heap
-
critical-section
Cross-platform critical section
-
oorandom
A tiny, robust PRNG implementation
-
espflash
A command-line tool for flashing Espressif devices
-
riscv
Low level access to RISC-V processors
-
defmt
A highly efficient logging framework that targets resource-constrained devices, like microcontrollers
-
embedded-graphics
Embedded graphics library for small hardware displays
-
gdbstub
GDB Remote Serial Protocol in Rust
-
embassy-sync
no-std, no-alloc synchronization primitives with async support
-
aligned
A newtype with alignment of at least
A
bytes -
pc-keyboard
PS/2 keyboard interface library
-
microfft
Embedded-friendly Fast Fourier Transforms
-
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
-
pio
Support for the Raspberry Silicon RP2040's PIO State Machines
-
embedded-graphics-simulator
Embedded graphics simulator
-
stm32-hal2
Hardware abstraction layer for the STM32 MCUs
-
semihosting
AArch64, Arm, RISC-V, MIPS32, MIPS64, and Xtensa
-
rp2040-hal
Embedded-HAL impl for the rp2040 microcontroller
-
flip-link
Flips the memory layout of embedded programs to protect against stack overflows
-
probe-rs
A collection of on chip debugging tools to communicate with microchips
-
stm32f4xx-hal
Peripheral access API for STM32F4 series microcontrollers
-
vmm-sys-util
A system utility set
-
atomic
Generic Atomic<T> wrapper type
-
esp-backtrace
Bare-metal backtrace support for Espressif devices
-
aarch64-cpu
Low level access to processors using the AArch64 execution state
-
managed
An interface for logically owning objects, whether or not heap allocation is available
-
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…
-
embedded-storage
A Storage Abstraction Layer for Embedded Systems
-
rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
northstar
container runtime for Linux targetting embedded systems
-
stm32-fmc
Hardware Abstraction Layer for STM32 Memory Controllers (FMC/FSMC)
-
rtt-target
Target side implementation of the RTT (Real-Time Transfer) I/O protocol
-
eeprom24x
Platform-agnostic Rust driver for the 24x series serial EEPROMs
-
sequential-storage
storing data in flash with minimal erase cycles
-
fugit
Time library for embedded targets with ease-of-use and performance first
-
spidev
access to the Linux spidev interface. This interface allows for configuration of the spidev device, half-duplex SPI access, and full-duplex SPI access.
-
tock-registers
Memory-Mapped I/O and register interface developed for Tock
-
embassy-executor
async/await executor designed for embedded usage
-
imxrt-iomuxc
Pad configuration interface for NXP i.MX RT processors. Part of the imxrt-rs project
-
ftdi-embedded-hal
embedded-hal implementation for FTDI USB devices
-
stm32h7xx-hal
Hardware Abstraction Layer implementation for STM32H7 series microcontrollers
-
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…
-
smlang
A no-std state machine language DSL
-
avr-device
Register access crate for AVR microcontrollers
-
rppal
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals
-
embedded-text
TextBox for embedded-graphics
-
atat
AT Parser for serial based device crates
-
pinned-init
facilitate safe pinned initialization
-
miniconf
Serialize/deserialize/access reflection for trees
-
nickel-lang-cli
The Nickel interpreter CLI
-
stm32-eth
Embedded Rust Ethernet driver for the STM32 MCU series
-
cobs
Consistent Overhead Byte Stuffing (COBS) algorithm. COBS is an algorithm for transforming a message into an encoding where a specific value (the "sentinel" value) is not used…
-
industrial-io
Linux Industrial I/O (IIO) Support
-
espup
installing and maintaining Espressif Rust ecosystem
-
imxrt-ral
Register access layer for all NXP i.MX RT microcontrollers
-
embedded-nano-mesh
Lightweight mesh communication protocol for embedded devices
-
updatehub-package-schema
UpdateHub Packages metadata schemas
-
jep106
A pollable collection of all JEP106 manufacturer codes
-
drmemd
Main process of the DrMem control system
-
pinenote_dbus_service
A DBus service for the Pine64 Pinenote
-
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…
-
atsame54_xpro
Board Support crate for the SAM E54 Xplained Pro Evaluation Kit
-
coap-lite
A lightweight CoAP message manipulation crate, ideal for embedded environments
-
aht20-driver
Rust embedded-hal driver for the AHT20 temperature and humidity sensor
-
automotive_diag
Unified Diagnostic Services/UDS (ISO-14229-1), KWP2000 (ISO-142330) and OBD-II (ISO-9141) definitions to communicate with the road vehicle ECUs in Rust
-
ev3dev-lang-rust
Rust language bindings for ev3dev
-
device-driver
A toolkit to write better device drivers, faster
-
statime
Precision Time Protocol implementation library for embedded and desktops
-
epd-waveshare
An embedded-hal based driver for ePaper displays from Waveshare formerly published as eink-waveshare-rs
-
sbi-spec
Definitions and constants in the RISC-V Supervisor Binary Interface (RISC-V SBI)
-
rustc-build-sysroot
Build a rustc sysroot with custom flags
-
delog
Deferred logging, an implementation and extension of Rust's standard logging facade
-
ufix
Flexible and usable generic fixed-point numeric type
-
w5500
IoT Controller implementation
-
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
-
nrf-hal-common
details of the nRF HAL crates. Don’t use this directly, use one of the specific HAL crates instead (
nrfXYZ-hal
). -
edge-dhcp
Async +
no_std
+ no-alloc implementation of the DHCP protocol -
s2json
supports the S2JSON 1.0 Specification
-
mustang
Rust programs written entirely in Rust
-
libc_alloc
global allocator which hooks into libc's malloc/free
-
littlefs2
Idiomatic Rust API for littlefs
-
trellis_m4
Board Support crate for the Adafruit NeoTrellis M4 Express
-
os-terminal
Beautiful terminal emulator on no-std environment
-
rlsf
Real-time dynamic memory allocator based on the TLSF algorithm
-
bme280
device driver for the Bosch BME280 temperature, humidity, and atmospheric pressure sensor and the Bosch BMP280 temperature, and atmospheric pressure sensor
-
rpsp
small, but extensible platform support package for RP2040 devices
-
osdemo
An example of combining various libraries for aarch64 OS development
-
buoyant
SwiftUI-like UIs in Rust for embedded devices
-
dlt-core
Parser and writer for autosar DLT Diagnostic Log and Trace
-
gpt_disk_io
GPT (GUID Partition Table) disk IO no_std library
-
esp32-nimble
A wrapper for the ESP32 NimBLE Bluetooth stack
-
utralib
Xous UTRA (Unambiguous Thin Register Abstration) library generator
-
flipperzero
Flipper Zero
-
minimq
A minimal MQTT5 client designed for no_std platforms
-
psx
developing homebrew for the Sony PlayStation 1
-
uwheel
Embeddable Aggregate Management System for Streams and Queries
-
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.
-
esp-wifi
A WiFi, Bluetooth and ESP-NOW driver for use with Espressif chips and bare-metal Rust
-
ina226-tp
Rust Driver for device INA226 High-Side or Low-Side Measurement, Bi-Direcional Current and Power Monitor
-
port-expander
Abstraction for I2C port-expanders
-
py32f0xx-hal
Peripheral access API for py32F0 series microcontrollers
-
py32-hal
HAL and Embassy support for the Py32 family of microcontrollers
-
embassy-futures
no-std, no-alloc utilities for working with futures
-
ravedude
easily flash code onto an AVR microcontroller with avrdude
-
buddy-alloc
memory allocator for no-std Rust, used for embedded environments
-
ws2812-spi
SPI-based driver for ws2812 leds
-
embive
A lightweight, recoverable sandbox for executing untrusted RISC-V code in constrained environments (ex.: microcontrollers)
-
embedded-sdmmc
A basic SD/MMC driver for Embedded Rust
-
gd32f1x0-hal
HAL for the GD32F1x0 family of microcontrollers
-
heretek
GDB TUI Dashboard for the understanding of vast knowledge
-
cmsis-pack
managing CMSIS Packs
-
bluerobotics-ping
serves as the entry point for embedding applications using Rust on Blue Robotics's Ping devices family
-
rhai-dylib
Dylib support for Rhai
-
interpn
N-dimensional interpolation/extrapolation methods, no-std and no-alloc compatible
-
teensy4-bsp
Rust-based BSP for the Teensy 4. Part of the teensy4-rs project
-
itm-parser
A command-line tool to parse and format ITM (Instrumentation Trace Macrocell) output for embedded systems development using probe-rs
-
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.
-
dcmimu
no_std DCM IMU implementation
-
biquad
digital second order IIR filtrers, also known as biquads
-
adafruit-seesaw
Platform-agnostic implementation for communicating with devices that run the Seesaw firmware
-
efm32pg1b-pac
Peripheral access API for Silicon Labs EFM32PG1B microcontrollers
-
esp-println
print!
andprintln!
implementations various Espressif devices -
ohos-drawing-sys
Bindings to the
native_drawing
API of OpenHarmony OS -
rp235x-hal
Embeded-HAL impl for the RP2350 microcontroller
-
hx711_spi
A platform agnostic driver to interface with the HX711 using SPI
-
moondancer
firmware for the Great Scott Gadgets Cynthion USB Test Instrument
-
va108xx
PAC for the Vorago VA108xx family of microcontrollers
-
mimxrt685s-pac
Peripheral Access Crate for MIMXRT685s devices
-
esp-at-nal
Network layer client for ESP-AT modems
-
morse-codec
live decoding and encoding of morse code messages. Supports multiple embedded devices and operating systems by being no_std.
-
windows_i686_gnu
Import lib for Windows
-
lis3dh-async
An embedded-hal-async driver for the LIS3DH accelerometer
-
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.
-
svdtools
modifying bugs in CMSIS SVD
-
nrf-modem
Async modem api for the nRF91xx
-
embedded-alloc
A heap allocator for embedded systems
-
mcan
Unofficial MCAN Hardware Abstraction Layer
-
thebakery
Build engine for the Yocto/OE Projects
-
nmea0183
NMEA 0183 parser targetting mostly embedded devices but not limited to
-
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).
-
py32f0
Device support crates for PY32F0 devices
-
atomic-maybe-uninit
Atomic operations on potentially uninitialized integers
-
wlink
WCH-Link flash tool for WCH's RISC-V MCUs(CH32V, CH56X, CH57X, CH58X, CH59X, CH32L103, CH32X035, CH641, CH643)
-
embedded-nal
A Network Abstraction Layer (NAL) for Embedded Systems
-
microbit
Board support crate for the BBC Micro:bit V1
-
task-watchdog
A robust, flexible watchdog management library for embedded systems that multiplexes multiple task watchdogs into a single hardware watchdog timer, preventing system lockups when tasks fail to respond
-
lpc55-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
hifmt
Format output without Rust code segment in binary to reduce the ultimate binary size
-
aligned-array
A newtype with alignment of at least
A
bytes -
max7800x-hal
A Hardware Abstraction Layer for the MAX7800X microcontroller family
-
xmc4300
XMC peripheral library for XMC4300 generated from SVD
-
cyclors
Low-level API for the native CycloneDDS bindings (libddsc-sys)
-
sgp30
Platform agnostic Rust driver for the Sensirion SGP30 gas sensor
-
ushell
Embedded shell over serial connection
-
embedded-aht20
Platform-agnostic Rust driver for the AHT20 temperature & humidity sensor
-
esp-idf-svc
embedded-svc traits for ESP-IDF (Espressif's IoT Development Framework)
-
nickel-lang-lsp
NLS: A language server for the Nickel configuration language
-
ws2812-esp32-rmt-driver
WS2812 driver using ESP32 RMT
-
sen6x
no-std driver for the SEN6X sensor modules
-
nrf24-rs
Platform agnostic Rust driver for the nRF24L01 2.4 GHz transciever for wireless communication between embedded devices
-
fdt
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
max7219
A platform agnostic driver to interface the MAX7219 (LED driver)
-
u8g2-fonts
A text renderer for embedded-graphics, based on U8g2
-
mcp4728
Platform agnostic rust driver for the MCP4728 4-channel, 12-bit I2C DAC
-
lis2dh12
Platform-agnostic Rust driver for the LIS2DH12 accelerometer
-
embedded-websocket
A lightweight websocket library for embedded systems (no_std)
-
redox-scheme
writing Redox scheme daemons
-
embedded-canvas
Draw anything with ease on the Canvas before drawing it to your small hardware display
-
scpi
SCPI/IEEE488.2 parser library
-
quadrature-decoder
Pure logic-level implementations of quadrature decoders with support for full-, half- an quad-stepping
-
embedded-test
A test harness and runner for embedded devices
-
flat_device_tree
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
lilos
A tiny embedded OS based around Futures and async
-
jelly-mem_access
Memory Mapped I/O access library
-
azure_mgmt_baremetalinfrastructure
generated REST API bindings
-
bno055
Bosch Sensortec BNO055 9-axis IMU driver
-
arm-gic
A driver for the Arm Generic Interrupt Controller version 2, 3 or 4
-
ellie_engine
Why ellie? Ellie is a type-safe programing language that runs on embedded and sandboxed environments
-
ciborium-ll
Low-level CBOR codec primitives
-
lsmtk
log-structured-merge-graph
-
embedded-huffman
A paginated, streaming library for Huffman coding on embedded
-
embedded-iconoir
1300+ icons for embedded-graphics, ported from the Iconoir icon pack
-
embedded-dht-rs
A driver for interfacing with DHT11, DHT20 (AHT20), DHT22 (AM2302) temperature and humidity sensors, designed for embedded systems
-
inky-frame
Driver and protocol library for InkyFrame devices with peripheral support
-
embedded-cli
CLI with autocompletion, help and history for embedded systems (like Arduino or STM32)
-
asciidork-dr-html-backend
Asciidork Asciidoctor HTML backend
-
authenticode
working with Authenticode (no-std)
-
arm-ffa
Arm Firmware Framework for Arm A-profile support library
-
trapframe
Handle Trap Frame across kernel and user space on multiple ISAs
-
form
A small script to move inline modules into the proper directory structure
-
rotary-encoder-hal
platform agnostic rotary encoder library using embedded_hal
-
byte
A low-level, zero-copy and panic-free serializer and deserializer for binary
-
pic8259
Abstractions for the 8259 and 8259A interrupt controllers
-
fdcan
STM32 FDCAN peripheral driver
-
astarte-device-sdk
that provides communication and pairing primitives to an Astarte Cluster
-
tinywasm
A tiny WebAssembly interpreter
-
mplusfonts
Parametrized bitmap font family for embedded-graphics
-
shared-mem-queue
Single-writer single-reader queues which can be used for inter-processor-communication in a shared memory region
-
stm32l0xx-hal
Peripheral access API for STM32L0 series microcontrollers
-
reqwless
HTTP client for embedded devices
-
a653rs
Arinc653 abstraction library for hypervisor independent partition programming
-
elf_loader
A pure-rust library for loading all ELF format files from both memory and files
-
dac8568
platform agnostic library for the Texas Instruments DAC8568, DAC8168 and DAC7568
-
dot15d4
IEEE 802.15.4 implementation in Rust
-
dht-pio
A DHT Implementation using PIO (Programmable Input/Output), tested on Rasberry Pi Pico
-
fixed32
Fixed Point types
-
kble-eb90
Virtual Harness Toolkit
-
libscd
Rust drivers for various SCD devices such as scd30 and scd4x CO2 sensors
-
fritzctrl
Command line utility for controlling AVM Fritz devices
-
usbd-dfu-rt
USB DFU run-time class
-
embassy-stm32-plus
embassy-stm32 plus
-
max78000-pac
A Peripheral Access Crate for the MAX78000 microcontroller
-
sht4x
Sensirion SHT4x Driver for Embedded HAL
-
kbuild
This package help you to build rust kernel quickly and easily
-
embedded-lora-rfm95
A
no-std
-compatible, opinionated driver for the RFM95 LoRa modem -
fdt-rs
A flattened device tree parser for embedded no-std environments
-
stateflow
extensible state machine implementation in Rust
-
dmx-rdm
communicating DMX512 (ANSI E1.11) and DMX-RDM (ANSI E1.20) over a RS485 bus by using interchangeable drivers
-
st7565
Driver for ST7565 based displays
-
bitfields
Macro for generating flexible bitfields. Useful for low-level code (embedded or emulators).
-
fast-trap
Provide a framework for bare-metal trap handling, aiming at ensuring performance while reusing code
-
rustsbi
Minimal RISC-V's SBI implementation library in Rust
-
atsamd-hal
HAL and Peripheral access API for ATSAMD11, ATSAMD21, ATSAMD51, ATSAME51, ATSAME53 and ATSAME54 microcontrollers
-
va108xx-hal
HAL for the Vorago VA108xx family of microcontrollers
-
libosdp
IEC 60839-11-5 OSDP (Open Supervised Device Protocol)
-
ruduino
Reusable components for AVR microcontrollers
-
quadrature-encoder
Hardware-level implementations of drivers for incremental encoders with support for full-, half- an quad-stepping
-
postcard-rpc
A no_std + serde compatible RPC library for Rust
-
stm32f4-staging
Device support crates for STM32F4 devices
-
const-fnv1a-hash
A #![no_std] crate for performing FNV1A-16/32/64/128 hashing on Rust stable at compile time
-
linux-embedded-hal
embedded-hal
traits for Linux devices -
rttmon
RTT monitor for OpenOCD
-
fixed-slice-vec
FixedSliceVec
is a dynamic length Vec with runtime-determined maximum capacity backed by a slice -
svd-generator
Converts device information from flattened device tree into an SVD description
-
vl53l0x
A platform agnostic driver to interface with the vl53l0x (time-to-flight sensor)
-
at-commands
AT Commands builder and parser for Rust #![no_std]
-
rawcode
Implements a simple as-is encoding format
-
embedded-sdmmc-dev
A basic SD/MMC driver for Embedded Rust
-
defmt-rtt
Transmit defmt log messages over the RTT (Real-Time Transfer) protocol
-
gc9a01-rs
SPI 4-wire driver for GC9A01 display controller
-
tiny-varint
A no_std compatible VarInt encoding/decoding Rust library
-
mcp2515
#![no_std]
library for interacting with MCP2515 CAN controller chips -
stm32_i2s_v12x
Driver for I2S communication (using SPI peripherals) for some STM32 microcontrollers
-
std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
mcp2003a
LIN transceiver driver with embedded-hal traits for no-std environments
-
imxrt-hal
Hardware abstraction layer for NXP i.MX RT microcontrollers
-
r2u2_core
R2U2: A stream-based runtime monitor in no_std
-
musb
musb(Mentor USB) regs and
embassy-usb-driver
,usb-device
impl -
mc-sst25
Microship SST25* flash memory series
-
ciborium-io
Simplified Read/Write traits for no_std usage
-
lorawan
structures and tools for reading and writing LoRaWAN messages from and to a slice of bytes
-
drone-cortexm
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
fdt-parser
parsing FDT
-
it8951
E-Paper driver
-
cargo-esp-new
A cargo-new extension for esp8266 chips
-
sths34pf80
ST STHS34PF80 driver
-
no-std-net
Rust's std::net... without the 'std'.
-
sx1262
A embedded-hal driver for the Semtech SX1261/2 sub-GHz radio transceiver
-
embassy-nrf
Embassy Hardware Abstraction Layer (HAL) for nRF series microcontrollers
-
aps490_pfpu2_mini
Control software for PFPU2 automated brain detection system
-
msf60_utils
MSF receiver for embedded platforms
-
safe-mmio
Types for safe MMIO device access, especially in systems with an MMU
-
is31fl3741
Driver for Lumissil Microsystem's IS31FL3741 IC
-
ili9341
A platform agnostic driver to interface with the ILI9341 (ald ILI9340C) TFT LCD display
-
embedded-nal-coap
A CoAP server and client implementation built on embedded-nal-async
-
format_no_std
Bare metal formatting
-
pac25
Device support crates for PAC25 devices
-
quectel-bg77
Driver for Quectel's BG77 and BG770 eMTC and NB-IoT Modems
-
deploy-temp-fringe
safe, lightweight userland context switches
-
disarmv7
Decodes armv7 instructions in to a rust enum
-
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…
-
rt
A real-time operating system capable of full preemption
-
numlang
A compiler for an esolang that uses hexadecimal
-
meshtastic
communicating with and configuring Meshtastic devices
-
aarch64-paging
manipulate AArch64 VMSA page tables
-
libafl_bolts
Low-level bolts to create fuzzers and so much more
-
sgp40
Rust driver for the Sensirion SGP40 gas sensor
-
daisy
A board support package for the Electro-Smith Daisy Seed and Patch SM
-
w5500-hl
Driver for the Wiznet W5500 internet offload chip
-
fh101rf
Driver crate for the FH101RF Wake-Up Radio
-
rdrive
A dyn driver manager
-
ppc750cl-asm
Assembler for PowerPC 750CL
-
gpt-parser
GUID Partition Table (GPT) read-only parser. Endian aware and usable against no_std+alloc.
-
sysfs_gpio
access to GPIOs using the Linux sysfs interface
-
cs43l22-embedded
A cs43l22 DAC driver using embedded-hal
-
sht31
temperature and humidity sensor
-
ibm437
font for uses with the embedded-graphics crate
-
rflow
Text protocol for embedded apps
-
ls013b7dh03
Sharp LCD driver for embedded-hal
-
max6675-hal
An embedded-hal driver for the MAX6675 digital thermocouple converter
-
scd4x
Rust driver for the Sensirion SCD4x series. Carbon Dioxide / Temperature / Humidity sensors.
-
piddiy
DIY custom PID controller toolkit
-
ug_max
Down-top left-right defined font. Seemly design for 5x5 display.
-
flaw
Control-law-inspired embedded signal filtering, no-std and no-alloc compatible
-
eva-common
Commons for EVA ICS v4
-
r3
R3-OS: Experimental static component-oriented RTOS for deeply embedded systems
-
rs_ws281x
Wrapper for ws281x library using bindgen to track upstream
-
ellie_core
Core modules for ellie
-
uln2003
28BYJ-48 stepper motor with and ULN2003 Driver on any hardware implementing embedded_hal
-
loadcell
A no-std embedded-hal package for the hx711 load cell, based on the embedded hal. Has optional support for interrupts on the esp32.
-
a121-rs
Rust driver for the Acconeer A121 radar sensor
-
lcd1602-driver
A LCD1602 driver
-
rpk-common
RPK common fields between config tool and firmware builder
-
ssd1306
I2C/SPI driver for the SSD1306 OLED display controller
-
xous-semver
porting semantic versions between build system and binary objects
-
flatipc
Zerocopy IPC between Xous clients and servers
-
noir_macros_core
Essential proc-macros and utilities for no_std Rust development
-
buffered-io
Bufferering types for embedded-io
-
ndless
interacting with Ndless for the TI-Nspire
-
faster-rs
Rust wrapper for FASTER by Microsoft Research
-
wasefire
High-level Wasefire applet API
-
ft6x36
Rust driver for Ft6x36 touch screen
-
weather-utils
Set of common and useful weather-related computations
-
stm32f3xx-hal
Peripheral access API for STM32F3 series microcontrollers
-
bbqueue
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
svd2rust
Generate Rust register maps (
struct
s) from SVD files -
memacc
Memory access functions
-
gt911
An embedded touchscreen driver for GT911
-
automotive
providing a variety of automotive related libraries, such as communicating with CAN interfaces and diagnostic APIs
-
mfrc522
A platform agnostic driver to interface the MFRC522 (RFID reader/writer)
-
atsamd21g
Peripheral access API for ATSAMD21G microcontrollers (generated using svd2rust)
-
stm32g0xx-hal
Peripheral access API for STM32G0 series microcontrollers
-
lingua-franca
Package manager and build tool for the Lingua Franca coordination language
-
tcn75a
Embedded HAL driver for accessing TCN75A temperature sensors
-
lilygo-epd47
driver for the LilyGo T5 4.7 inch E-Ink Display (HW-Version V2.3 / ESP32S3)
-
esp-ota
Easy OTA updates for ESP32 chips using only safe Rust. Transport agnostic.
-
edge-mdns
Async +
no_std
+ no-alloc implementation of an mDNS responder -
machine-check-avr
formal verification of AVR microcontrollers by machine-check
-
rf24-rs
A pure-rust driver for the nRF24L01 wireless transceiver
-
rhai-fs
Filesystem package for Rhai
-
avr-progmem
Progmem utilities for the AVR architectures
-
bin_file
Mangling of various file formats that conveys binary information (Motorola S-Record, Intel HEX, TI-TXT and binary files)
-
lsm6dsox
Platform-agnostic embedded-hal driver for the ST LSM6DSOX iNEMO inertial module
-
dlopen-rs
A dynamic linker fully implemented in Rust
-
async-opcua
OPC UA client and server API
-
avr-tester
Framework for testing AVR binaries
-
ruspiro-lock
Providing Spinlock, Semaphore and mutual exclusive data access for cross core usage on Raspberry Pi
-
asahi-bless
select active boot partition on ARM Macs
-
protologic_core
Rust bindings for Protologic
-
hut
The HID Usage Tables
-
bma423
Rust driver for Bma423 accelerometer
-
linux-unsafe
Raw linux system call stubs
-
mcx-pac
Peripheral Access Crate for NXP MCX Series MCUs
-
size-of-trait
determine the size of a future or trait impl at compile time
-
slip-codec
Serial Line Internet Protocol (SLIP) encoder/decoder
-
embassy-net
Async TCP/IP network stack for embedded systems
-
fallible_vec
Fallible allocation functions for the Rust standard library’s
Vec
type -
armagnac
ARM emulation library for simulating embedded systems
-
quick-flash
Flash centrally hosted firmware binaries with one command
-
index-ext
Index slices with arbitrary ints and as arrays
-
ms5803-14ba
embedded-hal async and async driver for the MS5803-14BA pressure sensor
-
canadensis
A Cyphal implementation: Node types and re-exports from some other canadensis crates
-
hcms-29xx
Platform agnostic driver for HCMS-29XX and HCMS-39XX display ICs
-
world_magnetic_model
NOAA World Magnetic Model
-
bmpe280
An I2C driver for the Bosch BMP280/BME280 barometer , thermometer
-
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.
-
st7920
SPI driver for the ST7920 LCD display controller
-
sim7020
driver for sim7020E NB IoT modem
-
cortex-m
Low level access to Cortex-M processors
-
i2c-character-display
Driver for HD44780-based character displays connected via a I2C adapter
-
pmsa003i
Plantower PMSA003I Driver for Embedded HAL
-
pwm-pca9685
Platform-agnostic Rust driver for the PCA9685 I2C 16-channel, 12-bit PWM/Servo/LED controller
-
shtcx
Platform agnostic Rust driver for the Sensirion SHTCx series temperature/humidity sensors
-
libmapper-rs
Rust bindings for libmapper
-
aligned-cmov
Fast constant-time conditional moves of aligned bytes
-
stm32h7
Device support crates for STM32H7 devices
-
imxrt-rt
Startup and runtime support for i.MX RT processors
-
xmc4800
XMC peripheral library for XMC4800 generated from SVD
-
dynisland_dynamic_layoutmanager
Dynamic LayoutManager for dynisland
-
bosch-bme680
A pure rust implementation for the BME680 environmental sensor
-
embedded_cotoutf8
COTO is a library that translates numerical primitives into readable ASCII UTF-8 arrays
-
sdio-host
SD host protocol library
-
embedded-jsonrpc
A JSON-RPC 2.0 server implementation for embedded systems
-
shabi
(S)imple (H)ex (A)nd (B)inary (I)nspector - CLI Tool
-
corncobs
COBS encode/decode for Rust no_std targets
-
embedded-c-sdk-bind-hal
Embedded C SDK bind HAL
-
onecable
1-Wire protocol
-
ht32f1yyy
Device support crates for HT32F1YYY devices
-
ssd1681
Driver for the SSD1681 e-Paper display (EPD) controller, for use with embedded-hal
-
fringe
safe, lightweight userland context switches
-
usbpd
USB-PD library for
[no_std]
-
stemma_soil_moisture_sensor
A pure generic I2C crate for the Adafruit STEMMA soil moisture sensor
-
modality-trace-recorder-plugin
A Modality reflector plugin suite and ingest adapter library for Percepio's TraceRecorder data
-
rtt-log
Log facade implementation for the Segger RTT protocol
-
u4
nibble (4-bit integer) library, with packed representations
-
dfplayer-async
embedded-hal-async driver for the DFPlayer mini MP3 module
-
mcp2517
CAN controller
-
async-io-mini
Async I/O fork for embedded systems
-
esp-hal
Bare-metal HAL for Espressif devices
-
infrared
remote control library
-
svd-vector-gen
process Microcontroller SVD files(e.g. STM32) and generate vector tables and linker scripts.
-
some_crate
If you just need a crate that's guaranteed(*) to do practically nothing
-
stm32mp25-rgmii-gtx-clock-delay
calibrate RGMII GTX clock delay on STM32MP2
-
mcumgr-smp
smp protocol for microcontrollers in pure rust
-
riscv-decode
decoding RISC-V instructions
-
heartbeat-watchdog
A versatile heartbeat watchdog
-
neobridge-rust
Lets you control neopixels from your PC using a board
-
rmodem
XMODEM (and variants) implementation in no-std Rust
-
goolog
no_std-compatible goolog logger and some macros to simplify printing logs
-
flipperzero-rt
Flipper Zero
-
rhai-env
Environment package for Rhai
-
dht20-rs
A
no_std
Rust driver for the DHT20 temperature and humidity sensor -
stabilizer
Firmware for the Sinara Stabilizer board (STM32H743, Ethernet, PoE, 2 ADCs, 2 DACs)
-
lists3
Light-weight CLI tool to create a file browser for S3 buckets provisioning bucket listing
-
lysogeny-broth
Substrate for cellular automata in Rust
-
ufmt
A (6-40x) smaller, (2-9x) faster and panic-free alternative to
core::fmt
-
dramsim3
Rust binding for DRAMsim3
-
websocket-std
Websocket implementation using std support, focus on microcontrollers and interoperability with other languages like C through the ffi
-
huawei-cloud-api-definitions-BMS
Huawei Cloud API definitions, generated from OpenAPI spec
-
cc1101
A platform agnostic driver to interface with the CC1101 (Sub-1GHz RF Transceiver)
-
is31fl3728-rs
Rust embedded driver for is31fl3728 - led-matrix controller
-
imxrt-boot-gen
Generate data structures for booting iMXRT processors
-
beetle_bits
A collection of bit-based types. Currently only u1 (1bit uint) and f3 (3bit float) are implemented
-
veneer
A very thin std-like library that doesn't depend on libc
-
m24c64-driver
embedded-hal(-async) driver for the M24C64 I2C EEPROM
-
strobe
Fast, low-memory, elementwise array expressions on the stack. Compatible with no-std (and no-alloc) environments.
-
mimxrt633s-pac
Peripheral Access Crate for MIMXRT633s devices
-
smallnum
Compile-time size optimization for numeric primitives
-
mos-hardware
Hardware register tables and support functions for 8-bit retro computers like the Commodore 64, MEGA65 and others
-
parr
A C-like unknown-length array type
-
postcard-schema
Reflection-like schemas for postcard types
-
hooker
a helper for hooking functions in x64
-
is31fl3743b-driver
Platform-agnostic Rust driver for the Lumissil IS31F13743B LED matrix controller
-
mpfs-hal
Hardware Abstraction Layer for PolarFire SoC
-
embassy-stm32
Embassy Hardware Abstraction Layer (HAL) for ST STM32 series 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).
-
pico-xs
Embedded-SDK for bare-metal development on the RP2040 Raspberry Pi Pico microcontroller
-
simink
是一个嵌入式全系统模拟器, 提供大量的板卡模拟. simink 支持 Windows, macOS and Linux
-
disasm
Disassembler library
-
uwheel-stats
profiling utility for uwheel
-
intx
Defines new integer types with non-standard but fixed sizes
-
wincwifi
WINC1500 Wifi chip embedded driver
-
modio-logger
Dbus service
-
bitpiece
bitfields for rust
-
switch-hal
HAL and basic implementations for input and output switches (buttons, switches, leds, transistors)
-
lsm6dso
A platform-agnostic driver for the LSM6DSO 6-DoF Accel + Gyro IMU
-
at24cx
A rust-embedded async driver for the Atmel AT24Cx eeprom storage family
-
rhai-rand
Random number package for Rhai
-
ssd1675
Driver for the SSD1675 e-Paper display (EPD) controller, for use with embedded-hal
-
typst-embedded-package
Support to embed typst package to the binary
-
dma-api
Trait for DMA alloc and some collections
-
lpc81x-pac
Device support crates for LPC81X-PAC devices
-
printf-compat
printf reimplemented in Rust
-
mtcap
Communication with MTCAP
-
embedded-storage-file
file and in-memory interface for embedded-storage and embedded-storage-async
-
mcp23017
driver for the MCP23017 (16-Bit I2C I/O Expander with Serial Interface)
-
cloudabi
Low level interface to CloudABI. Contains all syscalls and related types.
-
libft4222
Rust FFI bindings for the FTDI ftd2xx and ft4222 drivers
-
embedded-timers
Softwaretimers and -delays (ms/us) based on a Clock implementation
-
xargo
The sysroot manager that lets you build and customize
std
-
wchisp
A command-line implementation of WCHISPTool, for flashing ch32 MCUs
-
untyped-box
A heap allocation utility when the datatype is unknown
-
ak09915_rs
interacting with the AK09915 magnetometer
-
ht32f523x2
Peripheral access API for HT32F523x2 microcontrollers
-
synctools
Synchronization tools for no_std
-
rtic-monotonics
that provides implementations of the Monotonic trait from rtic-time
-
aem10900
Driver crate for the AEM10900 Energy Harvester
-
jh71xx-pac
Peripheral access crate for the JH71xx SoCs
-
urap
Specification and library for the URAP protocol
-
fans
structures common to controlling fans
-
pixy
A multi-target sensor output relay built for secure, efficient IoT. Made for use with the Pimoroni Enviro Pico boards.
-
nickel-lang-vector
Persistent vectors for Nickel
-
msg-store
A fast and light-weight message store designed to work as a priority queue in low hardware equiped devices
-
mb2-wukong-expansion
Board crate for Elecfreaks Wukong Extension for the BBC micro:bit v2
-
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.
-
sonant
port of the Sonant 4K synth with streaming support
-
embedded-runner
Cargo runner for embedded projects using OpenOCD
-
naked-function
Proc macro implementation of #[naked]
-
rtic-sync
Synchronization primitives for asynchronous contexts
-
efm32gg12b-pac
Peripheral access API for EFM32GG12B MCU (generated using svd2rust)
-
nmea2000
An NMEA 2000 library
-
ieee1275
Safe and easy-to-use wrapper for building OpenFirmware/IEEE1275 apps
-
probe-rs-target
Target description schema for probe-rs
-
mpr121-hal
MPR121 proximity capacitive touch sensor controller hal driver implementation
-
shared-bus
Abstraction for sharing a bus between multiple devices
-
embedded-semver
Compact representation of semantic versions as an i32, u32 i64 or u64
-
motion
A bare metal physics engine
-
dot15d4-frame
Frame parsing and building for the dot15d4 crate
-
lp586x
matrix LED driver (supports LP5860, LP5861, LP5862, LP5864, LP5868)
-
perfect6502-sys
Bindings to perfect6502
-
pac55xx-pac
Peripheral Access Crate (PAC) for PAC55XX
-
rp-binary-info
Code and types for creating Picotool compatible Binary Info metadata
-
northstar-nstar
Northstar is an container runtime for Linux targetting embedded systems
-
e-write-buffer
A no_std, const-generic,
core::fmt::Write
able buffer -
defmt-test
A test harness for embedded devices
-
cirque-pinnacle
driver for working with Cirque Pinnacle Glidepoint touchpads on embedded systems
-
cmsis-nn-rs
Bindings to the CMSIS NN library for ARM Cortex-M processors
-
bsec
Rust API to the Bosch BSEC library
-
rhai-url
Url package for Rhai
-
lipl-display-common
Models for Lipl Display
-
moving_median
A no-std moving median filter
-
esp-idf-hal
A Hardware abstraction layer for Espressif's ESP family of microcontrollers based on the ESP-IDF framework
-
renode-run
Run embedded programs in the renode emulator
-
sbi-rt
Runtime library for supervisors to call RISC-V Supervisor Binary Interface (RISC-V SBI)
-
interchange
Request/response mechanism for embedded development, using atomics
-
bitregions
Generate a unit structure to represent a set of bit-regions
-
esp-bsp
Rust Bare Metal Board Support Packages for ESP32 related boards with focus on Embassy Async
-
embedded-websocket-embedded-io
A fork of the embedded-websockets crate that uses embedded-io-async for async IO
-
embedded-layout
Extend embedded-graphics with simple layout functions
-
tm040040
An embedded-hal driver for the TM040040 Cirque Circle touchpad (and Pinnacle touchpads in general)
-
drmem-api
Traits and types used internally by the DrMem control system
-
nrf51-hal
HAL for nRF51 microcontrollers
-
portable-dlmalloc
Portable Fork of Doug Lea's malloc Implementation
-
s2-pmtiles
reads/writes The S2 PMTiles 1.0 Specification
-
entro-hash
Entro Hash is a 32-bit, non-cryptographic hashing algorithm
-
kaori-hsm
A performant hierarchical state machine library
-
lp50xx
platform agnostic library for the Texas Instruments LP50XX led driver
-
hopter
A Rust-based embedded operating system designed to enable memory safe, memory efficient, reliable, and responsive applications
-
lcd
Hitachi HD44780-compatible LCD screen support for embedded development
-
talrost
A mathematics library for embedded scientific computation
-
hpm-metapac
Peripheral Access Crate (PAC) for all HPM's MCU chips, including metadata
-
profont
monospace font for use with the embedded-graphics crate
-
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… -
phidget
Phidget library for Rust
-
wyrcan
The Container Bootloader
-
cobs-rs
A minimal no-std library for doing Consistent Overhead Byte Stuffing
-
i2c-multiplexer
An I2C Multiplexer library that supports the PCA9546 and TCA9546A chips
-
ad9912
1 GHz DDS SPI driver
-
disarm64-cli
disarm64 provides a tool and a library for 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…
-
ft5336
A platform agnostic driver for the FT5336 touch screen driver used on the STM32F746 Discovery board, built using the embedded-hal
-
nand7400
An assembler library for the nand7400 computer, created by me during my internship at the WCL
-
sfsm
Static state machine generator for no_std and embedded environments
-
rv8803
RTC clock driver for the rv8803 chip via I2C
-
rust-clacc
Rust implementanion of a CL universal accumulator
-
lcd-ili9341-spi
Embedded_hal driver for ILI9341 SPI LCD, compatible with Waveshare 2,4 inch board
-
embedded-asyncdelay-rp2040
A hardware-based, asynchronous delay that can be used with async/await runtimes
-
opcua
OPC UA client and server API
-
sbus-rs
A no_std compatible SBUS protocol parser for embedded systems
-
embassy-time
Instant and Duration for embedded no-std systems, with async timer support
-
nfp1315
NFP1315-61A display (I2C SSD1306 driver)
-
uefi-graphics2
An embedded-graphics display driver for UEFI environments
-
postcard-dyn
Dynamic ser/de for postcard
-
xbinser
binary structure transporation
-
esp32c3
Peripheral access crate for the ESP32-C3
-
avra-rs
Assembler for Microchip AVR Microcontroller family (similar to Atmel)
-
usecop
Rust no_std implementation of the Sample Environment Control Protocol
-
zigzag-rs
A dependency-free ZigZag encoding/decoding library
-
wasefire-store
Key-value store for SLC flash storage
-
wiringx
safe and Rusty bindings to the wiringX library
-
sx126x
A driver for the SX126X Family of LoRa modems
-
lpc82x-pac
Low-level register mappings for the NXP LPC82x series of ARM Cortex-M0+ microcontrollers
-
aarch64
specific functionality and registers
-
signalo
A DSP toolbox with focus on embedded environments
-
stm32-metapac
Peripheral Access Crate (PAC) for all STM32 chips, including metadata
-
cosey
Data types and serde for public COSE_Keys
-
option-block
A minimal utility Rust crate for small, fixed-size blocks of optional types
-
rp2040-panic-usb-boot
On panic, boot to USB mode implemented in ROM
-
efm32lg-pac
Peripheral access API for EFM32LG MCU (generated using svd2rust)
-
cycle-menu
no-std compatible library to create a menu that can be cycled through and shown with custom input/output
-
stm32f3-discovery
Board support package for the STM32F3DISCOVERY board
-
bme280-rs
query BME280 sensors over I²C
-
boppo
API for creating new activities
-
joybus-pio
controller side of the joybus protocol for gamecube for the RP2040 chip via its PIO functionality
-
disasm6502
6502 disassembler, complete with a working example
-
esp-partition-table
Read/write ESP flash partition table
-
pca9539
Abstraciton for PCA9539 I/O expander
-
stk8ba58
Driver for the Sensortek STK8BA58 3-axis MEMS Accelerometer
-
stm32f7xx-hal
HAL for the STM32F7xx family of microcontrollers
-
sjlj2
Safer, cheaper and more ergonomic setjmp/longjmp in Rust
-
sensehat-screen
using the 8x8-LED matrix, with RGB565 coloring, on the Raspberry Pi Sense HAT device
-
umm-malloc
A global allocator implementation for embedded systems using the umm_malloc library
-
hx711
A platform agnostic driver to interface with the HX711 (load cell amplifier and ADC)
-
wasefire-error
Wasefire API errors
-
loreyawen
An encrypted connection for low-datarate networks by piggybacking on LoRaWANs link encryption
-
onceinit
仅可设置一次数据的类型。
-
tinydyn
A lightweight dynamic dispatch library
-
ethernet
A parser for ethernet headers
-
satrs
A framework to build software for remote systems
-
asm-delay
no_std implementation of embedded-hal DelayMs & DelayUs based on arm::delay
-
ember_os
OS kernel implemented in rust, which has referenced https://os.phil-opp.com/
-
bobbin-bits
Small bit fields and ranged integers
-
quark
Types for manipulating numeric primitives at the bit level
-
adxl345_driver2
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
smart-leds-trait
A trait for implementing effects, modifiers and drivers for programmable leds
-
ladybug
A small library for triggering a logic analyzer from program events
-
stm32f469i-disc
Board support crate for the STM32F469 DISCOVERY kit
-
waterman
A CLI tool to easily flash code onto AVR microcontrollers using avrdude, enhancing the development workflow for embedded Rust projects
-
discrete_count
Encapsulate counting for clocks, ab-encoders, etc
-
moon_script
Fast and simple scripting language based on Rust
-
embedded-devices
Device driver implementations for many embedded sensors and devices
-
weev
Small and embeddable no_std multiplexer
-
bcm2837-lpa
Peripheral access crate for BCM2837 found in the Raspberry Pi 3 and Zero 2W
-
nourl
Url primitive for no_std environments
-
alt-std
Alternative Lightweight Std library for making small executables and shared objects
-
rp2040-rom
Access to Raspberry Pi RP2040 ROM functions from Rust
-
quectel-bg9x-eh-driver
Rust embedded-hal driver for the Quectel BG9X cellular modems
-
stepgen
Stepper motor speed ramp generator
-
xous-api-susres
Manager of suspend/resume operations
-
bitmap
A dense bitmap
-
tixml2svd
that converts Texas-Instruments device descriptions to standard SVD files
-
tagged-box
Box that uses tagged pointers
-
driver-interface
Sparreal OS kernel
-
naive-timer
A minimal naive timer for embedded (no_std) platforms
-
ygen-mc
Ygens machine code playground
-
rave_engine
Rave Engine for Unyt enabling embedded scripting for holochain-rust
-
ourobuf
A no_std circular buffer with constant-time operations
-
r-efi-alloc
UEFI Memory Allocator Integration
-
lora-modulation
A definition of LoRa modulation characteristics with minimal external dependencies
-
bmap-parser
that allows you to copy files or flash block devices safely
-
prusst
A convenient interface to the UIO kernel module for TI Programmable Real-time Units
-
liquid_crystal
a customizable library to work with alphanumeric lcd display compatible with the HD44780 controller
-
safe-libc
Safe wrappers around the
libc
crate -
Rusty_CryptoAuthLib
A platform agnostic I2C driver for Microchip’s Crypto Authentication HW (i.e. secure element
ATECC608A
), written in pure Rust. -
ism330dhcx
driver for ST ism330dhcx sensor
-
micropb
Rust Protobuf library targetting embedded systems and no_std environments
-
pulau-rs
allocation-free union-find library for bare metal environments
-
avrd
Device-specific constants and information for all AVR microcontrollers
-
button-driver
Advanced button handling crate
-
com_logger
Serial port logger through COM ports
-
char_lcd_rgb_i2c
controlling RGB1602 LCD displays via MCP23017 I/O expanders
-
tinywake
A minimal, no_std-compatible waker implementation for Cortex-M async executors
-
rp2040-multicore-per-cpu
Enable use of per-core static variables on rp2040
-
cd74hc4067
A platform agnostic driver to interface with CD74HC4067
-
blynk_io
Blynk.io streaming API integration in Rust
-
xous-api-log
Log server API
-
socketcan-isotp
A common application of ISO-TP or ISO 15762-2 is for example Unified Diagnostic Services (UDS) used in automotive ECUs for diagnostics
-
ironplc-plc2x
Compiler front-end for ironplc
-
esb-ng
Nordic's Enhanced ShockBurst communication protocol
-
tm1637-embedded-hal
A platform agnostic driver to interface with the TM1637 (7-segment LED display) using embedded-hal and embedded-hal-async
-
embedded-nrf24l01
A driver for NRF24L01(+) transceivers on embedded-hal platforms
-
himpp
Hi3XXX MPP API for Rust bindings
-
ble-peripheral-rust
A cross-platform Rust crate for building Bluetooth Low Energy peripherals
-
rnacos-web-dist-wrap
rnacos server's console front-end dist embed wrap project
-
rv3028c7-rtc
RV-3028-C7 and similar Real Time Clock (RTC) no_std driver
-
mpu6050
Platform agnostic driver for MPU6050 6-axis IMU
-
rkaiq
Rockchip RKAIQ bindings for Rust
-
vl53l1x-uld
source port of the ULD driver for the VL53L1X
-
microscpi
creating SCPI interfaces
-
cargo-embassy
Get up and running with Embassy in seconds
-
liboptic_edid
Parses EDIDs from raw bytes (in 100% Rust)
-
springql
Open-source stream processor for IoT devices and in-vehicle computers
-
ssd1306-i2c
SSD1306 I2C driver
-
lipstick
C
-
neon-rtos
A real-time operating system for ARM Cortex-M or RISC-V microcontrollers
-
efm32gg11b-pac
Peripheral access API for EFM32GG11B MCU (generated using svd2rust)
-
ohms
Electrical units library for embedded targets
-
origen_metal
Bare metal APIs for the Origen SDK
-
trenchcoat
JavaScript-ish virtual machine for embedded, LEDs, hot code reload, etc
-
anyleaf
Driver for AnyLeaf sensors
-
scalpel-bin
binary modification tool, cut, stitch, replace, sign
-
py32f030_hal
Peripheral Hal Crate for Puya's PY32F030 microcontroller
-
ethercat-plc
Tools to build a PLC like program using the ethercat crate
-
a7105
Rust embedded-hal driver for the A7105 2.4GHz FSK/GFSK Transceiver
-
mini-backtrace
Backtrace support for no_std and embedded programs
-
ds1302
A platform agnostic driver to interface with the DS1302 real time clock-calendar
-
xiaomi-sensor-exporter
Server that listenes for xiaomi temperature sensors
-
embedded-chacha
Encryption of embedded-io and embedded-io-async streams
-
eva-sdk
EVA ICS v4 SDK
-
hcs-12ss59t
Platform-agnostic embedded-hal driver for Samsung HCS-12SS59T VFD displays
-
arm-gic-driver
A driver for the Arm Generic Interrupt Controller version 1-4
-
virt-sys
Native bindings to the libvirt C library
-
atsame70j20b
Peripheral access API for the ATSAME70J20B MCU from Microchip (generated using svd2rust 0.30.3)
-
ws2811-spi
SPI-based driver for ws2811 chips
-
edge-nal-embassy
edge-nal based on
embassy-net
-
task-stream
a global task executor, run in
no_std
-
fieldset
Struct to enum derivation
-
eva-lsl
EVA ICS v4 local service launcher
-
efm32wg-pac
Peripheral access API for EFM32WG MCU (generated using svd2rust)
-
libertyos_kernel
The kernel for LibertyOS
-
adi-adxl355
An embedded-hal driver for the ADXL355 accelerometer
-
tdc1000
no_std driver for the TDC1000 Ultrasonic Sensing Analog Front End
-
gopro-controller
Open source Rust Library for interacting with GoPro Cameras over BLE and WiFi
-
crc8-rs
A heapless no-std library for doing 8-bit cyclic redundancy checks
-
lis2dtw12
no_std library for the LIS2DTW12 dual motion and temperature sensor using embedded-hal traits
-
stm32f1-staging
Device support crates for STM32F1 devices
-
embedded-midi
embedded hal uart to send and receive midi
-
stm32l0x1-hal
Peripheral access API for STM32L0x1 microcontrollers
-
embedded-heatshrink
port of the heatshrink library for data compression in embedded systems
-
laad
parsing information from a TBS battery monitor, such as the Battery Monitor Expert Modular
-
uboot-shell
communicating with u-boot
-
embedded-io-extras
Additional utilities for embedded-io, including a Cursor type for no_std environments
-
epd-spectra
Driver for Spectra EPDs from Pervasive Displays Inc
-
spo-rhai
Embedded scripting for Rust
-
is31fl3729
Driver for Lumissil Microsystem's IS31FL3729 IC
-
charlcd
charlcd.c Linux driver (HD44780 et al.)
-
pio-uart
A software UART implementation for the RP2040 using the PIO feature
-
embedded-io
Embedded IO traits
-
mqttrust
MQTT Client
-
xmc4-hal
Peripheral access API for XMC4 series microcontrollers
-
emc2101
Platform-agnostic Rust driver for the EMC2101 temperature sensor and fan sensor/controler
-
n32g4
Device support crate for N32G4 devices
-
afe4404
driver for Rust embedded-hal
-
ethercat-soem-ctx
Wrapper for the SOEM open-source EtherCAT master context
-
navigator-rs
serves as the entry point for embedding applications using Rust on Blue Robotics's Navigator
-
analog-multiplexer
A platform agnostic driver for 4051 and 4067 series analog multiplexers targetting the Rust embedded-hal
-
juggle
Async task switching for cooperative multitasking in single thread environments with no_std support
-
cargo-esp-build
A cargo-build extension for esp8266 chips
-
debouncing
Debounce keys in an embedded context
-
microbit-clock
clock app for the BBC micro:bit
-
embassy-usb
Async USB device stack for embedded devices in Rust
-
atsaml22j
Peripheral access API for ATSAML22J microcontrollers (generated by svd2rust)
-
va416xx
PAC for the Vorago VA416xx family of MCUs
-
tmp117
Driver for the tmp117 using the embedded-hal
-
aloc
A no_std heap allocator that works with an operating system (IT CURRENTLY SEGFAULTS THOUGH)
-
any-uart
Init early console from device tree, mostly for Arm
-
x11nas
X11 library bindings for Rust, forked to be no_std
-
sac-base
Base crate of the sac-signal and sac-control crates
-
aw2013
Driver for the AW2013 3-Channel LED Controller
-
pmw3901-ehal
PMW3901 optical flow driver for embedded-hal no_std applications
-
k1921vk035-pac
The peripheral access crate for k1921vk035
-
embedded-vintage-fonts
Vintage fonts from embedded-graphics 0.6 back release 0.7
-
stm32f3xx-hal-v2
Peripheral access API for STM32F3 series microcontrollers
-
mil_std_1553b
MIL STD 1553B message parsing and types
-
async-opcua-types
OPC UA data types
-
radio-sx127x
Rust driver for the Semtec SX127x Sub GHZ LoRa Radio ICs
-
hss-tty-flasher
TTY Flasher for PolarFire SoC with HSS bootloader
-
tango
Markdown-based Literate programming in Rust, integrated with Cargo
-
xous-api-ticktimer
Provide high-resolution, non-rollover system time
-
loongArch64
loongArch64 support for Rust
-
cichlid
A color math library for programming addressable LEDs
-
lcd1602rgb-rs
Native Rust driver for the waveshare LCD1602-RGB display module
-
freertos-rust
Create to use FreeRTOS in rust projects. The freertos-cargo-build crate can be used to build and link FreeRTOS from source inside build.rs
-
usbd-hid-descriptors
Low-level, wire-format enums/bitfields used in HID descriptors
-
ws2812-flexio
A neopixel driver based on NXP i.MX RT's FlexIO bus
-
usbd-ethernet
Communication Device Class Network Control Model (CDC-NCM) class for usb-device
-
memory-pager
Access memory using small fixed size buffers
-
cody-c
zerocopy codec for encoding and decoding data in no_std environments
-
bitwrap
pack/unpack data into byte array
-
kobo
interacting with Kobo devices
-
microflow
A robust and efficient TinyML inference engine
-
mm-std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
wpactrl
wpa_supplicant control interface library
-
w5500-ll
Low level driver for the Wiznet W5500 internet offload chip
-
defmt-or-log
Logging macros that forward to either defmt or log
-
pca9535
PCA 9535 IO-Expander driver using embedded-hal
-
local_static
Local static variable
-
hexmove
Interface for interacting with Hexmove IMUs
-
gc9307-async
GC9307 async driver based on embedded-hal
-
serial-settings
Embedded device settings management over serial terminal and flash
-
sdmmc-driver
SD/MMC driver traits and implementations
-
libiio-sys
Native, unsafe, bindings to the Linux libiio library. Used by industrial-io.
-
axp20x
Rust driver for axp20x Power Management Unit
-
gpt_disk_types
GPT (GUID Partition Table) disk data types no_std library
-
rgbled
driver for controlling RGB LEDs using PWM, with built-in gamma correction
-
i2c-write-iter
Exports iterator based parallels to embedded-hal & embedded-hal-async for Write & WriteRead
-
bq34z100
embedded_hal driver for the fuel gauge series bq34z100
-
rpk-config
RPK configuration tool
-
memac
A custom memory allocator using slab and buddy allocators
-
max31865
generic driver for the MAX31865 RTD to Digital converter
-
pa-spl
A no-std embedded-hal I2C driver for the PCB Artists SPL module
-
rs-max31865
Generic driver for the MAX31865 RTD to Digital converter
-
ssd1309
display-interface
compatible driver for the SSD1309 OLED display controller -
rpi-st7789v2-driver
Raspberry-Pi driver for the ST7789V2 TFT display controller (WaveShare 1.69" 240x280 LCD)
-
stm32f7-staging
Device support crates for STM32F7 devices
-
flipperzero-test
Rust test harness for Flipper Zero
-
yaxpeax-avr
AVR instruction set decoder for yaxpeax
-
memfault-ssf
Supporting crate for the Memfault memfaultd embedded Linux agent
-
veml7700
Platform-agnostic Rust driver for the VEML7700 High Accuracy Ambient Light Sensor
-
dbc-codegen-cli
CLI for CAN DBC codegen
-
aya-ebpf-cty
Type aliases to C types like c_int for use with bindgen
-
itla
ITLA (micro laser) non-blocking control library using embedded-hal
-
mips-rt
Minimal runtime for MIPS MCU cores
-
zg-co2
ZyAura CO₂ sensor protocol implementation
-
ice40
An embedded-hal driver for configuration of ice40 FPGA devices
-
efm32gg11b820
Peripheral access API for EFM32GG11B820 microcontrollers
-
lp5018
no_std driver for the lp5018 i2c LED driver
-
xmc4100
Cortex-M peripheral access library
-
isla-axiomatic
Isla is a symbolic execution engine for Sail instruction set architecture specifications. This crate implements utilities for handling axiomatic memory models.
-
codde_protocol
Multi Communication protocol in heart of the C.O.D.D.E. Pi framework
-
thumb2-stack-size
estimates stack space requirements of thumb2 programs
-
mk20d7
Peripheral access API for MK20D7 microcontrollers
-
cyclen
userland linux programming without libc
-
spicat
Full-duplex SPI transactions from the command line
-
rawtime
Basic timing infrastructure for no_std (currently x86 only) platforms
-
alarmo
convenient API to bootstrap firmware and access peripherals on the Nintendo Alarmo
-
drmem-drv-weather-wu
DrMem driver which gets Weather Underground data
-
multi-mono-font
Multi mono font mixed typesetting for embedded-graphics
-
efm32gg-pac
Peripheral access API for EFM32GG MCU (generated using svd2rust)
-
edge-net
no_std and no-alloc async implementations of various network protocols
-
l293x
Platform agnostic library for the L293 and L293D motor drivers using embedded-hal
-
dac8564
platform agnostic library for the Texas Instruments DAC8564
-
treadmill-rs
Common type- and API-definitions for the Treadmill distributed hardware testbed
-
ra8835a
/ SED1335 display driver
-
cargo-dfu
cargo extension for flashing embedded rust programs via dfu
-
embedded-hal-sync-pins
embedded-hal pin implementations that can be shared between threads
-
embedded-graphics-core
Core traits and functionality for embedded-graphics
-
bern-kernel
Preemptive real-time kernel for microcontrollers
-
pac22
Device support crates for PAC22 devices
-
jetson_gpio
port of NVIDIA's Python library for controlling GPIO pins on select Jetson devices
-
herkulex-drs-0x01-stm32f1xx
A driver for servomotors Herkulex DRS-0101 and DRS-0201 using USART on stm32f1xx
-
ufmt_float
A rough implementation of a writer for f32 and f64 for ufmt
-
ltr303
Platform agnostic Rust driver for the LTR-303 Ambient Light Sensor
-
arm7tdmi_aeabi
proc-macro to put aeabi functions into your code
-
atsamd51j
Peripheral access API for ATSAMD51J microcontrollers (generated using svd2rust)
-
msp430-rt
Minimal runtime / startup for MSP430 microcontrollers
-
mlx9064x
interfacing with Melexis MLX9064* thermal cameras
-
postform_decoder
Decoder for the Postform logging framework, an efficient logging framework for mcu's
-
levarint64
Little-Endian VARiable-length INTeger codec, compatible with no_std
-
ahtx0
An async driver implementation for the AHT10 and AHT20 sensors (no-std)
-
flem-serial-rs
A serial port implementation of the FLEM protocol for host computers running Windows, Linux, or MacOS
-
stm32l4
Device support crates for STM32L4 devices
-
lcd_ili9225_rs
ili9225 lcd with embedded-hal
-
entro-sort
Entro Sort is an in-place, linearithmic, unstable sorting algorithm
-
fp
Fast & safe fixed-point arithmetic via compile-time checks
-
think-morse
A CLI to flash morse code using the thinkpad's lid logo led, only works in Linux
-
aw-fel
dealing with Allwinner devices in FEL mode, in pure Rust
-
iso7816_tx
ISO7816 Smart Card T=1 Transmission protocol
-
wave
A no-std no-alloc gesture recognition library for low resolution TOF-Sensors
-
lcd1602rs
A tiny package to write to a LCD1602 via I2C (e.g. on a Raspberry Pi)
-
synopsys-usb-otg
'usb-device' implementation for Synopsys USB OTG IP cores
-
adxl345_driver
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
canadensis_crc
access to Cyphal software image CRCs
-
embedded-sprites
Embedded no std graphics libary for bundling image at compile time
-
aw9523b
A general driver for AW9523B which is 16 bit gpio explander & led driver
-
ws2812-timer-delay
Timer-based driver for ws2812 leds
-
sungrow-winets
A rudimentary client for programmatically interacting with Sungrow inverters which are using a WiNet-S dongle for network connectivity
-
imxrt1062-fcb-gen
Generate Firmware Configuration Block (FCB) for iMXRT1062 processors in Rust build scripts. This crate is unmaintained. Consider using imxrt-boot-gen…
-
mm32f5
Peripheral access API for MM32F5270 and MM32F5280 microcontrollers
-
cortex-m-interrupt
Function-like, trait-based interrupt handler registration
-
embassy-rp
Embassy Hardware Abstraction Layer (HAL) for the Raspberry Pi RP2040 microcontroller
-
mos6502_assembler
DSL for MOS6502 assembly
-
ndef
#[no_std]
library to implement a NFC Data Exchange Format structures -
aya-ufmt
A fork of
ufmt
tweaked to play nice with the eBPF kernel verifier -
cs4272
Rust I2S driver for the CS4272
-
virtual-fan
Virtual fan driver for simulation and testing
-
smoltcp-slip
SLIP network interface on top of smoltcp
-
simavr-section
Add simavr-compatible metadata to your binary
-
modio-logger-db
modio-logger Dbus service
-
ruspiro-cache
Raspberry Pi cache maintenance operation API
-
cortex-m-quickstart
A template for building applications for ARM Cortex-M microcontrollers
-
openmv_h7_bsp
Board support crate for OpenMV H7 machine vision board
-
neotron-romfs
Parse a Neotron ROM-FS image
-
chip-select
Chip select GPIO support traits
-
cntrlr
async embedded framework
-
kea-hal
HAL for NXP KEA devices
-
pinetime-mynewt
Mynewt Bindings for PineTime Smart Watch
-
driver-3461bs-rs
Driver for 3461BS LED driver
-
w5500-mqtt
MQTT client for the Wiznet W5500 internet offload chip
-
bitx
a lightweight bit-level crate
-
pudding-kernel
RealTime-OS Kernel
-
mkl25z4
Peripheral access API for NXP KL25Z microcontrollers
-
oreboot/oreboot-soc
oreboot is a fork of coreboot, with C removed, written in Rust
-
fel-cli
CLI tools for dealing with Allwinner devices in FEL mode, in pure Rust
-
ssd1331-async
Async driver for SSD1331-based displays with SPI interface
-
vl53l0x-simple
driver for the VL53l0X TOF ranging sensor
-
ds4432
Platform-agnostic Rust driver for the Maxim DS4432 Dual-Channel, I2C, 7-Bit Sink/Source Current Digital To Analog (DAC) converter
-
overlay_macro
A proc-macro for implementing Overlay, to reinterpret a slice of bytes as a bit/byte packed struct
-
arducam-mega
SPI driver for the Arducam Mega
-
da14531
Peripheral access crate for the DA14531 microcontroller
-
spwm_generator
cli tool for genrate SPWM lookup tables
-
sm2335egh
Driver for the SM2335EGH LED controller found in the SwitchBot Color Bulb
-
p256-cm4
P256-Cortex-M4 re-written in rust
-
tinymqtt
A very tiny no-std MQTT client, mainly for embedded systems
-
pimoroni_gfx_pack
Driver for LCD GFX PACK by Pimoroni
-
swm341-pac
Peripheral Access Crate for Synwit's swm341 microcontroller
-
stockbook
1-bit image embedding at compile time
-
probe-rs-targets
A collection of on chip debugging tools to comminicate with ARM chips
-
mimxrt600-fcb
Flash Configuration Block for MIMXRT600 devices
-
ralte32
Arithmetic Library Testing Environment for embedded RISC-V 32-bit
-
byte-slab
A statically allocated slab of bytes
-
nrf52-hal-common
Common HAL for the nRF52 family of microcontrollers. More specific HAL crates also exist.
-
atdf2svd
convert Atmel's ATDF files to SVD
-
ina3221
Embedded driver for INA3221 triple-channel power monitor
-
gd32-synopsys-usb-otg
'usb-device' implementation for Synopsys USB OTG IP cores -- gd32 workaround
-
modbus_buffer
Circular buffer implementation tailored for Modbus communication in no_std environments
-
cc2650
Device support for TI CC2650 microcontrollers
-
lilos-rwlock
A read-write / writer-preferred lock for use with lilos
-
is31fl3218
A rust-embedded driver for the Lumissil Microsystems IS31FL3218 LED driver
-
pinetime-lvgl
LVGL Bindings for Mynewt on PineTime Smart Watch
-
embassy-boot-stm32
Bootloader lib for STM32 chips
-
ublox-sockets
Common sockets layer for host-based ublox devices
-
purua
PU-RU-A is a PUre RUst luA implementation (to be)
-
l3gd20-ng
A platform agnostic SPI driver to interface with the L3GD2 gyroscope
-
ws2812-nrf52833-pwm
nrf52833 PWM driver for ws2812 leds
-
scd30-modbus
SCD30 driver implementation
-
rm1asm
MICRO-1 assembler written in Rust
-
embedded-ads111x
ADS111x 16bit ADCs I2C rust driver no_std
-
aht10-embedded
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor, tested on Rasberry Pi Pico
-
sh1108
display-interface
compatible driver for the SH1108 OLED display controller -
defmt-tcp
Prints defmt logs received from a TCP interface
-
topq
A Timeout Priority Queue
-
rs-matter
Native Rust implementation of the Matter (Smart-Home) ecosystem
-
plic
Provide structs and methods to operate riscv plic device
-
embedded-ads1220
Embedded Driver for the Texas Instruments ADS1220 ADC
-
cloudmqtt
A pure Rust MQTT client and server library
-
pid-ctrl
A flexible PID controller
-
stm32f30x
Peripheral access API for STM32F30X microcontrollers
-
mcp9808
Platform agnostic Rust driver for the Microchip MCP9808 temperature sensor
-
tcs3472
Platform-agnostic Rust driver for the TCS3472 RGB color light to digital converter with IR filter
-
one-fpga
One FPGA general traits and types
-
adi-adxl355-async
An embedded-hal-async driver for the ADXL355 accelerometer
-
aarch64_sysreg
Address translation of system registers
-
mcxn947-pac
Peripherals Access Crate for NXP mcxn947
-
unsize
A stable alternative to CoerceUnsize
-
gyuvl53l0x
driver for the VL53L0X (Time-of-Flight I2C laser-ranging module)
-
ral
Base layer for generated libraries for specific MCUs
-
mini-rxtx
serialization and communications for embedded
-
rumio
Control your MMIO and CPU registers without pain
-
embedded-mbedtls
no_std Rust wrapper for Mbed TLS
-
drone-nrf-map-periph-uarte
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
sht25
Rust driver for SHT25 temperature/humidity sensor
-
max2034x
Driver crate for the MAX20343/MAX20344 family of buck/boost converters
-
st7735-lcd-doublebuffering
Double-Buffered ST7735 TFT LCD driver with embedded-graphics support
-
data-view
data view for reading and writing data in a byte array
-
xmc1100-hal
Hardware Abstraction Layer (HAL) for the XMC1100 series of ARM Cortex-M+ microcontroller
-
rm1masm
MICRO-1 micro assembler written in Rust
-
async-opcua-crypto
OPC UA cryptography library
-
enc424j600
Embbeded Rust Ethernet driver for ENC424J600 Ethernet controller with SPI interface
-
drogue-embedded-timer
Macro to shim heterogeneous HAL timers to embedded-time
-
txmodems
various MODEM file transfer protocols
-
rucos-cortex-m
A port of the RuCOS kernel to ARM Cortex-M
-
framed
Send and receive data over lossy streams of bytes
-
ruspiro-mmu
Functions to use and configure the MemoryManagementUnit (MMU) of the Raspberry Pi
-
jtag-taps
interacting with individual TAPs on a JTAG scan chain
-
orouter-serial
serial protocol for oRouter
-
adafruit_nxp
Driver for Adafruit Precision NXP 9-DOF Breakout Board - FXOS8700 + FXAS21002 modules
-
r3_portkit
writing a port of R3
-
k210-pac
Peripheral access API for K210 SoC
-
cortex-m-asyncrt
A minimal async runtime for Cortex-M devices
-
ab1024-ega
An embedded-hal SPI driver for AB1024-EGA/AC057TC1 (as used in Inkplate 6 COLOR)
-
tfmt
A tiny, fast and panic-free alternative to
core::fmt
-
gihex-hc-sr04
access HC-SR04 ultrasonic sensor
-
bme68x-rust
interacting with Bosch BME68x chips over I2C and SPI
-
xgzp6897d
i2c Driver for the XGZP6807D differential pressure sensor
-
avrisp
AVR ISP library
-
cross-stream
An event stream store for personal, local-first use, specializing in event sourcing
-
rselib
Misc algorithms implemented for embedded usage (i.e., wasm)
-
enumap
A HashMap and HashSet like interface for enums backed by an array
-
epd-gde021a1
An embedded-hal based driver for ePaper displays with chip: GDE021A1 (172x72 B/W via SPI)
-
pic32mx470
Peripheral access API for PIC32MX330/350/370/430/450/470 microcontrollers
-
bitinfo
A commandline tool to make working with registers easier
-
hdc302x-async
An embedded-hal-async driver for the HDC302x(-Q1) low-power humidity and temperature digital sensor
-
sleigh-rs
Ghidra Sleigh parser
-
a653rs-xng
a653rs partition library for xng hypervisor
-
gd32f1
Device support crate for GD32F1 devices
-
probe-run
Runs embedded programs just like native ones
-
embedded-msgpack
MessagePack serialization implementation for Rust optimized for embedded/no_std environments
-
push2_pong
Ableton Push2 Embedded-graphics display driver
-
flem
Flexible, Light-weight, Embedded Messaging Protocol
-
microasync
Very small async runner
-
embedded-error-chain
Easy error handling in no-alloc and no-std environments
-
lilos-semaphore
A counting semaphore for use with lilos
-
pavo-traits
Traits for the Pavo Framework
-
megamorse
morse code translator
-
ssd1315
OLED driver
-
simmer
A temperature unit library for Rust. It's intended to be minimal, embedded-aware, and easy to use!
-
air001-pac
Peripheral Access Crate for Air001 microcontroller
-
houseflow-types
Types for Houseflow
-
noted
creating ELF notes
-
unmp-id
unmp
-
embedded-controls
Based on switch-hal library that allows to handle primitive controls(buttons, encoders and etc.)
-
persistent-buff
A buffer that stays persistent in ram between boots
-
mnemos-userspace
A tiny embedded operating system userspace library
-
rx8900
device driver for the Epson RX8900SA/CE I2C-Bus Interface Real Time Clock Module
-
lpc546xx-hal
Peripheral access API for LPC546xx series microcontrollers
-
icm20948-async
Async driver for the ICM20948 (Imu+Mag) for no_std environments
-
bmp180-driver
A driver for BMP180 Digital Pressure Sensor
-
bcm2835-lpa
Peripheral access crate for BCM2835 found in the Raspberry Pi 1 and Zero
-
msp430
Low level access to MSP430 microcontrollers
-
teleprobe-meta
Embed teleprobe metadata into ELF binaries
-
stm32l432xx-hal
Hardware abstraction layer for the stm32l432xx chips
-
seminix
内核标准库
-
ambiq-apollo4p-pac
Peripheral access API for Ambiq Apollo 4 Plus microcontrollers
-
ws2812-nrf52833-hal-pwm
nrf52833 PWM driver for ws2812 leds
-
endian-type-rs
Type safe wrappers for types with a defined byte order
-
efm32hg309f64-pac
Peripheral Access Crate for EFM32HG309 series MCU from Silicon Labs
-
vexriscv
Low level access to the VexRiscv processor
-
armv6-m-instruction-parser
parsing ARMv6-M thumb instructions. Usefull for decompilition and emulation etc.
-
as8510
An async no_std driver for the AS8510 SPI current and voltage sensor
-
emb-ssdraw
embedded screen saver that draws random points on a display
-
tlsf
Two-Level Segregated Fit (TLSF) allocator with optimized memory footprint
-
libcoap-rs
An idiomatic wrapper around the libcoap CoAP library for Rust
-
async-button
Async button handling crate for no_std environments
-
cmim
Move your data to interrupt context
-
kolben
A collection of COBS
-
git-tags-semver
extract SemVer Version Information from annotated git tags
-
sn3193
Driver for SN3193 3-Channel Fun LED Driver
-
block_device
BlockDevice trait
-
yaxpeax-pic18
pic18 decoder for the yaxpeax project
-
cargo-n64
Cargo subcommand to build Nintendo 64 ROMs
-
ad5668
Rust Embedded HAL driver for Analog Devices AD5668 DAC
-
rza1
Peripheral access API for the Renesas RZ/A1 MPU family
-
tmag5170
A platform agnostic driver to interface with the TMAG5170-Q1 (3D hall sensor)
-
dyn-smooth
Dynamic smoothing filter based on an algorithm by Andrew Simper
-
pac194x
Platform-agnostic Rust driver for the PAC194x 9V, 16-bit power monitor with alerts
-
samd-timer
High-level API for the TC/TCC peripherals found on the Microchip SAM MCUs
-
ogc-rs
wrapper library for devkitPro's libogc
-
stm32f407g-disc
Board support crate for the STM32F407G DISCOVERY microcontroller board
-
peripherals
Microcontroller peripherals definition and ergonomic access
-
zinc64-sdl
Commodore 64 emulator app
-
rzcobs
Reverse-Zerocompressing-COBS encoding
-
gd32f4
Device support crates for GD32F4 devices
-
nrf-smartled
A Smart LED (WS2812) driver using hardware acceleration
-
imxrt1180evk-fcb
FlexSPI configuration block for NXP's IMXRT1180EVK
-
sntpc
making SNTP requests
-
sen0177
Read air quality data from the SEN0177 and PMSA003I sensors
-
bit_op
Bit manipulation
-
bluetooth-hci
Bluetooth HCI
-
manchester-code
A no-std library to allow Manchester encoding and decoding of datagrams
-
nucleo-h743zi
Example programs for nucleo-H743zi and nucleo-H743zi2 boards
-
anpp
Advanced Navigation Packet Protocol
-
negicon-protocol
Definitions and utility functions for the Negicon v3 communication protocol
-
apds9151
platform agnostic Rust driver for the APDS9151 Digital Proximity and RGB Color I2C Sensor
-
stm32h5-staging
Device support crates for STM32H5 devices
-
barebones-watchface
Barebones Watch Face for Mynewt on PineTime Smart Watch
-
seq
The module 'seq' provides the lightweight, generic sequence container 'Seq' for unmovable data and is embedded into the program during compile time
-
lfsr
Galois linear feedback shift registers
-
dtb_parser
no std but alloc depended device tree blob parsing lib
-
pimoroni_gfx_pack_button
Driver for LCD GFX PACK buttons by Pimoroni
-
embassy-hal-internal
Internal implementation details for Embassy HALs. DO NOT USE DIRECTLY.
-
sfsm-base
Traits for the sfsm crate
-
kernaux
Safe binding to libkernaux - auxiliary library for kernel development
-
canadensis_data_types
Automatically generated types for all Cyphal public regulated data types
-
zbus_module
Zabbix loadable module for accessing data on ZBUS telemetry bus
-
drone-nrf-map-pieces-10
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-9
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-4
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-8
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-6
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-11
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
hifb-sys
Hi35XX FB API for Rust unsafe bindings
-
timed-signal
Helper crate for generating time-dependent signals
-
rcobs
Reverse-COBS encoding
-
bl702-hal
HAL for the Bouffalo Lab BL702 microcontroller family
-
clint
CLosure INTerrupt handlers
-
defrag
safe and low overhead defragmenting memory manager for microcontrollers
-
robokit
Build custom firmware for simple robotic automation
-
stm32l4x6
Memory map for STM32L4x6 microcontrollers
-
vgastream-rs
High level VGA(0xB8000) library in freestanding Rust
-
aaronia-rtsa
High-level bindings for Aaronia Spectran devices
-
smart-leds
device drivers
-
cty
Type aliases to C types like c_int for use with bindgen
-
gd32f3
Device support crates for GD32F3 devices
-
embedded-simple-ui
UI elements (LED, hw switch, etc.) with implementations on top of embedded-hal and embedded-time crates
-
l298n
driver for the L298N (Dual H-Bridge Motor Controller module)
-
fring
Lightweight, no_std, and *fast* ring buffer
-
sen5x-rs
embedded-hal driver for the sen5x environmental sensor node for HVAC and air quality applications
-
efm32gg-hal
HAL for the EFM32GG (EFM32 Giant Gecko) family of microcontrollers
-
lvgl-codegen
Code generation based on LVGL source code
-
sb-rotary-encoder
Rotary encoder processor for embedded systems
-
embedded-time
Fully defined, inter-operable, ergonomic, and fast human-time units (both duration and rate types) with hardware timer abstraction and software timers
-
esp32s3
Peripheral access crate for the ESP32-S3
-
lpc11xx
Register mappings for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
external-memory-tools
HAL to keep data in memory that could not be directly mapped to RAM
-
lps28dfw
Platform-agnostic Rust driver for the LPS28DFW pressure sensor
-
cu40026
display driver for the CU40026 vacuum fluorescent display (VFD)
-
himipi-sys
Hi35XX MIPI API for Rust unsafe bindings
-
harsark
Safe and lightweight real-time Kernel
-
k64
Peripheral access API for Kinetis K64 microcontrollers
-
wm8960
Register map and embedded-hal based driver for Wolfson WM8960 Audio Codec
-
drone-riscv
RISC-V platform crate for Drone, an Embedded Operating System
-
lcd1602_gpio
Abstraction layer for interfacing between raspberry pi and the lcd1602 - 16x2 lcd display module through GPIO
-
mimxrt595-evk
Board support package for NXP i.MX RT595 Evaluation Kit
-
embedded-picofont
The PICO-8 font to use with embedded-graphics
-
wasm-embedded-spec
Embedded WASM WITX specification
-
asm6502
A basic 6502 assembler
-
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…
-
probe-rs-rtt
Host side implementation of the RTT (Real-Time Transfer) I/O protocol over probe-rs
-
sift-trait
Sift a value out of another
-
embedded-qmp6988
Platform-agnostic Rust driver for the QMP6988 barometric pressure sensor
-
rdrive-macros
macros for rdrive
-
nrf52840
Peripheral access API for nrf52840 microcontrollers
-
drive_74hc595
Drive for IC 74HC595 Shift Register
-
arduino
Reusable components for the Arduino Uno
-
embed_rs
A template for embedded Rust projects
-
plan9_asm
Plan9 Assembly wrapper
-
led
Various LED implementations built on the embedded-hal traits
-
rpi-mh-z19c-exporter
Export CO2 concentration measured with a Winsen MH-Z19C sensor on a Raspberry Pi to Prometheus
-
gbafix
Rust port of the C
gbafix
utility. For GBA rom patching. -
northstar-sextant
Northstar is an container runtime for Linux targetting embedded systems
-
lpc177x_8x
Peripheral access API for LPC177x and LPC178x microcontrollers (svd2rust 0.13.1)
-
pac55xx-hal
Hardware Abstraction Layer (HAL) for PAC55XX
-
phm-icd
The Interface Control Document (ICD) for Pretty HAL Machine
-
vlcb-defs
VLCB protocol core library containing important value definitions and data structures
-
msp430fr247x
Peripheral access crate for TI MSP430FR247x microcontroller
-
core_ux
no_std implementation of the non-standard types u/i1..=63
-
as5048a
Rust driver for AMS AS5048A Magnetic Rotary Encoder
-
i2cdriver
Use Excamera I2CDriver and I2CMini devices from Rust, optionally via embeddded-hal traits
-
fchashmap
A fixed capacity no_std hashmap
-
hx1230
Driver for the HX1230 display
-
microbit-text
Scrolling text on a 5×5 (micro:bit) display
-
palloc
portable linked-list allocator for baremetal systems
-
opensensor
streaming and archiving measurements from sensors
-
iowarrior-embedded-hal
that provides access to the IOWarrior GPIO, I2C, PWM, SPI and ADC peripherals
-
eds
Easy data separator
-
canadensis_core
A Cyphal implementation: Common definitions
-
ueight
Helpers for raw AVR programming
-
dac_lib_mcp4725
A driver for the MCP4725 DAC module
-
bxcan-ng
STM32 bxCAN peripheral driver
-
hal_sensor_dht
A Embedded HAL driver for the DHT humidity and temperature sensors
-
embedded-mogeefont
Pixel font for embedded-graphics
-
lbfgs
L-BFGS algorithm
-
himpi-sys
Hi35XX MPI API for Rust unsafe bindings
-
iotext_rs
IoText data protocol
-
enc28j60
A platform agnostic driver to interface the ENC28J60 (Ethernet controller)
-
xloop
a window init
-
zerocopy
makes zero-cost memory manipulation effortless. We write "unsafe" so you don't have to.
-
panic-dcc
Report panic messages to the host using the Debug Communication Channel (DCC)
-
const_sizes
提供友好可读的常量大小
-
rak-rui3-eh-driver
Rust embedded-hal driver for the RAK LoRaWAN modules running RUI3 firmware in AT mode
-
is31fl3731
Driver for Lumissil Microsystem's IS31FL3731 IC
-
bmi323
Platform agnostic Rust driver for the BMI323 IMU
-
efm32pg12b500-pac
Peripheral access API for EFM32PG12B500 MCU (generated using svd2rust)
-
sensd
The ultimate data logger and control system
-
efm32pg1b100-pac
Peripheral access API for EFM32PG1B100 MCU (generated using svd2rust)
-
efm32pg1b200-pac
Peripheral access API for EFM32PG1B200 MCU (generated using svd2rust)
-
s32k118-pac
Device Support Crate for NXP S32K118 Devices
-
sbus-parser
Futaba SBUS parser using loop and byte swap
-
dht22-driver
No-std, no-dependency, platform-agnostic driver for the dht22 sensor
-
armv7
Low level routines for the armv7 instruction set with VMSA
-
hitde-sys
Hi35XX TDE API for Rust unsafe bindings
-
atsamd51p19a
Peripheral access API for ATSAMD51P19A microcontrollers (generated using svd2rust)
-
urpc
uRPC (pronounced micro RPC) is a simple and lightweight RPC framework designed with embedded systems in mind
-
at32f4xx-pac
Device support crates for AT32F4 devices
-
panic-persist
Persist panic messages in the targets' RAM
-
stm32-device-signature
Device electronic signature 'driver' for STM32 microcontrollers
-
dht-hal-drv
HAL based driver for digital humidity and temperature sensors DHT11, DHT21, DHT22
-
embedded-ccs811
Platform-agnostic Rust driver for the CCS811 ultra-low power digital gas sensor for monitoring indoor air quality
-
ghostfat
Virtual FAT16 file system for embedded USB Mass Storage Device use
-
max3263x
svd2rust generated peripheral crate for the max3263x
-
do_syscall
raw syscall
-
lsm303agr
Platform-agnostic Rust driver for the LSM303AGR ultra-compact high-performance eCompass module: ultra-low-power 3D accelerometer and 3D magnetometer
-
kpal
An extensible and RESTful control system for physical computing
-
aint
Arbitrary width integers between 1 and 128
-
drv8833-driver
A driver for DRV8833 motor driver
-
atsamv70q19
Peripheral access API for ATSAMV70Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71n21
Peripheral access API for ATSAMV71N21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70q19
Peripheral access API for ATSAME70Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71q20
Peripheral access API for ATSAMV71Q20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70n20
Peripheral access API for ATSAME70N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71n19
Peripheral access API for ATSAMV71N19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70j19
Peripheral access API for ATSAMV70J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70n20
Peripheral access API for ATSAMV70N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70q21
Peripheral access API for ATSAME70Q21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70j20
Peripheral access API for ATSAMV70J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70j20
Peripheral access API for ATSAME70J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70j19
Peripheral access API for ATSAME70J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70j21
Peripheral access API for ATSAME70J21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71j20
Peripheral access API for ATSAMV71J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70n21
Peripheral access API for ATSAME70N21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70n19
Peripheral access API for ATSAME70N19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71n20
Peripheral access API for ATSAMV71N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70q20
Peripheral access API for ATSAMV70Q20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
openthread-rust
Sample for Rust bindings for OpenThread
-
tt21100
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
pt-rtd
Calculation of resistance and temperature for platinum type RTDs, e.g. PT100.
-
winpipe2serial
link a windows named pipe to a serial COM port
-
lilos-watch
Cheap sharing with change notification for lilos
-
ink_ir
data structures and algorithms for ink! intermediate representation
-
atsaml21j18bu
Device crate for the Microchip ATSAML21J18BU, generated from its SVD file
-
atsaml21j17bu
Device crate for the Microchip ATSAML21J17BU, generated from its SVD file
-
atsaml21j18a
Device crate for the Microchip ATSAML21J18A, generated from its SVD file
-
atsaml21j16b
Device crate for the Microchip ATSAML21J16B, generated from its SVD file
-
atsaml21g18a
Device crate for the Microchip ATSAML21G18A, generated from its SVD file
-
atsaml21j17b
Device crate for the Microchip ATSAML21J17B, generated from its SVD file
-
atsaml21g16b
Device crate for the Microchip ATSAML21G16B, generated from its SVD file
-
atsaml21e18a
Device crate for the Microchip ATSAML21E18A, generated from its SVD file
-
atsaml21e17b
Device crate for the Microchip ATSAML21E17B, generated from its SVD file
-
atsaml21j18b
Device crate for the Microchip ATSAML21J18B, generated from its SVD file
-
atsaml21e18b
Device crate for the Microchip ATSAML21E18B, generated from its SVD file
-
atsaml21g17b
Device crate for the Microchip ATSAML21G17B, generated from its SVD file
-
atsaml21e15b
Device crate for the Microchip ATSAML21E15B, generated from its SVD file
-
atsaml21e16b
Device crate for the Microchip ATSAML21E16B, generated from its SVD file
-
atsaml21g18b
Device crate for the Microchip ATSAML21G18B, generated from its SVD file
-
spark-ser7seg
An embedded-hal driver for the SparkFun Serial 7 Segment Display
-
iqs323-driver
An embedded async driver for the IQS323 IQ Switch ProxFusion touch and proximity sensing controller
-
libcsp
Safe and ergonomic Rust API for libcsp on top on libcsp-sys
-
ms8607
A platform agnostic driver for the MS8607 Pressure, Temperature, and Humidity Sensor from TE Connectivity
-
dht-sensor
Driver for the DHT11/DHT22 sensor based on embedded-hal
-
senml-deser
serialization and deserialization using SenML specifications
-
async-stm32f1xx
Abstractions for asynchronous programming on the STM32F1xx family of microcontrollers
-
alazar
randomness
-
cs47l63
driver for the CS47L63 DSP
-
simple6502
A dead-simple MOS 6502 emulator, no std or allocator needed, no dependencies
-
seven_segment
driver for seven segment displays
-
embedded-sensors
Sensors in one place, with only one feature away
-
oc2-hlapi
Rust bindings for the OpenComputers II Minecraft mod's HLAPI
-
isl29125
Platform-agnostic Rust driver for the ISL29125 low-power digital RGB color light sensor with IR blocking filter
-
unmp-link-udp
udp link for unmp
-
oled_async
Driver for various OLED display controllers. e.g. SH110x SSD130X works with embedded-graphics
-
akafugu_twidisplay
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
thingy-91-nrf9160-bsp
BSP for the Nordic Thingy:91 nRF9160
-
lc3-codec
LC3 audio codec for embedded systems (no_std)
-
stm32l1xx-hal
Peripheral access API for STM32L1 series microcontrollers
-
stm32f0xx-hal
Peripheral access API for STM32F0 series microcontrollers
-
panic-probe
Panic handler that exits
probe-run
with an error code -
s32k144w-pac
Device Support Crate for NXP S32K144W Devices
-
s32k142w-pac
Device Support Crate for NXP S32K142W Devices
-
s32k144-pac
Device Support Crate for NXP S32K144 Devices
-
s32k142-pac
Device Support Crate for NXP S32K142 Devices
-
s32k116-pac
Device Support Crate for NXP S32K116 Devices
-
microasync-rt
A runtime for the very small async runner
-
lcd1602-diver
A driver for the LCD1602 display using the PCF8574 I2C bus
-
panic-custom
Small panicking rust crate that allows to easily set the behavior of panicking for embedded or regular no_std binaries
-
srex
managing SRecord files
-
arrform
String formatting without memory allocator
-
bytex
8bit helper functions, mostly for AVR
-
msp430f2619-pac
A peripheral access crate (PAC) for TI's MSP430F2619 mcu
-
care-script
Input script processing crate for the care tool
-
defmt-logger
A
log
logger that can format defmt log frames -
s32k148-pac
Device Support Crate for NXP S32K148 Devices
-
s32k146-pac
Device Support Crate for NXP S32K146 Devices
-
sevseg_3642bs
Driver crate for the 3642BS seven segment display
-
zorio
Subset of standard library I/O ported to no_std
-
msp430fr5962
Peripheral access crate for MSP430FR5962 microcontroller
-
quad-compat-rhai
Embedded scripting for Rust
-
hds
Heapless Data Structures for
no_std
environments -
aws-greengrass-nucleus
aws greengrass nucleus in Rust (unofficial)
-
scsi
A
no-std
library for easily interfacing with SCSI-based storage devices -
smccc
Functions and constants for the Arm SMC Calling Convention (SMCCC) 1.4 and Arm Power State Coordination Interface (PSCI) 1.1 on aarch32 and aarch64
-
poller
File I/O events library for Rust
-
bq40z50
Rust driver for Texas Instrument BQ40Z50 battery manager
-
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
-
nrf52833-hal
HAL for nRF52833 microcontrollers
-
mwatch-kernel-stm32l4
A embedded 'Smart' watch
-
relox
ELF32 relocation compression and decompression
-
atsamv71q19
Peripheral access API for ATSAMV71Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70n19
Peripheral access API for ATSAMV70N19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71j21
Peripheral access API for ATSAMV71J21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70q20
Peripheral access API for ATSAME70Q20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71j19
Peripheral access API for ATSAMV71J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
spi-memory-async
A generic driver for different SPI Flash and EEPROM chips
-
platform-millis
generic trait of milliseconds counter for embedded-nano-mesh crate
-
embedded-storage-inmemory
An in-memory implementation of embedded-storage
-
overlay
trait for reinterpreting a slice of bytes as an arbitrary type
-
mju-bits
no_std typed bitfield access for u8, u16, u32 and u64
-
mm32f3270-pac
Peripheral Access Crate for MindMotion's mm32f3270 microcontroller
-
byte-arena
no_std, no_alloc arena for allocating byte buffers
-
l3gd20-registers
A typed map of the STMicroelectronics L3GD20 Gyroscope registers
-
avr-libcore
Minified version of libcore for AVR
-
p256-cortex-m4-sys
Low-level bindings to P256-Cortex-M4
-
sps30-i2c
Platform-agnostic Rust driver for the SPS30 particulate matter sensor
-
choreographer
A color pattern sequencer, intended for groups of RGB LEDs
-
uart8250
provide a struct with many methods to operate uart 8250
-
fullhouse
statically-allocated deque
-
backlash
processor for signal conditioning
-
uart_xilinx
provide a struct with many methods to operate uarts in Xilinx's FPGA: XPS UART Lite, AXI UART Lite
-
ke06z4-pac
PAC for NXP Kinetis MKE06Zx microcontrollers
-
chademo-rs
An embedded-hal crate for bi-directional CHAdeMO EV charging based on IEEE Std 2030.1.1-2021
-
tm1637
A platform agnostic driver to a LED-display powered by the TM1637 chip
-
bounced
Debouncing and Testing for Signals and Buttons
-
diff-in-place
A no_std, zero-copy, in-place diff trait for constant sized arrays
-
atomic-polyfill
Atomic polyfills, for targets where they're not available
-
PY32f001xx-pac
Peripheral Access Crate for Puya's PY32f001xx microcontroller
-
PY32f002xxx-pac
Peripheral Access Crate for Puya's PY32f002xxx microcontroller
-
troll-rs
help creating and building a Troll relocatable binary
-
PY32m010xx-pac
Peripheral Access Crate for Puya's PY32m010xx microcontroller
-
PY32c670xx-pac
Peripheral Access Crate for Puya's PY32c670xx microcontroller
-
PY32c610xx-pac
Peripheral Access Crate for Puya's PY32c610xx microcontroller
-
PY32c640xx-pac
Peripheral Access Crate for Puya's PY32c640xx microcontroller
-
PY32f303xx-pac
Peripheral Access Crate for Puya's PY32f303xx microcontroller
-
PY32T020xx-pac
Peripheral Access Crate for Puya's PY32T020xx microcontroller
-
PY32L020xx-pac
Peripheral Access Crate for Puya's PY32L020xx microcontroller
-
PY32f403xx-pac
Peripheral Access Crate for Puya's PY32f403xx microcontroller
-
PY32c641xx-pac
Peripheral Access Crate for Puya's PY32c641xx microcontroller
-
bno080
AHRS driver
-
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.
-
aht10-async
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor
-
ens160
driver implementation
-
standard-pid
Standard PID implementation in Rust for serious embedded projects
-
cic-fixed
CIC filter implementation for fixed point numbers
-
volatile-mem
managing volatile memory
-
canadensis_filter_config
Automatic receive filter configuration for Cyphal
-
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 ``#… -
lora-phy
A LoRa physical layer implementation enabling utilization of a range of MCU/LoRa board combinations within embedded frameworks supporting embedded-hal-async
-
edge-captive
Async +
no_std
+ no-alloc implementation of a Captive Portal DNS -
esp-max31865
An ergonomic wrapper for interfacing with Max31865 SPI RTD devices using an ESP32
-
embedded-threadsafe
safe global or thread-local cells for embedded devices
-
ramlink
RAM-based, producer-consumer, one-way communication for microcontrollers, using a ring buffer
-
can-bit-timings
procedural macro to calculate CAN bus timings
-
embassy-net-tuntap
embassy-net driver for Linux TUN/TAP interfaces
-
c99
C99 types for easier interop
-
lpc546xx-pac
Device support crates for LPC546XX-PAC devices
-
retro-display
Embedded display drivers for retro computers
-
ft6236
embedded-hal driver for the FT6236/FT6206/FT6236U touch controller
-
teleinfo-parser
A small library for parsing TeleInfo frames from french EDF energy meters
-
axp173
Device-agnostic X-Powers AXP173 power management IC driver
-
ellie_tokenizer
Tokenizer for ellie language
-
usbd-ctaphid
usb-device driver for CTAPHID
-
msp430-atomic
Atomic operations for MSP430 microcontrollers
-
l0g
Opinionated l0gging facade meant for the no_std libraries
-
honeycomb
A portable parser combinator library that does not require a runtime
-
unmp-link-serial
serial link for unmp
-
sevensegment
A platform agnostic driver to interface with 7-segment LED displays
-
tm16xx
Embedded drivers for TM16xx display controllers
-
bfcore
An interpreter for BrainF*ck without std or alloc
-
mctp
Management Component Transport Protocol (MCTP) base types and traits
-
nobcd
BCD number primitive for no_std environments
-
bitmap-font
Bitmap fonts for the embedded-graphics crate that don't require generics
-
bm1397-protocol
Rust protocol driver for the BM1397 Bitcoin Mining ASIC
-
bare-metal
Abstractions common to bare metal systems
-
apu_pcengines_hal
A safe wrapper around the direct memory interface of the APU2+ hardware
-
qingke
Low level access to WCH's QingKe RISC-V processors
-
thermostat-eem
Firmware for the Sinara Thermostat-EEM temperature controller
-
pca9548a
I2C-Expander driver using embedded-hal
-
lcd_1602_i2c
I2C character LCD displays that use the AiP31068L chip with embedded-hal
-
svisual
Base Rust structures and traits for SVisual client
-
booster
Firmware for the Sinara Booster device (STM32F4, Ethernet, RF power amplifiers)
-
sparkfun-openlog
A platform-agnostic, embedded-hal driver for the Sparkfun OpenLogger
-
atsam3n00a
Peripheral access API for ATSAM3N00A microcontrollers (generated using svd2rust)
-
atsam3n2a
Peripheral access API for ATSAM3N2A microcontrollers (generated using svd2rust)
-
atsam3n1b
Peripheral access API for ATSAM3N1B microcontrollers (generated using svd2rust)
-
atsam3n4b
Peripheral access API for ATSAM3N4B microcontrollers (generated using svd2rust)
-
dht11
Platform-agnostic Rust driver for the DHT11 temperature and humidity sensor
-
bbq2
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
tmc5072
A TCM5072 driver compatible with
embedded-hal
-
wake-rs
Wake protocol library written in Rust
-
atsam3n00b
Peripheral access API for ATSAM3N00B microcontrollers (generated using svd2rust)
-
w7500x-pac
Peripheral Access Crate for Wiznet's W7500x microcontrollers
-
atsam3n2b
Peripheral access API for ATSAM3N2B microcontrollers (generated using svd2rust)
-
atsam3n4a
Peripheral access API for ATSAM3N4A microcontrollers (generated using svd2rust)
-
atsam3n0b
Peripheral access API for ATSAM3N0B microcontrollers (generated using svd2rust)
-
houseflow-api
API for Houseflow
-
atsam3n0a
Peripheral access API for ATSAM3N0A microcontrollers (generated using svd2rust)
-
atsam3n1a
Peripheral access API for ATSAM3N1A microcontrollers (generated using svd2rust)
-
unid
Automate device security provisioning with edge intelligence
-
drone-nrf91-dso
Nordic Semi nRF91 DSO implementation for Drone, an Embedded Operating System
-
unmp-protocol-raw
raw protocol for unmp
-
pico-tflmicro-sys
Rust bindings of TensorFlow Lite for Microcontrollers for Raspberry Pi Pico
-
stackdump-core
stack dump definitions
-
px4flow_bsp
A board support package for the PX4FLOW optical flow sensor board
-
avr-vm
VM with JIT-compiler for ATMega32
-
interrupt
-
lis3dh-spi
no_std driver for the ultra-low-power high-performance 3-axis "nano" accelerometer LIS3DH using SPI
-
sega-controller
Embedded driver for reading Sega controller input
-
telit-me310g1
interoperate with the Telit ME310G1 LTE-M radio with AT commands
-
ubench
stopgap rust benchmarking solution for microcontrollers
-
tmledkey-hal-drv
HAL based driver for Titan Micro 7 segment LED controllers and key scanners
-
rtic-common
lib TODO
-
ldproxy
A linker proxy tool
-
hmc5983
magnetometer driver for embedded hal
-
nb
Minimal non-blocking I/O layer
-
tictactoe-llem
Probably? efficient tictactoe(no heap, modificable size) game backend/frontend cli, can be used for gui or idk
-
platform-serial
generic trait of generic serial interface for embedded-nano-mesh crate
-
spl06-007
Driver for the SPL06-007 barometric pressure sensor
-
hd44780-driver
HD44780 compliant displays with embedded-hal
-
max7219-async
Async driver for the MAX7219
-
embedded-utils
embedded-utils
provides some features in Rust(no_std) embedded systems -
defmt-ringbuf
defmt persistent ring buffer logger
-
on-off-sequence-output
Sends a sequence of on/off states to a GPIO Pin
-
is31fl3193
I2C driver for the IS31FL3193 RGB LED driver
-
scd30pi
Interfaces the SCD30 i2c CO2, temperature and humidity sensor from Sensirion for Raspberry Pi
-
sbat
UEFI Secure Boot Advanced Targeting (SBAT) no_std library
-
ma734
Platform agnostic Rust driver for the MA734, digital angle sensor that detects the absolute angular position of a permanent magnet
-
yaxpeax-6502
6502 decoder implementing yaxpeax-arch traits
-
bmp280-driver
A platform agnostic driver to interface with the BMP280 pressure sensor
-
esp-lp-hal
HAL for low-power RISC-V coprocessors found in ESP32 devices
-
esp32-wroom-rp
Rust-based Espressif ESP32-WROOM WiFi driver crate for RP2040 series microcontroller boards
-
m95320
Driver for STMicroelectronics M95320 32-Kbit serial SPI bus EEPROM
-
smbus-request-parser
Parse SMBus requests. Register functions to call for each type of write/read request. Agnostic regarding polling, irq, dma usage.
-
arm_gicv2
ARM Generic Interrupt Controller version 2 (GICv2) register definitions and basic operations
-
defmt-itm
Transmit defmt log messages over the ITM (Instrumentation Trace Macrocell) stimulus port
-
hrs3300
Platform-agnostic Rust driver for the HRS3300 heart rate sensor/monitor
-
ape-table-trig
implementations of sin, cos, and tan using precalculated tables
-
fs1027-dg-hal
FS1027-DG Gas Flow Sensor Module driver for no_std embedded-hal
-
mimxrt500-bootstub
Glue code to make cortex-m-rt work with NXP i.MX RT500 series chips when booting from FlexSPI NOR flash
-
itron
Interface to operating systems based on μITRON and its derivatives
-
smokepatio
Low-level hardware interfaces for Valve's Steam Deck
-
a800xl-utils
misc utilities for mos-a800xl-none target (Atari 800XL/XE)
-
freertos-sys
Builds FreeRTOS from source for specific device families and provides easy linking
-
swap-n
an n argument extension to std::mem::swap
-
lc709203
Platform-agnostic Rust driver for the LC709302 battery gauge sensor
-
eeric
An easily embeddable RV64I core with MFDV extensions
-
si1145
No-std driver for the Si1145 ambient light sensor
-
i2cdev
API for safe access to Linux i2c device interface
-
dac5578
Texas Instruments DAC5578 Driver for Rust Embedded HAL
-
rust-rsm
RSM:A Realtime Software Middleware framework. Asynchronous, event driven framework
-
platform-switch
Namespace facades for switching between platforms
-
kc11b04
Driver for the KC11B04 4-button analog keypad
-
embedded-multi-page-hmi
Multi page HMI targetting embedded devices with a few of buttons input and a constrainted display
-
mt9v034-i2c
mt9v034 image sensor two-wire programming driver
-
bmp280-core
Driver for BMP280
-
rust-forth-compiler
A Forth compiler written in Rust
-
sae-j1939
both embedded and non-embedded use cases
-
wasefire-logger
Wasefire platform logging
-
bmp180-embedded-hal
A platform agnostic driver to interface with the BMP180 barometric pressure sensor
-
rkaiq-sys
Rockchip RKAIQ FFI bindings for Rust
-
cortex-m-rtfm
Real Time For the Masses (RTFM): a concurrency framework for building real time systems
-
lps22hb
A platform agnostic driver to interface with LPS22HB pressure sensor module
-
embedded-i2s
An embedded Inter-IC Sound (I2S) abstraction layer
-
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.
-
ogc-sys
Rust bindings for devkitPro's libogc
-
rhai_codegen
Procedural macros support package for Rhai, a scripting language and engine for Rust
-
p9813
RGB controller
-
liboscore
Rust wrapper around the libOSCORE implementation of OSCORE (RFC8613), a security layer for CoAP
-
rrt0
cross-platform runtime / startup (like crt0)
-
unmp
-
gp2y0e02b
driver for the GP2Y0E02B (SHARP I2C Distance Measuring Sensor, 4-50cm)
-
pca9555
A rust-embedded driver for the (P|T)CA9555 i/o port expander
-
syscon-rs
A driver for syscon poweroff, and reboot in rust
-
mks979b
no_std driver for the MKS 979B Atmosphere to Vacuum Transducer. Based on the embedded-hal traits.
-
coap-request
Interface to CoAP requests
-
ink_prelude
[ink!] Common API for no_std and std to access alloc crate types
-
sram23x
Platform-agnostic Rust driver for the 23xx series serial SPI SRAMs
-
own_or_borrow
Unified references to owned or RefCell borrowed data
-
ltc690x
driver crate for LTC690x serial programmable oscillator
-
scd4x-rs
query SCD4x sensors over I²C
-
stuw81300
An embedded-hal driver for the STuW81300
-
st7789
TFT LCD driver with embedded-graphics support
-
w25q
A generic driver for different SPI Flash and EEPROM chips
-
atsamda1e14b
Peripheral access API for the ATSAMDA1E14B MCU generated using svd2rust
-
mpfs-hal-embassy
Embassy integration for PolarFire SoC
-
drogue-boot
A cortex-m bootloader toolkit
-
nuki-backend-hifb
A HiFB + HiTDE drawing backend for the Nuki 2D immediate GUI library
-
huber-pilot-one
huber Pilot ONE library
-
microamp
Asymmetric Multi-Processing on microcontrollers
-
megatiny_hal
A hardware abstraction layer for attiny and atmega avr devices
-
hcsr04_async
A no-std driver for the HC-SR04 ultrasonic sensor using async
-
imxrt-dcd
Device Configuration Data (DCD) generator for i.MX RT1060 series firmware images
-
phm
Pretty HAL Machine
-
ads122x04
Platform-agnostic driver for the ADS122C04 and ADS122U04 analog to digital converters
-
atsam3x4c
Peripheral access API for ATSAM3X4C microcontrollers (generated using svd2rust)
-
kolibri-embedded-gui
embedded-graphics based GUI framework made to be as lightweight as its namesake
-
cmsis-rtos2
wrapper for the CMSIS-RTOS2 API, which should be provided by another library, and linked into the consuming library or application
-
esp-tm1637
platform agnostic driver for a LED-display powered by TM1637 chip
-
atsam3s2c
Peripheral access API for ATSAM3S2C microcontrollers (generated using svd2rust)
-
atsam3n0c
Peripheral access API for ATSAM3N0C microcontrollers (generated using svd2rust)
-
atsam3u1e
Peripheral access API for ATSAM3U1E microcontrollers (generated using svd2rust)
-
atsam3n4c
Peripheral access API for ATSAM3N4C microcontrollers (generated using svd2rust)
-
atsam3s1c
Peripheral access API for ATSAM3S1C microcontrollers (generated using svd2rust)
-
midi-stream-parser
Parser to convert bytes from a MIDI stream into messages
-
static_leak
Leak references with static lifetimes from static Mutexes and RwLocks
-
care-ef-scp
SCP effector for the care tool
-
care
configuration management, reconciling, and tracking over time
-
rtic-macros
Procedural macros, syntax parsing, and codegen of the RTIC crate
-
atsam3sd8b
Peripheral access API for ATSAM3SD8B microcontrollers (generated using svd2rust)
-
atsam3a4c
Peripheral access API for ATSAM3A4C microcontrollers (generated using svd2rust)
-
atsam3sd8c
Peripheral access API for ATSAM3SD8C microcontrollers (generated using svd2rust)
-
atsam3n2c
Peripheral access API for ATSAM3N2C microcontrollers (generated using svd2rust)
-
atsam3a8c
Peripheral access API for ATSAM3A8C microcontrollers (generated using svd2rust)
-
atsam3s8c
Peripheral access API for ATSAM3S8C microcontrollers (generated using svd2rust)
-
atsam3u2e
Peripheral access API for ATSAM3U2E microcontrollers (generated using svd2rust)
-
atsam3u4e
Peripheral access API for ATSAM3U4E microcontrollers (generated using svd2rust)
-
atsam3u4c
Peripheral access API for ATSAM3U4C microcontrollers (generated using svd2rust)
-
atsam3s8b
Peripheral access API for ATSAM3S8B microcontrollers (generated using svd2rust)
-
atsam3s4a
Peripheral access API for ATSAM3S4A microcontrollers (generated using svd2rust)
-
atsam3s2b
Peripheral access API for ATSAM3S2B microcontrollers (generated using svd2rust)
-
atsam3s2a
Peripheral access API for ATSAM3S2A microcontrollers (generated using svd2rust)
-
atsam3s4b
Peripheral access API for ATSAM3S4B microcontrollers (generated using svd2rust)
-
atsam3x8h
Peripheral access API for ATSAM3X8H microcontrollers (generated using svd2rust)
-
atsam3x8e
Peripheral access API for ATSAM3X8E microcontrollers (generated using svd2rust)
-
atsam3x4e
Peripheral access API for ATSAM3X4E microcontrollers (generated using svd2rust)
-
atsam3x8c
Peripheral access API for ATSAM3X8C microcontrollers (generated using svd2rust)
-
atsam3s1a
Peripheral access API for ATSAM3S1A microcontrollers (generated using svd2rust)
-
atsam3s1b
Peripheral access API for ATSAM3S1B microcontrollers (generated using svd2rust)
-
atsam3u2c
Peripheral access API for ATSAM3U2C microcontrollers (generated using svd2rust)
-
atsam3s4c
Peripheral access API for ATSAM3S4C microcontrollers (generated using svd2rust)
-
atsam3u1c
Peripheral access API for ATSAM3U1C microcontrollers (generated using svd2rust)
-
atsam3n1c
Peripheral access API for ATSAM3N1C microcontrollers (generated using svd2rust)
-
sbi
A pure-Rust library to interact with the RISC-V Supervisor Binary Interface
-
inout_port-rs
inb/outb port in freestanding Rust
-
seeed-erpc
Driver crate for interacting with seeed-studio eRPC Wifi devices
-
tt21100-async
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
tca9548-eh
An embedded-hal focused driver for the TCA9548 I2C multiplexer
-
nrf-modem-nal
An embedded-nal implementation for the nrf9160 modem
-
libalgobsec-sys
Unsafe bindings to the Bosch BSEC library
-
esp-idf-alloc
An allocator for the ESP32 based on the ESP-IDF
-
mcp3425
Platform agnostic Rust driver for the Microchip MCP3425/6/7/8 ADC
-
xtensa-lx106-rt
Low level access for xtensa lx6 processors and peripherals
-
disarm64_defn
structures and enums for describing AArch64 (ARMv8) instructions
-
afe4400
An
embedded-hal
compatible driver for the TI AFE4400 pulse oximetry analog front-end chip -
stackdump-cli
capturing stack dumps
-
freebsd-embedded-hal
embedded-hal
traits for FreeBSD devices -
diskio
trait for handling disk IO devices
-
esp-storage
embedded-storage traits to access unencrypted ESP32 flash
-
NBC_cli
A CLI for NavasotaBrewing/brewdrivers
-
si70xx
series relative humidity and temperature sensor driver
-
embedded-freetype-sys
Low level binding for FreeType font library for no_std targets
-
baryuxn
Uxn stack machine as a no_std library
-
panic-rtt-target
Logs panic messages over RTT using rtt-target
-
ringu
Thread-safe no_std ring buffer
-
esp-synopsys-usb-otg
'usb-device' implementation for Synopsys USB OTG IP cores
-
r3_support_rza1
Supporting package for running R3-OS on Renesas RZ/A1
-
product-os-http
Product OS : Http is a derivative of the http crate restructured for both std and no_std environments
-
arm_pl011
ARM Uart pl011 register definitions and basic operations
-
k510-pac
Peripheral access API for Canaan K510 SoC generated from unofficial SVD file
-
spb_rs
Sparkplug-B client library
-
aranet
Read current measurements from an Aranet4 device
-
hdc20xx
Platform-agnostic Rust driver for the HDC2080, HDC2010 and HDC2021 low-power humidity and temperature digital sensor
-
wm8731
HAL for the WM8731 audio codec
-
flash-algorithm
write CMSIS-DAP flash algorithms for flashing embedded targets
-
apds9960
Platform-agnostic Rust driver for the APDS9960 digital proximity, ambient light, RGB and gesture sensor
-
light_seq
Raspberry Pi based light show program reacting to the audio input
-
lsm9ds1
A platform agnostic driver to interface with LSM9DS1 3D accelerometer, 3D gyroscope, 3D magnetometer sensor module
-
not-io
A synthesis between no-std, no-alloc and std::io
-
e-ring
A no_std append only ring buffer, when full new element replace oldest one
-
sogi_pll
SOGI-PLL imlementation
-
saelient
SAE-J1939 support library
-
otm8009a
Hardware Abstraction Layer for OTM8009A LCD controller IC
-
allocvec
A vector type that preserves the index of every inserted element
-
postcard-bindgen
generate bindings for the postcard binary format for other languages than Rust
-
msp430f6736
Peripheral access API for MSP430f6736 microcontroller
-
time-series-filter
Filters such as exponential weighted moving average (IIR LPF)
-
sizef
#[no_std] crate to format sizes
-
AT42QT2120
Platform agnostic Rust driver for the AT42QT2120
-
stratum-v1
Stratum v1 client. This provides a
#[no_std]
library to implement a Stratum v1 client -
at42qt1070
Embedded-hal implementation for the AT42QT1070
-
air-navigator-rs
serves as the entry point for embedding applications using Rust on Blue Robotics's Navigator
-
tca62724fmg
RGB LED driver for embedded hal
-
allegro-motor-drivers
Allegro microsystems motor controller driver registers
-
dht-embedded
reading temperature and humidity from the DHT11 and DHT22 sensors
-
proc-bitfield
expressively declare bitfield-like structs
-
mini-slcan-ng
Serial Line CAN (SLCAN) protocol decoder/encoder
-
max7797x-driver
An embedded async driver for the MAX77975/MAX77976 battery charger
-
shiftreg-spi
SPI-based driver for shift registers such as 74HC595 with embedded-hal API
-
blend-srgb
A small,
#![no_std]
-compatible sRGB conversion and blending library designed for performance -
mwatch-sdk
A development SDK for applications on the https://github.com/MWatch
-
usbd-blaster
USB Blaster for Embedded Devices
-
bl61x-pac
Embedded Rust's Peripheral Access Crate for BL616/BL618 microcontrollers
-
clerk
A fully featured hardware agnostic HD44780 LCD controlling library
-
avr_delay
AVR providing software-based delay functions
-
dtb-early-console
Init early console from device tree, mostly for Arm
-
qwiic-button-led
A driver for the SparkFun Qwiic Button LED
-
hopter_conf_params
Hopter embedded operating system configuration parameters
-
mnemos
A tiny embedded operating system kernel
-
bmp388
A platform agnostic driver to interface with the BMP388 pressure sensor
-
lvbitfile2rust-cli
Command line entrypoint for the lvbitfile2rust crate
-
microchip-eeprom-25x
A platform agnostic driver to interface with the Microchip 25xxxx EEPROM through SPI
-
microchip-eeprom-25lcxx
A platform agnostic driver to interface with the Microchip 25LCxx EEPROM through SPI
-
microchip-tc72r-rs
A platform agnostic driver to interface with the Microchip TC72 (temperature sensor) through SPI using embedded-hal
-
rust-forth-tokenizer
A Forth tokenizer written in Rust
-
aevum
A CLI utility to calculate timer register values for STM32 microcontrollers
-
async-opcua-core
OPC UA core utils for client and server
-
rkrga-sys
Rockchip RGA FFI bindings for Rust
-
nu-isp-cli
CLI tool for Nuvoton ISP_HID Bootloaders
-
ke04z4-pac
PAC for NXP Kinetis MKE04Zx microcontrollers
-
exo_task
A lightweight async task executor for bare metal (or any) systems
-
u32err
A neat error type for FFI functions (where non-zero = failure)
-
hd44780_menu
A menu system for use with the HD44780 display
-
efm32zg222-pac
Peripheral access API for EFM32ZG222 MCU (generated using svd2rust)
-
efm32zg110-pac
Peripheral access API for EFM32ZG110 MCU (generated using svd2rust)
-
efm32zg210-pac
Peripheral access API for EFM32ZG210 MCU (generated using svd2rust)
-
hvac
hvac controller state machine
-
rda5807m
driver for Rust
-
ezo_i2c_rs
interface to interact with Atlas Scientific Ezo Devices, using the I2C protocol
-
embedded-flight-scheduler
Embedded flight real-time scheduler library
-
umcan
A no_std rust crate to generate and parse CAN Frames for UltraMotion Actuators
-
sdio_sdhc
driver to drive sdhc over SDIO, no filesystem, only test stm32f407 board,other stm32f4xx boards have no test
-
max7301
Driver for the MAX7301 serial I/O expander
-
esp32
Peripheral access crate for the ESP32
-
daisy_bsp
A board support package for the Electro-Smith Daisy Seed
-
coreboot-table
Coreboot Table Parser
-
pic32mx567
Peripheral access API for PIC32MX5xx/6xx/7xx microcontrollers
-
thghosting-data-centers
THG Hosting Data Centers
-
lcd-pcf8574
Hitachi HD44780-compatible LCD display attached to PCF8574 I2C expander
-
cubic-splinterpol
efficient cubic spline interpolation on no_std
-
usbd-microsoft-os
Microsoft OS USB descriptors for usb-device
-
mcp4725-async
An async driver for the MCP4725 DAC
-
vfork
vfork-rs is used in embedded low memory to run an external program
-
bmx055
platform agnostic Rust driver for the BMX055 small, versatile 9-axis sensor module: 3D accelerometer, 3D gyroscope and 3D magnetometer
-
pebble-rust
Pebble bindings for Rust. See repository for instructions.
-
gc9a01a
SPI driver for the GC9A01A LCD display controller
-
mics-vz-89te
driver implementation
-
phm-worker
The Embedded Worker for Pretty HAL Machine
-
disasm-gen
disasm decodetree generator library
-
async-embedded-traits
A set of async traits for embedded systems
-
rp235x-pac
A Peripheral Access Crate for the Raspberry Pi RP235x microcontrollers
-
df2301q
Gravity Offline Voice Recognition Module Rust Driver
-
senseair
Protocol implementations to communicate with Senseair devices
-
lpc-usbd
'usb-device' implementation for LPC microcontrollers
-
drv2605l
A platform agnostic driver for the drv2605l haptic driver
-
lvgl-sys
Raw bindings to the LVGL C library
-
trinamic
Motion Control Language (TMCL) in Rust
-
embedded_font
Font rendering (ttf and otf) with embedded-graphics
-
ht32f1xxxx
Device support crates for HT32F1XXXX devices
-
max485
embedded-hal driver for operating the MAX485 uart to rs485 module in half duplex mode
-
thumby
TinyCircuits Thumby device
-
drogue-http-client
An HTTP client for embedded devices, based on drogue-network
-
max32660-hal
Hardware Abstraction Layer (HAL) for the MAX 32660 microcontroller
-
aarch64-arch-helpers
Helper functions to access aarch64 CPU registers
-
kernaux-sys
Unsafe no-std binding to libkernaux - auxiliary library for kernel development
-
ehlcd2d
embedded-hal driver for HD44780 with async support
-
tansig-lut
CLI generation of a Look Up Tables for tansig function with fixed-point arithmetic
-
dev-mmio
Memory mapped IO
-
alloc-traits
Traits to replace or supplement the alloc module in no_std
-
static-linkedlist
A linked list implementation on a static array. Intended for use in environments without dynamic memory allocation.
-
stackdump-capture-probe
capturing stack dumps of embedded devices with a debugging probe
-
ft6x06-rs
A pure Rust driver for the FT6x06 capacitive touch screen controller
-
svm40
Rust driver for the Sensirion SVM40 sensor
-
sh1122-rppal
A user mode driver for SH1122 (Raspberry PI interface)
-
person-sensor
An embedded-hal driver for the Useful Things Person Sensor
-
microasync-util
very small async runner
-
mcp9600
Basic embedded-hal-based I2C driver for the MCP9600 and MCP9601 thermocouple amplifier ICs
-
iaq-core
Platform-agnostic Rust driver for the iAQ-Core indoor air quality sensor. Compatible with iAQ-Core-C and iAQ-Core-P.
-
ruperl
embedding perl in your rust project
-
drone-tisl-map
Texas Instruments SimpleLink™ peripheral mappings for Drone, an Embedded Operating System
-
i2c-reg
Create registers for reading and writing with I2C interface
-
monotron-synth
1980's home computer style synthesiser that sounds pretty bad
-
urukul
Sinara Urukul quad 1 GHz DDS driver
-
dfr0299
serial protocol for the DFR0299 MP3 player module
-
jtagice_mkii
client for AVRice MKII JTAG debuggers
-
lorawan-device
LoRaWAN device stack implementation
-
anachro-icd
The Interface Control Document for Anachro-PC
-
esb
Nordic's Enhanced ShockBurst communication protocol
-
dps422
A platform agnostic driver to interface with the DPS422 barometric pressure & temp sensor through I2C
-
ht32f2yyy
Device support crates for HT32F2YYY devices
-
ht32f2xxxx
Device support crates for HT32F2XXXX devices
-
lpc54606-pac
Low-level register mappings for the NXP LPC54606 series of ARM Cortex-M4 microcontrollers
-
ch32v103-hal
WCH CH32v103 MCU HAL
-
bq27xxx
(bq27426, bq27427) platform-agnostic driver
-
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…
-
tm-wheel
Low-level hierachical timing wheel based timer driver implementation
-
nintendo64-pac
A peripheral access crate for the Nintendo 64
-
efm32zg108-pac
Peripheral access API for EFM32ZG108 MCU (generated using svd2rust)
-
ambiq-apollo3-pac2
Peripheral access API for APOLLO3 microcontrollers
-
vga-framebuffer
A text console output over a VGA compatible signal
-
drogue-grove-uart-spi
Grove's SPI over UART protocol
-
bern-conf-type
Bern RTOS configuration type
-
ldc1614
TI LDC1614 inductance-to-digital converter user-friendly driver for
embedded-hal
-
stemma_soil_sensor
reading data from Adafruit STEMMA Soil Sensor
-
embedded-fps
Frames Per Second counter for embedded devices
-
si5351
A platform agnostic driver for the Si5351 clock generator
-
can_aerospace_lite
A lite version of CAN Aerospace Implementation according to 'Interface specification for airborne CAN applications V 1.7'
-
bbq10kbd
An Embedded-HAL driver for @arturo182's bbq10kbd PMOD
-
efm32gg990
Peripheral access API for EFM32GG990 microcontrollers
-
atsamd51n20a
Peripheral access API for ATSAMD51N20A microcontrollers (generated using svd2rust)
-
embedded-registers
Procedural macro for effortless definitions of registers in embedded device drivers
-
sdp8xx
Platform agnostic Rust driver for the Sensirion SDP8xx differential pressure sensor
-
mctp-linux
Management Component Transport Protocol (MCTP) Linux transport
-
pic8259_simple
Kernel-space interface to the 8259 and 8259A interrupt controllers
-
efm32tg11b-pac
Peripheral access API for EFM32TG11B MCU (generated using svd2rust)
-
smlang-macros
Procedual macros for the smlang crate
-
adc-interpolator
An interpolator for analog-to-digital converters
-
debounced-pin
A platform-agnostic debounce library. It also adds a wrapper for an
InputPin
that debounces it’sis_high()
andis_low()
methods -
bern-conf
Bern RTOS default configuration
-
rart-rs
A async runtime to use the benefits of the availables embedded OS
-
embedded-threads
generic embedded scheduler & IPC
-
simink_spinlock
simink 自旋锁
-
lpc43xx
Register definitions for the NXP LPC43xx microcontroller platform, generated through svd2rust
-
is31fl3733
A platform agnostic driver to interface with the IS31FL3733 (16x12 LED Matrix Driver) written in Rust
-
lpc55s6x-pac
Peripheral access API for NXP LPC55s6x microcontrollers
-
pygamer
Board Support crate for the Adafruit PyGamer
-
ls7366
Rust interface to the LS7366 quadrature encoder buffer
-
async-opcua-server
OPC UA server API
-
hf2-cli
CLI for Microsoft HID Flashing Library for UF2 Bootloaders
-
device-register-async
A
no_std
library to describe the registers permissions of a device to ease async driver development -
shared
A macro for safely sharing data between application and interrupt context on cortex-m systems
-
opcua-core
Core components for OPC UA used by client and server
-
avr-libc
Rust bindings to avr-libc
-
da14531-hal
HAL crate for the DA14531 microcontroller
-
embedded-bacnet
A bacnet library for embedded systems (no_std)
-
efm32tg11b340-pac
Peripheral access API for EFM32TG11B340 MCU (generated using svd2rust)
-
efm32tg11b540-pac
Peripheral access API for EFM32TG11B540 MCU (generated using svd2rust)
-
efm32gg12b830-pac
Peripheral access API for EFM32GG12B830 MCU (generated using svd2rust)
-
efm32tg11b320-pac
Peripheral access API for EFM32TG11B320 MCU (generated using svd2rust)
-
efm32tg11b520-pac
Peripheral access API for EFM32TG11B520 MCU (generated using svd2rust)
-
efm32tg11b120-pac
Peripheral access API for EFM32TG11B120 MCU (generated using svd2rust)
-
efm32tg11b140-pac
Peripheral access API for EFM32TG11B140 MCU (generated using svd2rust)
-
efm32gg12b130-pac
Peripheral access API for EFM32GG12B130 MCU (generated using svd2rust)
-
efm32gg11b820-pac
Peripheral access API for EFM32GG11B820 MCU (generated using svd2rust)
-
efm32gg12b430-pac
Peripheral access API for EFM32GG12B430 MCU (generated using svd2rust)
-
efm32gg12b410-pac
Peripheral access API for EFM32GG12B410 MCU (generated using svd2rust)
-
efm32gg12b330-pac
Peripheral access API for EFM32GG12B330 MCU (generated using svd2rust)
-
efm32gg11b520-pac
Peripheral access API for EFM32GG11B520 MCU (generated using svd2rust)
-
efm32gg11b420-pac
Peripheral access API for EFM32GG11B420 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)
-
efm32gg12b310-pac
Peripheral access API for EFM32GG12B310 MCU (generated using svd2rust)
-
efm32gg12b110-pac
Peripheral access API for EFM32GG12B110 MCU (generated using svd2rust)
-
efm32gg11b320-pac
Peripheral access API for EFM32GG11B320 MCU (generated using svd2rust)
-
efm32gg12b510-pac
Peripheral access API for EFM32GG12B510 MCU (generated using svd2rust)
-
efm32gg11b110-pac
Peripheral access API for EFM32GG11B110 MCU (generated using svd2rust)
-
efm32gg12b530-pac
Peripheral access API for EFM32GG12B530 MCU (generated using svd2rust)
-
efm32gg12b810-pac
Peripheral access API for EFM32GG12B810 MCU (generated using svd2rust)
-
efm32wg980-pac
Peripheral access API for EFM32WG980 MCU (generated using svd2rust)
-
efm32wg990-pac
Peripheral access API for EFM32WG990 MCU (generated using svd2rust)
-
efm32wg995-pac
Peripheral access API for EFM32WG995 MCU (generated using svd2rust)
-
efm32wg942-pac
Peripheral access API for EFM32WG942 MCU (generated using svd2rust)
-
arm64_virt
simink 程序
-
efm32lg230-pac
Peripheral access API for EFM32LG230 MCU (generated using svd2rust)
-
efm32tg110-pac
Peripheral access API for EFM32TG110 MCU (generated using svd2rust)
-
efm32hg108-pac
Peripheral access API for EFM32HG108 MCU (generated using svd2rust)
-
efm32lg880-pac
Peripheral access API for EFM32LG880 MCU (generated using svd2rust)
-
efm32lg840-pac
Peripheral access API for EFM32LG840 MCU (generated using svd2rust)
-
efm32hg308-pac
Peripheral access API for EFM32HG308 MCU (generated using svd2rust)
-
efm32wg280-pac
Peripheral access API for EFM32WG280 MCU (generated using svd2rust)
-
efm32lg990-pac
Peripheral access API for EFM32LG990 MCU (generated using svd2rust)
-
efm32tg210-pac
Peripheral access API for EFM32TG210 MCU (generated using svd2rust)
-
efm32hg322-pac
Peripheral access API for EFM32HG322 MCU (generated using svd2rust)
-
efm32wg330-pac
Peripheral access API for EFM32WG330 MCU (generated using svd2rust)
-
efm32wg290-pac
Peripheral access API for EFM32WG290 MCU (generated using svd2rust)
-
efm32lg380-pac
Peripheral access API for EFM32LG380 MCU (generated using svd2rust)
-
efm32tg825-pac
Peripheral access API for EFM32TG825 MCU (generated using svd2rust)
-
efm32lg290-pac
Peripheral access API for EFM32LG290 MCU (generated using svd2rust)
-
efm32wg880-pac
Peripheral access API for EFM32WG880 MCU (generated using svd2rust)
-
efm32lg842-pac
Peripheral access API for EFM32LG842 MCU (generated using svd2rust)
-
efm32lg360-pac
Peripheral access API for EFM32LG360 MCU (generated using svd2rust)
-
efm32tg842-pac
Peripheral access API for EFM32TG842 MCU (generated using svd2rust)
-
efm32tg232-pac
Peripheral access API for EFM32TG232 MCU (generated using svd2rust)
-
efm32lg395-pac
Peripheral access API for EFM32LG395 MCU (generated using svd2rust)
-
efm32wg840-pac
Peripheral access API for EFM32WG840 MCU (generated using svd2rust)
-
efm32tg840-pac
Peripheral access API for EFM32TG840 MCU (generated using svd2rust)
-
efm32wg230-pac
Peripheral access API for EFM32WG230 MCU (generated using svd2rust)
-
efm32wg360-pac
Peripheral access API for EFM32WG360 MCU (generated using svd2rust)
-
efm32hg110-pac
Peripheral access API for EFM32HG110 MCU (generated using svd2rust)
-
efm32wg232-pac
Peripheral access API for EFM32WG232 MCU (generated using svd2rust)
-
efm32lg280-pac
Peripheral access API for EFM32LG280 MCU (generated using svd2rust)
-
efm32lg330-pac
Peripheral access API for EFM32LG330 MCU (generated using svd2rust)
-
efm32lg895-pac
Peripheral access API for EFM32LG895 MCU (generated using svd2rust)
-
efm32hg309-pac
Peripheral access API for EFM32HG309 MCU (generated using svd2rust)
-
efm32wg890-pac
Peripheral access API for EFM32WG890 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)
-
efm32lg995-pac
Peripheral access API for EFM32LG995 MCU (generated using svd2rust)
-
efm32lg942-pac
Peripheral access API for EFM32LG942 MCU (generated using svd2rust)
-
efm32hg350-pac
Peripheral access API for EFM32HG350 MCU (generated using svd2rust)
-
efm32wg295-pac
Peripheral access API for EFM32WG295 MCU (generated using svd2rust)
-
efm32hg210-pac
Peripheral access API for EFM32HG210 MCU (generated using svd2rust)
-
efm32lg940-pac
Peripheral access API for EFM32LG940 MCU (generated using svd2rust)
-
efm32hg222-pac
Peripheral access API for EFM32HG222 MCU (generated using svd2rust)
-
efm32wg900-pac
Peripheral access API for EFM32WG900 MCU (generated using svd2rust)
-
efm32wg940-pac
Peripheral access API for EFM32WG940 MCU (generated using svd2rust)
-
efm32lg232-pac
Peripheral access API for EFM32LG232 MCU (generated using svd2rust)
-
efm32tg222-pac
Peripheral access API for EFM32TG222 MCU (generated using svd2rust)
-
efm32tg225-pac
Peripheral access API for EFM32TG225 MCU (generated using svd2rust)
-
efm32wg390-pac
Peripheral access API for EFM32WG390 MCU (generated using svd2rust)
-
efm32wg842-pac
Peripheral access API for EFM32WG842 MCU (generated using svd2rust)
-
efm32tg108-pac
Peripheral access API for EFM32TG108 MCU (generated using svd2rust)
-
efm32hg310-pac
Peripheral access API for EFM32HG310 MCU (generated using svd2rust)
-
efm32gg900-pac
Peripheral access API for EFM32GG900 MCU (generated using svd2rust)
-
efm32gg290-pac
Peripheral access API for EFM32GG290 MCU (generated using svd2rust)
-
efm32gg890-pac
Peripheral access API for EFM32GG890 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)
-
efm32gg390-pac
Peripheral access API for EFM32GG390 MCU (generated using svd2rust)
-
efm32gg230-pac
Peripheral access API for EFM32GG230 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)
-
efm32gg995-pac
Peripheral access API for EFM32GG995 MCU (generated using svd2rust)
-
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)
-
efm32gg842-pac
Peripheral access API for EFM32GG842 MCU (generated using svd2rust)
-
efm32gg280-pac
Peripheral access API for EFM32GG280 MCU (generated using svd2rust)
-
efm32gg332-pac
Peripheral access API for EFM32GG332 MCU (generated using svd2rust)
-
efm32gg942-pac
Peripheral access API for EFM32GG942 MCU (generated using svd2rust)
-
efm32gg895-pac
Peripheral access API for EFM32GG895 MCU (generated using svd2rust)
-
sensirion-rht
Driver for several temperature and humidity sensors from Sensirion
-
xmc4200
Peripheral access library for XCM4200 ARM Cortex-M
-
efm32g290-pac
Peripheral access API for EFM32G290 MCU (generated using svd2rust)
-
efm32g842-pac
Peripheral access API for EFM32G842 MCU (generated using svd2rust)
-
efm32g890-pac
Peripheral access API for EFM32G890 MCU (generated using svd2rust)
-
efm32g880-pac
Peripheral access API for EFM32G880 MCU (generated using svd2rust)
-
efm32g840-pac
Peripheral access API for EFM32G840 MCU (generated using svd2rust)
-
efm32g210-pac
Peripheral access API for EFM32G210 MCU (generated using svd2rust)
-
efm32g222-pac
Peripheral access API for EFM32G222 MCU (generated using svd2rust)
-
efm32g232-pac
Peripheral access API for EFM32G232 MCU (generated using svd2rust)
-
efm32g200-pac
Peripheral access API for EFM32G200 MCU (generated using svd2rust)
-
ina260
A platform agnostic driver to interface with the I2C based TI INA260 power monitor
-
loadstone_config
Portable secure bootloader for Cortex-M MCUs - Configuration layer
-
i3g4250d
A platform agnostic driver to interface the I3G4250D (gyroscope)
-
tsl2591
embedded hal driver for the TSL2591
-
keypad2
reading a 3X4 keypad with embedded-hal
-
sfkv
Flash Key Value store
-
bq2515x
Device driver for the BQ2515x family of Texas Instruments linear battery chargers
-
atm90e32
A platform-agnostic driver for the ATM90E32 energy metering device
-
cbor-smol
Streamlined serde serializer/deserializer for CBOR
-
scd30-interface
An I2C driver for the SCD30 sensor in Rust
-
ssd1307fb
using embedded-graphics with framebuffer provided by ssd1307fb driver
-
atsamd51p20a
Peripheral access API for ATSAMD51P20A microcontrollers (generated using svd2rust)
-
efm32jg12b500-pac
Peripheral access API for EFM32JG12B500 MCU (generated using svd2rust)
-
wm8731-another-hal
Thin abstraction for the Cirrus Logic/Wolfson WM8731 audio codec IC
-
stm32g4-staging
Device support crates for STM32G4 devices
-
efm32jg1b100-pac
Peripheral access API for EFM32JG1B100 MCU (generated using svd2rust)
-
efm32jg1b200-pac
Peripheral access API for EFM32JG1B200 MCU (generated using svd2rust)
-
rsportal
A higher-level interface to the Adafruit PyPortal
-
max112x
Driver for the 24-bit MAX11214 and similar ADCs
-
max17320
An embedded hal driver for the MAX17320 (2S-4S ModelGauge m5 Fuel Gauge with Protector, Internal Self-Discharge Detection and SHA-256 Authentication)
-
array-utils
A no-std heapless set of array utils making use of const generics
-
embedded-hal-aht2x
Driver for the AHT2x temperature and humidity sensor based on embedded-hal-async
-
is31fl3743a
Driver for Lumissil Microsystem's IS31FL3743A IC
-
stm32-bootloader-client
communicating with the STM32 system bootloader
-
icm20689
ICM-20689 6DOF IMU driver for embedded hal
-
zssh
Minimal SSH server for embedded applications
-
embedded-hdc1080-rs
Rust driver for the HDC1080 low-power humidity and temperature digital sensor
-
wurth-calypso
Driver for the Würth Elektronik Calypso Wi-Fi radio module
-
w5500-dns
DNS client for the Wiznet W5500 internet offload chip
-
aarch64-std
implementations of standard library components for bare-metal aarch64
-
max6955
A platform agnostic driver to interface with MAX6955 LED Display Driver
-
hzgrow-r502
A USART driver for the HZ Grow R502 fingerprint reader module. May also be useful for other, similar modules.
-
nrf-pac
Peripheral Access Crate (PAC) for Nordic Semiconductor nRF chips
-
teensy4-selfrebootor
A self-rebooting implementation of teensy's rebootor for teensy4
-
cef-sys
Chromium Embedded Framework raw bindings for Rust. Generated using rust-bindgen.
-
tpa2016d2
Embedded-hal driver for the Texas Instruments TPA2016D2 Class-D amplifier
-
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
-
gpio-expander
A platform-independent driver for interacting with the products GPIO Port Expander (Troyka Module), Troyka HAT and Slot Expander Expansion Board
-
a653rs-postcard
Extension traits for sending types via a653rs channels using postcard
-
riscv-rt
Minimal runtime / startup for RISC-V CPU's
-
msp430fr6972
PAC for MSP430FR6972
-
uefi-macros
Procedural macros for the
uefi
crate -
qei
A wrapper that allows to extend quadratic encoder interface (QEI)
-
goertzel_algorithm
Goertzel algorithm implementation
-
phm-cli
The Interface Control Document (ICD) for Pretty HAL Machine
-
const-arrayvec
A vec-like type backed by an array on the stack
-
socketcand
parser for small systems
-
andes-riscv
Low level access to Andes' AndeStar V5 RISC-V processors
-
efm32gg11b310-pac
Peripheral access API for EFM32GG11B310 MCU (generated using svd2rust)
-
efm32gg11b120-pac
Peripheral access API for EFM32GG11B120 MCU (generated using svd2rust)
-
efm32gg11b510-pac
Peripheral access API for EFM32GG11B510 MCU (generated using svd2rust)
-
mips
Low-level abstraction of MIPS processors
-
nucleo-f401re
Board Support crate for the STM32 NUCLEO-f401RE development board
-
efm32lg980-pac
Peripheral access API for EFM32LG980 MCU (generated using svd2rust)
-
efm32wg395-pac
Peripheral access API for EFM32WG395 MCU (generated using svd2rust)
-
efm32wg332-pac
Peripheral access API for EFM32WG332 MCU (generated using svd2rust)
-
efm32lg332-pac
Peripheral access API for EFM32LG332 MCU (generated using svd2rust)
-
efm32wg895-pac
Peripheral access API for EFM32WG895 MCU (generated using svd2rust)
-
efm32lg390-pac
Peripheral access API for EFM32LG390 MCU (generated using svd2rust)
-
efm32tg230-pac
Peripheral access API for EFM32TG230 MCU (generated using svd2rust)
-
efm32hg321-pac
Peripheral access API for EFM32HG321 MCU (generated using svd2rust)
-
efm32lg890-pac
Peripheral access API for EFM32LG890 MCU (generated using svd2rust)
-
efm32wg380-pac
Peripheral access API for EFM32WG380 MCU (generated using svd2rust)
-
efm32tg822-pac
Peripheral access API for EFM32TG822 MCU (generated using svd2rust)
-
efm32gg940-pac
Peripheral access API for EFM32GG940 MCU (generated using svd2rust)
-
efm32gg295-pac
Peripheral access API for EFM32GG295 MCU (generated using svd2rust)
-
efm32gg840-pac
Peripheral access API for EFM32GG840 MCU (generated using svd2rust)
-
aarch64-intrinsics
AArch64 optimized compiler intrinsics
-
efm32g800-pac
Peripheral access API for EFM32G800 MCU (generated using svd2rust)
-
efm32g280-pac
Peripheral access API for EFM32G280 MCU (generated using svd2rust)
-
efm32g230-pac
Peripheral access API for EFM32G230 MCU (generated using svd2rust)
-
embedded_types
Types useful in embedded, no_std amd hw development
-
bern-test
test framework for hardware integration tests
-
embedded-crc32c
A
const
, single-choice opinionated tiny CRC32 implementation -
systemview-target
RTOS tracing trait implementation for SEGGER SystemView
-
simink_entry
simink 启动运行时环境初始化
-
ruspiro-arch-aarch64
access to Aarch64 system registers as well as specific usefull aarch64 assembly instructions
-
opcua-crypto
Encryption / decryption used by OPC UA client and server
-
labrador-ldpc
Encoders and decoders for CCSDS LDPC error correcting codes
-
embedded-display-controller
Traits for display controllers
-
hd44780-ntb
A non-text buffer embedded hal driver for hd44780 like LCD display controllers
-
free-flight-stabilization
PID flight stabilization functions. no_std, no-alloc.
-
a121-sys
Raw bindings to the A121 radar sensor C SDK
-
embedded-error
Universal error kinds for embedded systems
-
atsamx7x-hal
HAL and peripheral access API for ATSAME70, ATSAMS70, ATSAMV70, and ATSAMV71 microcontrollers
-
bmp390
Asynchronous driver for the BMP390 pressure sensor
-
icewrap
Port of Heatshrink to Rust
-
ublox-cellular-rs
Driver crate for u-blox cellular devices, implementation follows 'UBX-13002752 - R65'
-
tinywasm-parser
TinyWasm parser
-
sx127x_lora
A platform-agnostic driver for Semtech SX1276/77/78/79 based boards
-
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
-
sw3526
driver based on embedded-hal. Support
async
andsync
features. -
krab
minimalistic interpreted programming language written in Rust
-
mcp3424
Async Rust driver for the MCP3422/3/4 ADC
-
atsams70j19b
Peripheral access API for the ATSAMS70J19B MCU from Microchip (generated using svd2rust 0.30.3)
-
linux-raw-vdso
Linux vDSO parser for all the architectures
-
entro-shift
Entro Shift is a 32-bit, pseudo-random number generator algorithm
-
vexide-embedded-graphics
embedded-graphics driver for the VEX V5 Brain
-
ht32f5xxxx
Device support crates for HT32F5XXXX devices
-
emc230x
An async driver for the EMC230x family of fan controllers
-
is31fl32xx
A rust-embedded driver for the Lumissil Microsystems IS31FL3205 LED driver
-
mutex_trait2
Generic mutex trait
-
diswh-esp
way to send webhook messages on the ESP platform, or edit for discord. Fully featured with builders to make things easy!
-
embassy-time-driver
Driver trait for embassy-time
-
mcp230xx
MCP23008/MCP23017 8/16-Bit I2C I/O Expander with I2C Interface
-
signalo_filters
A collection of filters used in 'signalo' umbrella crate
-
embedded-graphics-framebuf
Frame buffer helper for embedded-graphics
-
keyberon
Parse command line argument by defining a struct
-
SKEAZN642
Device support crate for KEAZN64 devices
-
pdf417
No-std PDF417 encoder
-
va416xx-hal
HAL for the Vorago VA416xx family of MCUs
-
rfm69
A generic rust driver to support RFM69 family wireless chips
-
radio-sx128x
Driver for the Semtec sx1280 2.4GHz RF IC
-
dns-protocol
A DNS protocol implementation in Rust
-
bma400
A platform-agnostic Rust driver for the BMA400 12-bit ultra-low-power 3-axis accelerometer
-
lpc55-pac
Peripheral access API for NXP LPC55 microcontrollers
-
teensycore
A kernel for the teensy4.0 microcontroller
-
embedded-nano-mesh-linux-examples
Lightweight mesh communication protocol for linux
-
rn2xx3
Rust driver for Microchip RN2483 and RN2903 LoRaWAN modules. [WIP]
-
sparreal-kernel
Sparreal OS kernel
-
roblib
A shared library for a dank engine
-
linker-sections
Custom linker section memory initialization for no-std
-
stm32wb-hci
Bluetooth HCI for the STM32WB family
-
lcd_i2c_rs
interfacing with I2C LCDs on the ESP32 using the ESP-IDF HAL
-
qtest
Connector for working with the QTest socket
-
ape-fatfs
versitile FAT library for embedded systems
-
rpk-firmware
RPK Keyboard firmware
-
nstd_core
NSTD core crate
-
atsam4n8a-pac
Peripheral access crate for the ATSAM4N8A microcontroller
-
si7021-t-rh
Si7021 driver (7013, 7020 and 7021)
-
tiny-led-matrix
direct control of a small monochrome LED display
-
am2301
interface with an AM2301 humidity and temperature sensor
-
embedded-menu
interactive menu for embedded devices
-
noshell
no_std argument parser and a shell for constrained systems
-
postform_rtt
Decodes Rtt logs for Postform, an efficient logging framework for mcu's
-
alt-stm32f30x-hal
Alternative HAL impl for the STM32F30x family of microcontrollers
-
lsm303dlhc-ng
A platform agnostic driver to interface with the LSM303DLHC (accelerometer + compass)
-
fwsig
A specification (and tools) for firmware signing / verification
-
wasefire-cli-tools
Command-line utilities for Wasefire
-
gd32c1x3-hal
HAL for the GD32C1x3 family of microcontrollers
-
arduino-run
A cargo runner for Arduino boards
-
rustot
AWS IoT
-
embedded-sgp30
Platform-agnostic Rust driver for the SGP30 gas sensor for indoor air quality applications
-
edwardium_logger
logger implementation
-
eg-seven-segment
Seven-segment displays for embedded-graphics
-
nrf24l01
A pure Rust user space driver for NRF24L01(+) transceivers on Linux
-
adafruit-bluefruit-protocol
A
no_std
parser for the Adafruit Bluefruit LE Connect controller protocol -
safe-ftdi
A safe wrapper around libftdi
-
ag-lcd
port of the LiquidCrystal arduino library
-
drogue-esp8266
Networking stack for ESP8266 Wifi offload board
-
trallocator
A no_std lbrary for wrapping an existing allocator and tracking the heap usage
-
embedded-nrf24l01-async
A driver for NRF24L01(+) transceivers on embedded-hal-async platforms(base on embedded-nrf24l01)
-
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.
-
panic-serial
Print panics on serial port
-
stm32wlxx-hal
Hardware abstraction layer for the STM32WL series microcontrollers
-
rpi_sim868
RPi SIM868 is a crate designed to facilitate interaction with the Waveshare SIM868 HAT for Raspberry Pi
-
channel-bridge
Blocking and async Sender and Receiver traits and implementations
-
panic-msp430
Halting panic implementation for MSP430 microcontrollers
-
pcf8563
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
scpi-contrib
SCPI/IEEE488.2 contrib library
-
lpc13xx-pac
Device support crates for LPC13XX-PAC devices
-
new-home-gpio
first application of the new-home system. It controls the GPIO outputs of the Raspberry PI with the help of the sysfs.
-
tmp1075
Platform-independent Rust driver for TMP1075 digital temperature sensor
-
ibus-rs
A no_std compatible IBUS RC protocol parser for embedded systems
-
rustos
Writing an OS in Rust
-
d3xs
Physical access control (daemon)
-
flipperzero-alloc
Flipper Zero
-
rtic-monotonic
Core abstractions of the Real-Time Interrupt-driven Concurrency Monotonic timers
-
bitwrap_extra
pack/unpack data into byte array
-
nrf51-pac
Peripheral Access Crate for Nordic's nrf51 microcontroller
-
mk20d7-hal
HAL for the MK20D7 family of microcontrollers
-
drmem-drv-sump
DrMem driver which monitors a sump pump
-
lpc845-pac
Low-level register mappings for the NXP LPC845 series of ARM Cortex-M0+ microcontrollers
-
mutex-traits
An abstraction over closure-based mutexes
-
std-embedded-nal-async
embedded-nal-async
traits for large devices that support the standard library -
mcumeter
Firmware for my MCU power meter based upon STM32F042 and INA260
-
s32k144
Peripheral access API for NXP S32K144 microcontrollers (generated using svd2rust)
-
gpio-cdev
Linux GPIO Character Device Support (/dev/gpiochipN)
-
stackdump-capture
capturing stack dumps
-
esp-alloc
A heap allocator for Espressif devices
-
nstr
A no_std, no_alloc, embedded-friendly string library
-
ruspiro-register
definitions to conviniently work with register field values that are typically presented by a set of bit fields
-
sx1509-eh
An embedded-hal focused driver for the SX1509 GPIO expander
-
device-register
A
no_std
library to describe the registers permissions of a device to ease driver development -
ina233
driver for the Texas Instruments INA233 power monitor
-
esp_idf_dev_sys
Bindings for esp-idf (Espressif's IoT Development Framework)
-
stm32f4
Device support crates for STM32F4 devices
-
tsl2591-eh-driver
Rust embedded-hal driver for the TSL2591 Light Sensor
-
mh-z19c
Pure rust implementation to read out the Winsen MH-Z19C CO2 sensor
-
mcp23017-tp
Rust Driver for device MCP23017 16-Bit I2C I/O Expander with Serial Interface
-
raslib
Manage Raspberry PI devices with Rust. GPIO ports and direct support for L298N circuit motors
-
st7567_rs
ST7567 LCD driver with embedded-graphics support
-
smart-leds-matrix
DrawTarget implementation for smart led based matrixes. It allows the usage of the embedded-graphics Drawables.
-
xdevs-no-std
no-std implementation of xDEVS for real-time simulation on embedded systems
-
metrics-controller
Metrics Controller is a project to collect metrics for Mozilla IOT projects
-
derive-mmio
A mechanism for making it easier to access MMIO peripherals
-
northstar-client
Northstar is an container runtime for Linux targetting embedded systems
-
edge-executor
Async executor suitable for embedded environments
-
efm32g-pac
Peripheral access API for EFM32G MCU (generated using svd2rust)
-
embassy-embedded-hal
Collection of utilities to use
embedded-hal
andembedded-storage
traits with Embassy -
adp5360
An async embedded-hal driver for the ADP5360 Power Management IC
-
embedded-list
A list component for embedded-graphics
-
ssd1322_rs
A no-std async Rust driver for the SSD1322 OLED screen
-
w5500-tls
TLS client for the Wiznet W5500 internet offload chip
-
lsm303dlhc-registers
A typed map of the STMicroelectronics LSM303DLHC E-Compass registers
-
ds323x
Platform-agnostic Rust driver for the DS3231, DS3232 and DS3234 extremely accurate real-time clocks (RTC)
-
mp2667
Platform agnostic Rust driver for the MP2667, highly integrated, single-cell, Li-ion/Li-polymer battery charger IC
-
defmt-brtt
Defmt logs over RTT as well as through a BBQueue
-
gdeh0154d67
Driver for the GDEH0154D67 E-Paper display
-
cortex-m-log
Logging facilities for Cortex-M processors
-
dw1000
Driver for the Decawave DW1000 UWB wireless transceiver chip, providing radio communication based on IEEE 802.15.4 and distance measurement
-
d1-pac
Peripheral access API for Allwinner D1 SoC generated from unofficial SVD file
-
bmp085-180-rs
Driver for BMP085 & BMP180 sensors
-
neorv32-rt
NEORV32 runtime support for Rust
-
ws2812-async
Async SPI driver for ws2812 leds
-
nostd_async
An asyncronous runtime for a single-threaded no_std environment
-
stm32-usbd2
'usb-device' implementation for STM32 microcontrollers
-
cargo-minicov
Code coverage support for no_std and embedded programs
-
bxcan
STM32 bxCAN peripheral driver
-
oxide-spark
enables sensor sampling & LED strips control over Wifi/MQTT on ESP Rust Board
-
device-driver-generation
Code generation for the
device-driver
crate -
bl602-sdk
Rust Wrapper for BL602 IoT SDK
-
serial-sensors-proto
wire format for transmitting MEMS sensor data and friends
-
sk6812_rpi
SK6812RGBW library for RaspberryPi
-
rkrga
Rockchip RGA bindings for Rust
-
nucleo-h7xx
Board support crate for the STMicroelectronics STM32H7 Nucleo-144 boards
-
ti-lp55231
Linux I2C driver for Texas Instruments LP55231 LED controller
-
esp32s2
Peripheral access crate for the ESP32-S2
-
defmt-bbq
A generic bbqueue based transport for defmt log messages
-
liboscore-msgbackend
libOSCORE's CoAP messages based on the cjGoap-message crate
-
esp-config
Configure projects using esp-hal and related packages
-
async-opcua-client
OPC UA client API
-
tmp451
Platform-agnostic Rust driver for the TMP451 remote and local temperature sensor
-
vorago-reb1
Board Support Crate for the Vorago REB1 development board
-
cstream
libc::FILE
streams ‘c streams’ -
stm32f1xx-hal
HAL for the STM32F1xx family of microcontrollers
-
sensor_lib_as5600
A driver for the AS5600 sensor module
-
light-control
mqtt light control
-
ade791x
Driver for the ADE7912/ADE7913 3-Channel, Isolated, Sigma-Delta ADC with SPI
-
vcnl36825t-rs
Vishay VCNL36825T proximity sensor driver for embedded-hal i2c traits
-
pir-motion-sensor
PIR motion sensors
-
mci
MultiMedia Card Interface (SD, MMC, SDIO) implementation using MCI
-
drone-core
The core crate for Drone, an Embedded Operating System
-
ch32-metapac
Peripheral Access Crate (PAC) for all WCH's MCU chips, including metadata
-
ht32-usbd
'usb-device' implementation for HT32 microcontrollers
-
imxrt-usbd
USB driver for NXP iMX RT processors
-
stmpe1600
Platform-agnostic Rust driver for the STMPE1600 I/O expander
-
blue_hal
Embedded Hardware Abstraction Layer
-
grounded
A toolkit for managing unsafe statics
-
embedded-svc
A set of traits for services higher level than embedded-hal and typically found in embedded microcontrollers with WiFi or BLE support
-
minireq
Lightweight support for MQTT-based request/response handling interfaces
-
embassy-usb-logger
log
implementation for USB serial usingembassy-usb
-
bt-hci
Bluetooth HCI data types
-
teensy4-pins
Helpers for configuring and using a Teensy 4's pins. Part of the teensy4-rs project
-
canadensis_can
A Cyphal implementation: Cyphal/CAN (CAN and CAN FD) transport layer
-
neotron-api
The API between Neotron OS and Neotron applications
-
lpc550x
Register mappings for the NXP LPC550x/LPC55S0x family of Cortex-M33 microcontrollers
-
gd32e2
Device support crate for GD32E2 devices
-
chyyuu/os
OS kernel labs based on Rust/C Lang & RISC-V 64/X86-32
-
volatile-register
Volatile access to memory mapped hardware registers
-
tmp1x2
Platform-agnostic Rust driver for the TMP102 and TMP112 digital temperature sensors
-
ds18b20
temperature sensor driver for embedded-hal
-
arena-alloc
A small arena allocator with a static backing store and ability to allocate arbitrary types
-
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.
-
pcd8544
communicate and write to PCD8544 using embedded_hal as abstraction layer. WIP
-
avr-mcu
Pragmatic structures for all AVR microcontrollers
-
mcp4725
Microchip MCP4725 DAC Driver for Rust Embedded HAL
-
sparreal-rt
Sparreal OS kernel
-
nlabapi
Communication with nLab devices
-
sensor-temp-humidity-sht40
Driver for SHT40 temperature and humidity sensor
-
snowgoons4809-device
Register access crate for ATmega4809. DO NOT USE unless you have a good reason.
-
udatatable
creating data tables in an embedded no_std environment without an allocator
-
defmt-print
that decodes defmt logs and prints them to the console
-
ms5611-i2c
no_std Library for the MS5611 barometric pressure sensor only for I2C with embassy
-
nrf24l01-commands
Register bitfields and commands for the nRF24L01
-
stm32f1xx-lal
LAL for the STM32F1xx family
-
embedded-nal-minimal-coaptcpserver
A minimal CoAP-over-TCP server implementation built on embedded-nal
-
tinyrlibc
Tiny, incomplete C library for bare-metal targets, written in Stable (but Unsafe) Rust
-
lcd_parallel_bus
A driver for various liquid crystal displays driven by HD44780 or equivalent, including double controller like 40x4 displays
-
ads129xx
Driver crate for the Texas Instruments ADS1292 24-bit 2-channel low-power analog front end for ECG applications
-
wasefire-scheduler
Wasefire scheduler
-
atsam4n16c-pac
Peripheral access crate for the ATSAM4N16C microcontroller
-
atsamd21e
Peripheral access API for ATSAMD21E microcontrollers (generated using svd2rust)
-
nrf-dfu-target
Nordic nRF DFU protocol for devices
-
nrf9160-pac
Peripheral Access Crate for Nordic's nrf9160 microcontroller
-
unflappable
A batteries-included embedded-hal InputPin debouncer
-
efm32tg-pac
Peripheral access API for EFM32TG MCU (generated using svd2rust)
-
vs1003-pac
VS1003 audio codec peripheral access crate
-
nucleo-l031k6-bsp
Board support crate for the ST L031K6-NUCLEO
-
opcua-server
OPC UA server API
-
nstd-sys
Cross platform general purpose C library written in Rust
-
avr-std-stub
Contains simple implementations of required language items that
libstd
normally defines on other targets -
tb6612fng
A
no_std
driver for the TB6612FNG motor driver -
efr32xg1
Peripheral access API for EFR32xG1 microcontrollers
-
bmp280-ehal
A platform agnostic driver to interface with the BMP280 pressure sensor
-
embedded-hal-nb
Non-blocking Hardware Abstraction Layer (HAL) for embedded systems using the
nb
crate -
atsams70n19b
Peripheral access API for the ATSAMS70N19B MCU from Microchip (generated using svd2rust 0.30.3)
-
ens160-aq
ScioSense ENS160 driver
-
nstd_collections
NSTD collections crate
-
embassy-usb-synopsys-otg
embassy-usb-driver
implementation for Synopsys OTG USB controllers -
nrf52840-dk-bsp
BSP for the nRF52840-DK
-
lpc8xx-hal
Hardware Abstraction Layer (HAL) for the NXP LPC800 series of ARM Cortex-M0+ microcontrollers
-
e310x
With svd2rust generated peripherals for Freedom E310 MCU's
-
spl_tool
Port of StarFive's C spl_tool with default support for VisionFive2
-
rtic-time
Basic definitions and utilities that can be used to keep track of time
-
the-bridge
Efficient Binary Protocol Bridge for std and no_std Environments
-
jt808-rs
JT808 protocol
-
dps310
A platform agnostic driver to interface with the DPS310 barometric pressure & temp sensor through I2C
-
iis2mdc
driver for ST iis2mdc sensor
-
rainmaker
ESP RainMaker Agent
-
loadstone
Portable secure bootloader for Cortex-M MCUs
-
ublox-short-range-rs
Driver crate for u-blox short range devices, implementation follows 'UBX-14044127 - R40'
-
encoded_pin
Binary encoded OutputPin, e.g. for encoded SPI chip select
-
stm32g0-staging
Device support crates for STM32G0 devices
-
esp-idf-sys
Bindings for ESP-IDF (Espressif's IoT Development Framework)
-
ufmt-stdio
C stdio writer for ufmt
-
canadensis_serial
A Cyphal implementation: Cyphal/Serial transport
-
ltr-559
LITEON LTR-559 ligth and proximity sensor
-
dwt-systick-monotonic
RTIC Monotonic implemenation based on Systick and DWT
-
ina226
Driver for INA226 I2C voltage/current/power monitor
-
gdb-server
A gdb stub implementation for on chip debugging and flashing of ARM chips
-
xmc4700
XMC peripheral library for XMC4700 generated from SVD
-
phidget-sys
Low-level, unsafe, Rust wrapper for the phidget22 library
-
signalo_sinks
A collection of filters used in 'signalo' umbrella crate
-
adafruit-lcd-backpack
Unofficial driver for the Adafruit I2C LCD backpack
-
embedded-hal-bus
Bus/Device connection mechanisms for embedded-hal, a Hardware Abstraction Layer (HAL) for embedded systems
-
pl011-uart
A driver for the Arm PL011 UART
-
signalo_sources
A collection of filters used in 'signalo' umbrella crate
-
ellie_fmt
Formatter for ellie
-
lps25hb
A platform agnostic driver to interface with LPS25HB pressure sensor module
-
wasefire-wire
Wasefire wire format
-
ft6x06
A platform agnostic driver for the FT6x06 type touch panel controller used on STM32F4 series board
-
usbd-ccid
usb-device driver for CCID
-
lpc11uxx
Register mappings for the NXP LPC11Uxx family of ARM Cortex-M0+ microcontrollers
-
postform_persist
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
dwm1001
Board Support Crate for the Decawave DWM1001 module and development board
-
imxrt1062-lpi2c1
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…
-
ssd1680
Driver for the SSD1680 e-Paper display (EPD) controller, for use with embedded-hal
-
riscu
loading/encoding RISC-U ELF64 binaries
-
atsam4-hal
HAL for the ATSAM4 microcontrollers
-
rn4870
A platform agnostic driver for the RN4870 BLE module
-
font_7seg
7セグメントLED風数字フォント
-
lsm303c
A platform agnostic driver to interface with the LSM303C (accelerometer + compass)
-
mcp23017-driver
A comprehensive Rust driver for the Microchip MCP23017 IO expander
-
memory-lcd-spi
A driver for Sharp's Memory LCD or JDI's Memory In Pixel display, LPM013M126A, LPM009M360A, LS027B7DH01, etc
-
l3gd20
A platform agnostic driver to interface the L3GD20 (gyroscope)
-
w5500-dhcp
DHCP client for the Wiznet W5500 internet offload chip
-
teensy4-panic
Panic handler for the Teensy 4. Part of the teensy4-rs project
-
drone-stm32-map
STM32 peripheral mappings for Drone, an Embedded Operating System
-
ppproto
Point-to-Point Protocol (PPP) for embedded systems.
no-std
compatible, no alloc (heap) required. -
atsam4n16b-pac
Peripheral access crate for the ATSAM4N16B microcontroller
-
stm32g0
Device support crates for STM32G0 devices
-
embedded-hal-error
core::error::Error for embedded-hal Errors
-
blinker
easily creating async blinky programs for embedded systems
-
bbqueue-ng
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
reg-map
Derive volatile accesses to a register map and memory-mapped IO
-
bootkbd
Boot-protocol keyboard driver for usb-host
-
crosstrait
Cast from
dyn Any
to other trait objects, with no_std, no alloc support -
fs3000-rs
A platform-agnostic, embedded-hal driver for FS3000 airflow sensors
-
ufloat
Wrappers around floating point numbers with ufmt trait implementations
-
esp-hal-embassy
Embassy support for esp-hal
-
atsamd11d
Peripheral access API for ATSAMD11D microcontrollers (generated using svd2rust)
-
ruspiro-mailbox
Raspberry Pi mailbox property tag interface API
-
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.
-
p256-cortex-m4
Idiomatic, misuse-resistent bindings to P256-Cortex-M4
-
async-embedded-sdmmc
Embedded sdmmc driver with async support
-
msp430g2553
Peripheral access API for MSP430G2553 microcontroller
-
wasefire-board-api
Wasefire board API
-
aarch64-rt
Startup code and exception vector for aarch64 Cortex-A processors
-
sgpc3
Rust driver for the Sensirion SGPC3 gas sensor
-
edge-nal-std
A STD implementation of edge-nal based on
async-io
-
nrf24radio
Asynchronous embedded driver for NRF24L01(+) devices
-
w25q32jv
An embedded-hal driver for the W25Q32JV
-
r3_port_arm_m
Cortex-M port for the R3-OS original kernel
-
saks
Swiss Army Knife Shield for Raspberry Pi
-
espsign
signing ESP32 firmware images for ESP RSA Secure Boot V2
-
lpc11xx-async-hal
Asynchronous HAL for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
zerocrush
Low-overhead compression for sparse files
-
bhi160
driver for the Bosch Sensortec BHI160(B) smart sensors
-
async-opcua-core-namespace
OPC UA generated code for the core namespace
-
xtensa-lx-rt
Minimal startup/runtime for Xtensa LX CPUs
-
nrf-hal
Hardware abstraction layer for Nordic nRF5x chips
-
hpm-riscv-rt
Low level access to HPMicro's RISC-V processors
-
nrf52840-pac
Peripheral Access Crate for Nordic's nrf52840 microcontroller
-
eeprom25aa02e48
Platform-agnostic Rust driver for the 25AA02E48 EEPROM
-
ssd1322
SPI driver for the SSD1322 OLED display controller
-
atsam3x
Device support crates for ATSAM3X devices
-
adxl345-eh-driver
Rust embedded-hal device driver for the ADXL345 Analog Devices Digital Accelerometer
-
stm32wb-hal
Hardware abstraction layer for the STM32WB55 chips
-
drmem-drv-ntp
DrMem driver which monitors ntpd daemons
-
atsame54p
Peripheral access API for ATSAME54P microcontrollers (generated using svd2rust)
-
no-std-async
Async synchronization primitives for #[no_std] rust
-
push2_display
Ableton Push2 Embedded-graphics display driver
-
minimult_cortex-m
A minimal multitask library, or RTOS, for Cortex-M microcontrollers
-
cyw43
Rust driver for the CYW43439 WiFi chip, used in the Raspberry Pi Pico W
-
fe_rtos
OS for Arm Cortex-M CPUs
-
efm32hg-pac
Peripheral access API for EFM32HG MCU (generated using svd2rust)
-
max3010x
Platform-agnostic Rust driver for the MAX3010x high-sensitivity pulse oximeter and heart-rate sensor for wearable health
-
stackdump-trace
tracing stack dumps
-
hal-sim
An embedded-hal and embedded-graphics Display simulator
-
probe-rs-t2rust
A collection of ARM chips for the
probe-rs
crate -
liboscore-cryptobackend
libOSCORE's cryptographic primitives backend based on Rust implementations
-
eeprom
emulation on top of FLASH for STM32
-
ruspiro-mmio-register
macros to conviniently define memory mapped I/O (MMIO) registers
-
pcal6416a
Platform-agnostic Rust driver for the Texas Instruments BQ25773 battery charge controller
-
drone-nrf-map
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
littlefs2-sys
Low-level bindings to littlefs
-
pybadge-high
High Level Board Support crate for the Adafruit pybadge
-
vl53l1x-simple
driver for the VL53l1X TOF ranging sensor
-
ch58x
Device support crates for CH58X devices
-
embedded-plots
Heapless plotting library for embedded targets based on embedded-graphics crate
-
utrace
Instrumentation-based profiling library for embedded targets with async support
-
lpc55-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
xmc4500
XMC peripheral library for XMC4500 generated from SVD
-
lcd1604_gpio
Abstraction layer for interfacing between Raspberry Pi and 16x2 or 16x4 LCD display modules through GPIO
-
opcua-types
OPC UA types and constants
-
w5500-regsim
Register simulation for the Wiznet W5500 internet offload chip
-
micro_framebuffer
A very simple framebuffer for embedded systems
-
riscv-slic
RISC-V Software-Level Interrupt Controller
-
rdif-base
Driver Interface base definition
-
embassy-boot
A lightweight bootloader supporting firmware updates in a power-fail-safe way, with trial boots and rollbacks
-
libpower
containing algorithms commonly used in power electronics systems, targeted for use in embedded systems
-
tock/riscv-csr
RISC-V CSR interface developed for Tock
-
imxrt-dma
DMA driver for i.MX RT processors
-
gd32f2
Device support crate for GD32F2 devices
-
atsame70j21b
Peripheral access API for the ATSAME70J21B MCU from Microchip (generated using svd2rust 0.30.3)
-
embedded-platform
Holistic embedded device support in a batteries-included manner
-
critical-section-lock-mut
Provide locks for mutable data using
critical-section
crate -
imxrt1062-core
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…
-
systick-monotonic
RTIC Monotonic implementation based on SysTick
-
wio_lite_w600
Board Support crate for the Wio Lite W600
-
drogue-bme680
interface with the BME680 environmental sensor
-
easy_esp
Wrapper around socket functionality to make using devices safer and easier
-
std-embedded-time
embedded-time Clocks using std::time
-
avr-config
An AVR foundational crate for retrieving details, such as the CPU clock frequency, at runtime
-
cortex-ar
CPU support for AArch32 Arm Cortex-R and Arm Cortex-A
-
probe-rs-cli-util
Helper library for CLI applications based on probe-rs
-
ruspiro-console
Lightweight console abstraction for bare metal implementations to print strings to an output channel that could be easely configured/attached
-
max32660
Register mappings for the Analog Devices MAX32660 Cortex-M4 microcontroller
-
gbl
GBL firmware file handling library
-
stm32f429
Peripheral access API for STM32F429 microcontrollers
-
atsam4n8c-pac
Peripheral access crate for the ATSAM4N8C microcontroller
-
stm32f1
Device support crates for STM32F1 devices
-
stm32h7-staging
Device support crates for STM32H7 devices
-
opt300x
Platform-agnostic Rust driver for the OPT300x ambient light sensors. Compatible with OPT3001, OPT3002, OPT3004, OPT3006 and OPT3007
-
esptools
(esptool, espsecure and espefuse) bundler
-
embassy-net-adin1110
embassy-net driver for the ADIN1110 ethernet chip
-
ral-registers
MMIO registers abstraction with a macro API
-
pcie
driver for enumerating devices
-
r3_port_std
Simulator port for the R3-OS original kernel
-
eva-client
RT/HTTP Client for EVA ICS v4
-
ad983x
Platform-agnostic Rust driver for the AD9833, AD9834, AD9837 and AD9838 low-power programmable waveform generators / direct digital synthesizers
-
esp-embassy-wifihelper
helper library to make it easier to connect to wifi with esp-embassy
-
postform_serial
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
nrf52840-hal
HAL for nRF52840 microcontrollers
-
edge-frame
Yew & Wasm-based user interface for microcontrollers
-
drmem-drv-tplink
DrMem driver for TP-Link devices
-
embedded-dma
Traits to aid in the creation of sound DMA abstractions
-
gx21m15
driver based on embedded-hal. Support
async
andsync
features. -
va108xx-embassy
Embassy-rs support for the Vorago VA108xx family of microcontrollers
-
lilos-handoff
Synchronous rendezvous structure for lilos
-
r528-pac
Peripheral access API for Allwinner R528 SoC generated from unofficial SVD file
-
groundhog
A rolling timer abstraction
-
pcf85063a
An embedded-hal driver for the pcf85063a RTC
-
esp32c6
Peripheral access crate for the ESP32-C6
-
qingke-rt
Minimal runtime / startup for WCH's RISC-V MCUs, managed by the ch32-rs team
-
embedded-nal-minimal-coapserver
A minimal CoAP server implementation built on embedded-nal
-
blinq
An embedded-hal blinking queue
-
embedded-io-async
Async embedded IO traits
-
pico_pll_config
PLL configuration macro for the Raspberry Pi Pico
-
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 -
efm32zg-pac
Peripheral access API for EFM32ZG MCU (generated using svd2rust)
-
opcua-client
OPC UA client API
-
embedded-hal-async
An asynchronous Hardware Abstraction Layer (HAL) for embedded systems
-
atsamd21j
Peripheral access API for ATSAMD21J microcontrollers (generated using svd2rust)
-
figments
A high performance graphics API for microcontrollers
-
canadensis_encoding
A Cyphal implementation: Transfer encoding and decoding
-
embedded-drivers
Platform-agnostic Rust drivers for BME280/BMP280/BMP180, LM75, PMSx003
-
signalo_pipes
A collection of pipes used in 'signalo' umbrella crate
-
nucleo-wl55jc-bsp
Board support package for the NUCLEO-WL55JC
-
async-pool
Statically allocated pool providing a std-like Box, with async functionality
-
bbqueue-sync
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
ham-cats
Reference implementations for CATS, the ham radio protocol
-
serialmessage
Pack serial data into a fast, reliable, and packetized form for communicating with e.g. a Microcontroller.
-
ch58x-hal
HAL for the CH583/CH582/CH581 RISC-V BLE microcotrollers from WCH
-
atsame54n
Peripheral access API for ATSAME54N microcontrollers (generated using svd2rust)
-
soft-i2c
Soft i2c for any open drain pin
-
mwatch_kernel
A embedded 'Smart' watch
-
imxrt1062-lpuart1
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…
-
ufmt-write
μfmt
’suWrite
trait -
defmt-json-schema
defmt JSON schema
-
stm32g4
Device support crates for STM32G4 devices
-
lm75
Platform-agnostic Rust driver for the LM75 temperature sensor and thermal watchdog
-
embedded-can
HAL traits for Controller Area Network (CAN) devices
-
defmt-semihosting
Transmit defmt log messages over the Cortex-M Semihosting protocol
-
pic32-config-sector
Calculate constant values for PIC32 configuration words
-
bmi160
Platform-agnostic Rust driver for the BMI160 inertial measurement unit (IMU)
-
stm32ral
Register access layer for all STM32 microcontrollers
-
cyw43-pio
RP2040 PIO SPI implementation for cyw43
-
xmc4400
XMC peripheral library for XMC4400 generated from SVD
-
mik32-rt
Minimal runtime / startup for MIK32 MCUs, managed by the mik32-rs team
-
imxrt-log
Logging extensions for i.MX RT processors
-
rusty-os
kernel for embedded systems written in Rust
-
bme280-multibus
BME280 driver with support for SPI and I2C
-
w5500-sntp
SNTP client for the Wiznet W5500 internet offload chip
-
drogue-ajour-protocol
A firmware update protocol designed for embedded devices
-
coap-zero
CoAP protocol implementation for no_std without alloc
-
drone-stm32-map-periph-gpio
STM32 peripheral mappings for Drone, an Embedded Operating System
-
aht20-async
A platform agnostic driver to interface with the AHT20 temperature/humidity sensors
-
bluenrg
Interface to ST Micro BlueNRG Bluetooth radios
-
gd32vf103xx-hal
HAL for GD32VF103 microcontrollers
-
stm32l4xx-hal
Hardware abstraction layer for the stm32l4xx chips
-
avr
AVR emulator
-
gd32e5
Device support crate for GD32E5 devices
-
nisty
NIST P256 signatures for Cortex-M4 microcontrollers
-
cortex-m-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
rtos-trace
RTOS tracing trait
-
xca9548a
Platform-agnostic Rust driver for the TCA954xA and PCA954xA I2C switches/multiplexers
-
scoped-mutex
An abstraction over closure-based mutexes
-
cc13x2_26x2_pac
Peripheral Access Crate for TI's cc13x2/cc26x2 microcontroller family
-
wasefire-cli
Wasefire CLI to manage applets and platforms
-
sh1106
I2C/SPI driver for the SH1106 OLED display controller
-
n64-pac
low-level CPU and register abstractions for the Nintendo 64 console
-
embedded-profiling
Profiling for
no-std
embedded targets -
async-opcua-nodes
OPC UA node representation and import framework
-
esp32h2
Peripheral access crate for the ESP32-H2
-
apa102-spi
SPI-based Driver for apa102 leds
-
atsame70q19b
Peripheral access API for the ATSAME70Q19B MCU from Microchip (generated using svd2rust 0.30.3)
-
stm32f3-staging
Device support crates for STM32F3 devices
-
atsam4n8b-pac
Peripheral access crate for the ATSAM4N8B microcontroller
-
riscv-rt-macros
Attributes re-exported in
riscv-rt
-
dummy-pin
Dummy implementations of the input/output pin embedded-hal traits
-
va416xx-embassy
Embassy-rs support for the Vorago VA416xx family of microcontrollers
-
wasefire-protocol
Wasefire protocol between platform and host
-
embassy-net-driver-channel
High-level channel-based driver for the
embassy-net
async TCP/IP network stack -
mspm0l130x
Peripheral access crate for TI MSPM0L130X microcontroller
-
onewire
using embedded_hal as abstraction layer, based on arduino OneWire library. WIP
-
imxrt1062-enet
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…
-
gd32e1
Device support crate for GD32E1 devices
-
riscv-target
RISC-V target string manipulation utilities
-
rtcc
Real-time clock / calendar (RTC / RTCC) traits
-
micropb-gen
Generate Rust module from Protobuf files
-
esp32c2
Peripheral access crate for the ESP32-C2
-
atsamd11c
Peripheral access API for ATSAMD11C microcontrollers (generated using svd2rust)
-
gfx-xtra
embedded-graphics xtras
-
lm4f120
A set of drivers for writing bare-metal code for the Texas Instruments LM4F120
-
ruspiro-uart
convinient access API to the Raspberry Pi 3 UART0 (PL011) and UART1 (miniUART) peripherals
-
anachro-forth-core
A forth-inspired, bytecode-compiled scripting language for Anachro Powerbus
-
avr-boot
Self Programming functions for AVR MCUs
-
atsame51j
Peripheral access API for ATSAME51J microcontrollers (generated using svd2rust)
-
vorago-peb1
Board Support Crate for the Vorago PEB1 development board
-
axp192
A driver for the AXP192 power management IC
-
max116xx-10bit
Driver crate for the MAX116xx 10-bit ADC devices
-
utrace_parser
Instrumentation-based profiling library for embedded targets with async support
-
r3_port_riscv
RISC-V port for the R3-OS original kernel
-
tm4c123x
Peripheral access API for TI TM4C123x microcontrollers
-
nuttx-embedded-hal
Rust Embedded HAL for Apache NuttX RTOS
-
nrf-softdevice
Rust interface to nRF SoftDevice
-
efm32pg-pac
Peripheral access API for EFM32PG MCU (generated using svd2rust)
-
ch32v0
Device support crates for CH32V0 devices
-
r3_port_arm
Armv7-A port for the R3-OS original kernel
-
hardware-registers
Generic, embedded-friendly hardware registers support, including traits and types for understanding I2C registers
-
itm
A decoding library for the ARM Cortex-M ITM/DWT packet protocol
-
max32660-pac
Peripheral access API for MAX 32660 microcontroller
-
tock/tock-cells
A secure embedded operating system for microcontrollers
-
mcp4x
Platform-agnostic Rust driver for the MCP4x digital potentiometers
-
canadensis_bxcan
Bridge between Canadensis and the BXCAN peripherals found in some microcontrollers
-
nrf52810-hal
HAL for nRF52810 microcontrollers
-
atsamd-usb-host
usb-host driver support for Atmel SAMD* microcontrollers
-
wasefire-interpreter
Wasefire WebAssembly interpreter
-
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
-
rdif-intc
Driver Interface of interrupt controller
-
tca9539
(also PCA9539) 16-Bit I2C I/O Expander with I2C Interface
-
tfmicro
Rust bindings of TensorFlow Lite for Microcontrollers
-
signalo_traits
A collection of traits used in 'signalo' umbrella crate
-
neokey_trinkey
Board Support crate for the Adafruit Neokey Trinkey
-
esp-idf-part
parsing and generating ESP-IDF partition tables
-
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
-
stm32f3-copterust
Device support crates for STM32F3 devices
-
drone-stm32-map-svd
STM32 SVD to bindings for Drone, an Embedded Operating System
-
embassy-net-enc28j60
embassy-net driver for the ENC28J60 ethernet chip
-
lm3s6965
Interrupt bindings for the LM3S6965 microcontroller
-
cortex-m-rt
Minimal runtime / startup for Cortex-M microcontrollers
-
cc13x2x7_cc26x2x7_pac
Peripheral Access Crate for TI's cc13x2x7/cc26x2x7 microcontroller family
-
bh1730fvc
no-std driver for the BH1730FVC ambient light sensor
-
atsame70j19b
Peripheral access API for the ATSAME70J19B MCU from Microchip (generated using svd2rust 0.30.3)
-
embassy-time-queue-utils
Timer queue driver trait for embassy-time
-
imxrt1062-dma0
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…
-
atsame53n
Peripheral access API for ATSAME53N microcontrollers (generated using svd2rust)
-
atsamd51g
Peripheral access API for ATSAMD51G microcontrollers (generated using svd2rust)
-
nrf52805-hal
HAL for nRF52805 microcontrollers
-
atsamd51p
Peripheral access API for ATSAMD51P microcontrollers (generated using svd2rust)
-
lpc55s6x-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
nrf5340-app-hal
HAL for nRF5340 app SoC
-
atsam4ls8c-pac
Peripheral access crate for the ATSAM4LS8C microcontroller
-
ruspiro-singleton
easy to use singleton pattern
-
ufmt-utils
μfmt
utilities -
rk3399-pac
Peripheral Access Crate (PAC) for the RK3399 SoC from Rockchip
-
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…
-
efm32jg1b-pac
Peripheral access API for EFM32JG1B MCU (generated using svd2rust)
-
riscv-peripheral
Interfaces for standard RISC-V peripherals
-
ch32v1
Device support crates for CH32V1 devices
-
riscv-semihosting
Semihosting for RISCV processors
-
stm32f7
Device support crates for STM32F7 devices
-
rdrive-macro-utils
A dyn driver manager
-
drogue-tls
TLS 1.3 client with no_std support and no allocator
-
opcua-certificate-creator
OPC UA certificate creator
-
kiibohd-usb
Kiibohd USB HID Interface
-
embedded-crc-macros
Macros implementing portable CRC calculation algorithms for use in no_std
-
fancp
Types and methods for parsing/ creating Fan Control Protocol messages
-
tm4c129x
Peripheral access API for TI TM4C129x microcontrollers
-
is25lp064a
An embedded-hal driver for the IS25LP064A
-
drone-stm32-map-periph-tim
STM32 peripheral mappings for Drone, an Embedded Operating System
-
cc13x4_cc26x4_pac
Peripheral Access Crate for TI's cc13x4/cc26x4 microcontroller family
-
ovl-atsamx7x-hal
HAL and peripheral access API for ATSAME70 microcontrollers
-
wasefire-protocol-usb
Wasefire USB protocol between platform and host
-
spi-flash
SPI flash memory interface crate
-
epd
Drivers for EPD(E-Paper Displays), WIP
-
drone-cortex-m
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
msp430fr2355
Peripheral access crate for MSP430FR2355 microcontroller
-
esp-ieee802154
Low-level IEEE 802.15.4 driver for the ESP32-C6 and ESP32-H2
-
cc2640r2_pac
Peripheral Access Crate for TI's cc2640r2 microcontroller family
-
mips-mcu-alloc
A heap allocator for MIPS based microcontrollers
-
ruspiro-gpio
This crates provides a GPIO peripheral abstraction of the Raspberry Pi
-
nrf52833-pac
Peripheral Access Crate for Nordic's nrf52833 microcontroller
-
gd32vf103-hal
Hardware abstract layer (HAL) for RISC-V microcontroller GD32VF103
-
embassy-boot-nrf
Bootloader lib for nRF chips
-
bern-arch
Bern RTOS hardware specific implementation
-
atsame51g
Peripheral access API for ATSAME51G microcontrollers (generated using svd2rust)
-
atsame53j
Peripheral access API for ATSAME53J microcontrollers (generated using svd2rust)
-
efm32jg12b-pac
Peripheral access API for EFM32JG12B MCU (generated using svd2rust)
-
atsam4ls2b-pac
Peripheral access crate for the ATSAM4LS2B microcontroller
-
msp430f249
Peripheral access API for MSP430F249 microcontroller
-
nrf52832-pac
Peripheral Access Crate for Nordic's nrf52832 microcontroller
-
hts221
Interface to ST Micro HTS221 humidity and temperature sensor
-
atsams70j21b
Peripheral access API for the ATSAMS70J21B MCU from Microchip (generated using svd2rust 0.30.3)
-
rdif-power
Driver Interface of interrupt controller
-
assign-resources
Macro to split up fields of a Peripherals struct into new structs
-
edc2svd
Convert register description from the EDC format to the SVD format
-
lora-e5-bsp
Board support package for the seeed LoRa-E5 development kit
-
imxrt1062-can1
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…
-
rp2040-monotonic
RTIC Monotonic implementation based on RP2040's Timer peripheral
-
metro_m0
Board Support crate for the Adafruit Metro M0
-
r3_kernel
The R3-OS original kernel
-
imxrt-uart-panic
Panic handler for i.MX RT that reports to UART
-
esp-metadata
Metadata for Espressif devices
-
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…
-
embassy-net-wiznet
embassy-net driver for WIZnet SPI Ethernet chips
-
arm-pl011-rs
PL011 UART driver
-
embassy-net-esp-hosted
embassy-net driver for ESP-Hosted
-
esp-riscv-rt
Minimal runtime / startup for RISC-V CPUs from Espressif
-
xuantie
Low level access to T-Head XuanTie RISC-V processors
-
ch32x0
Device support crates for CH32X0 devices
-
emcell-macro
A macro crate for emcell
-
stm32f3
Device support crates for STM32F3 devices
-
kll-core
KLL state-machine implementation focused on no_std embedded/bare-metal targets
-
scoped-mutex-traits
An abstraction over closure-based mutexes
-
riscv-target-parser
Parser for RISC-V target specifications
-
opcua-console-logging
Logging to the console for OPC UA used by client and server
-
nvme-driver
nvme driver
-
kiibohd-hall-effect
Analysis crate for intepreting hall-effect keyboard switches (e.g. Silo Switches)
-
atsamd51n
Peripheral access API for ATSAMD51N microcontrollers (generated using svd2rust)
-
percore
Safe per-CPU core mutable state on no_std platforms through exception masking
-
efm32pg23-pac
Peripheral access API for EFM32PG23 MCU (generated using svd2rust)
-
wasefire-applet-api
Low-level Wasefire applet API
-
erdnuss-comms
A small RS-485 comms protocol
-
canadensis_pnp_client
Client library for Cyphal plug-and-play node ID allocation
-
cortex-r-rt
Run-time support for Arm Cortex-R
-
arm-dcc
Debug Communication Channel (DCC) API
-
stm32l4-stm32hal
(Custom for stm32-hal) Device support crates for STM32L4 devices
-
embassy-net-driver
Driver trait for the
embassy-net
async TCP/IP network stack -
atsam4ls2c-pac
Peripheral access crate for the ATSAM4LS2C microcontroller
-
rdif-timer
Driver Interface of system timer
-
r3_support_rp2040
Supporting package for running R3-OS on RP2040
-
gd32vf103-pac
Peripheral access API for GD32VF103 chips
-
hifive1
Board support crate for HiFive1 and LoFive boards
-
bitbang-hal
Implements embedded-hal traits by bitbanging
-
lilos-list
Allocation-free intrusive doubly-linked wait queues for lilos
-
nrf52810-pac
Peripheral Access Crate for Nordic's nrf52810 microcontroller
-
gd32c1
Device support crate for GD32C1 devices
-
atsame70q21b
Peripheral access API for the ATSAME70Q21B MCU from Microchip (generated using svd2rust 0.30.3)
-
inverted-pin
Embedded-hal input/output pin trait implementations with inverted level logic
-
mlx9061x
Platform-agnostic Rust driver for the MLX90614 and MLX90615 non-contact infrared thermometers
-
tmp006
Platform-agnostic Rust driver for the TMP006/TMP006B non-contact infrared (IR) thermopile temperature sensor
-
atsame51n
Peripheral access API for ATSAME51N microcontrollers (generated using svd2rust)
-
msp432p401r-pac
MSP432P401R Peripheral Access API (PAC)
-
ssd1331
I2C/SPI driver for the SSD1331 OLED display controller
-
neo_trinkey
Board Support crate for the Adafruit Neo Trinkey
-
nrf9160-hal
HAL for nRF9160 system-in-package
-
mma8x5x
Platform-agnostic Rust driver for the MMA8451, MMA8452, MMA8453, MMA8652 and MMA8653 tri-axis accelerators
-
ch32v2
Device support crates for CH32V2 devices
-
cc13x0_pac
Peripheral Access Crate for TI's cc13x0 microcontroller
-
mcp49xx
Platform-agnostic Rust driver for the MCP49xx and MCP48xx digital-to-analog converters (DAC)
-
imxrt1062-snvs
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…
-
atsam4lc2c-pac
Peripheral access crate for the ATSAM4LC2C microcontroller
-
nrf-usbd
USB driver for nRF microcontrollers
-
tm4c-hal
Common bits of HAL for the TM4C123x/TM4C129x family of microcontrollers
-
ruspiro-interrupt
Providing a simple and convenient way to implement interrupt handler for Raspberry Pi interrupts
-
embassy-usb-driver
Driver trait for
embassy-usb
, an async USB device stack for embedded devices -
stm32f1xx-hal-bxcan
HAL for the STM32F1xx family of microcontrollers
-
nrf-softdevice-s140
Low-level bindings for the Nordic nRF SoftDevice S140
-
efm32pg22-pac
Peripheral access API for EFM32PG22 MCU (generated using svd2rust)
-
esp8266-hal
HAL for ESP8266 microcontrollers
-
feather_m0
Board Support crate for the Adafruit Feather M0
-
stm32f2
Device support crates for STM32F2 devices
-
imxrt1062-csi
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…
-
stm32wb-stm32hal
(Custom for stm32-hal) Device support crates for STM32WB devices
-
atsams70q19b
Peripheral access API for the ATSAMS70Q19B MCU from Microchip (generated using svd2rust 0.30.3)
-
kll-compiler
KLL (Keyboard Layout Language) Compiler - Rust Edition
-
drone-stm32-map-periph-dma
STM32 peripheral mappings for Drone, an Embedded Operating System
-
xtensa-lx
Low-level access to Xtensa LX processors and peripherals
-
ch32v3
Device support crates for CH32V3 devices
-
embassy-net-ppp
embassy-net driver for PPP over Serial
-
atsam4lc8b-pac
Peripheral access crate for the ATSAM4LC8B microcontroller
-
f3
Board Support Crate for the STM32F3DISCOVERY
-
ds1307
Platform-agnostic Rust driver for the DS1307 real-time clock
-
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…
-
esp-build
Build utilities for esp-hal
-
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…
-
nrf-softdevice-s112
Low-level bindings for the Nordic nRF SoftDevice S112
-
nrf52811-hal
HAL for nRF52811 microcontrollers
-
microbit-bsp
An embassy-based boards support package (BSP) for BBC Micro:bit v2
-
embedded-io-adapters
Adapters between the
embedded-io
traits and other I/O traits -
atsam4lc4a-pac
Peripheral access crate for the ATSAM4LC4A microcontroller
-
mutex-trait
Foundational mutex trait and helpers
-
metro_m4
Board Support crate for the Adafruit Metro M4
-
drone-stm32-map-periph-uart
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsams70n21b
Peripheral access API for the ATSAMS70N21B MCU from Microchip (generated using svd2rust 0.30.3)
-
stm32l1
Device support crates for STM32L1 devices
-
drone-stm32-map-periph-adc
STM32 peripheral mappings for Drone, an Embedded Operating System
-
nrf52805-pac
Peripheral Access Crate for Nordic's nrf52805 microcontroller
-
drone-stm32-map-periph-exti
STM32 peripheral mappings for Drone, an Embedded Operating System
-
embedded-update
Firmware updates for embedded devices supporting multiple update services
-
nrf52811-pac
Peripheral Access Crate for Nordic's nrf52811 microcontroller
-
wio_terminal
Board support crate for the Seeed Studio Wio Terminal
-
drone-svd
CMSIS-SVD parser for Drone, an Embedded Operating System
-
kiibohd-hid-io
HID-IO protocol implementation for the C kiibohd firmware
-
nrf-softdevice-s132
Low-level bindings for the Nordic nRF SoftDevice S132
-
esp32c6-lp
Peripheral access crate for the ESP32-C6's LP coprocessor
-
ch57x
Device support crates for CH57X devices
-
mips-mcu
Low level access to MIPS MCU cores
-
ruspiro-i2c
Raspberry Pi - I²C bus interface implementation
-
arduino_mkrvidor4000
Board Support crate for the Arduino MKR VIDOR 4000
-
st7567s
Driver for the ST7567S LCD controller
-
kiibohd-hall-effect-keyscanning
Hall Effect keyscanning for strobed matrices
-
atsam4ls4b-pac
Peripheral access crate for the ATSAM4LS4B microcontroller
-
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…
-
drone-ctypes
Platform-specific C types for Drone apps
-
imxrt1062-iomuxc-snvs
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…
-
arduino_mkr1000
Board Support crate for the Arduino MKR 1000 WiFi
-
drone-stm32-map-periph-i2c
STM32 peripheral mappings for Drone, an Embedded Operating System
-
stm32f0
Device support crates for STM32F0 devices
-
matrix_portal_m4
Board Support crate for the Matrix Portal M4
-
ruspiro-allocator
lightweight heap memory allocator for Raspberry Pi baremetal environments
-
atsams70n20b
Peripheral access API for the ATSAMS70N20B MCU from Microchip (generated using svd2rust 0.30.3)
-
feather_m4
Board Support crate for the Adafruit Feather M4
-
wio_lite_mg126
Board Support crate for the Wio Lite MG126
-
arduino_nano33iot
Board Support crate for the Arduino Nano 33 IOT
-
esp32s3-ulp
Peripheral access crate for the ESP32-S3's RISC-V ULP coprocessor
-
nrf-softdevice-s122
Low-level bindings for the Nordic nRF SoftDevice S122
-
atsam4ls4a-pac
Peripheral access crate for the ATSAM4LS4A microcontroller
-
ch59x
Device support crates for CH59X devices
-
kiibohd-keyscanning
Kiibohd gpio keyscanning module for momentary push button switches (keyboards)
-
ovl-atsame70q21b
Peripheral access API for ATSAME70Q21B microcontrollers from Atmel/Microchip (generated using svd2rust)
-
stm32wl
Device support crates for STM32WL devices
-
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…
-
si4703
Platform-agnostic Rust driver for the Si4703 and Si4702 FM radio turners (receivers)
-
atsame70q20b
Peripheral access API for the ATSAME70Q20B MCU from Microchip (generated using svd2rust 0.30.3)
-
max44009
Platform-agnostic Rust driver for the MAX44009 ambient light sensor
-
stm32l0
Device support crates for STM32L0 devices
-
tm4c123x-hal
HAL for the TM4C123x family of microcontrollers
-
arduino_mkrzero
Board Support crate for the Arduino MKRZERO
-
p1am_100
Board Support crate for the Facts Engineering P1AM-100
-
atsam4ls8b-pac
Peripheral access crate for the ATSAM4LS8B microcontroller
-
ruspiro-channel
Bare Metal Channel implementations for
no-std
environments, only requiring an allocator to be provided -
nrf-softdevice-s113
Low-level bindings for the Nordic nRF SoftDevice S113
-
nrf52832-hal
HAL for nRF52832 microcontrollers
-
stm32l5
Device support crates for STM32L5 devices
-
nrf5340-app-pac
Peripheral Access Crate for Nordic's nrf5340-app microcontroller
-
esp32s2-ulp
Peripheral access crate for the ESP32-S2's RISC-V ULP coprocessor
-
atsams70q20b
Peripheral access API for the ATSAMS70Q20B MCU from Microchip (generated using svd2rust 0.30.3)
-
is31fl3743b
Bare-metal no_std driver for the Lumissil IS31FL3743B
-
atsam4ls8a-pac
Peripheral access crate for the ATSAM4LS8A microcontroller
-
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…
-
veml6075
Platform-agnostic Rust driver for the VEML6075 UVA and UVB light sensor
-
embassy-boot-rp
Bootloader lib for RP2040 chips
-
kll-hid
USB HID enum mapping for kll-core
-
gd32f3x0-pac
Peripheral access API for GD32F3x0 chips (generated using svd2rust)
-
nrf5340-net-hal
HAL for nRF5340 net SoC
-
drone-stm32-map-pieces-4
STM32 peripheral mappings for Drone, an Embedded Operating System
-
esp32s3-hal
HAL for ESP32-S3 microcontrollers
-
veml6030
Platform-agnostic Rust driver for the VEML6030 and VEML7700 high-accuracy ambient light sensors
-
nrf5340-net-pac
Peripheral Access Crate for Nordic's nrf5340-net microcontroller
-
atsam4lc2a-pac
Peripheral access crate for the ATSAM4LC2A microcontroller
-
atsame70n19b
Peripheral access API for the ATSAME70N19B MCU from Microchip (generated using svd2rust 0.30.3)
-
ch56x
Device support crates for CH56X devices
-
circuit_playground_express
Board Support crate for the Adafruit Circuit Playground Express
-
nrf-softdevice-mbr
Low-level bindings for the MBR included in all Nordic nRF SoftDevices
-
nrf9120-pac
Peripheral Access Crate for Nordic's nrf9120 microcontroller
-
drone-config
Configuration for Drone, an Embedded Operating System
-
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…
-
drone-stm32-map-pieces
STM32 peripheral mappings for Drone, an Embedded Operating System
-
stm32mp1
Device support crates for STM32MP1 devices
-
qt_py_m0
Board Support crate for the Adafruit QT Py
-
tm4c129x-hal
HAL for the TM4C129x family of microcontrollers
-
esp32c3-hal
HAL for ESP32-C3 microcontrollers
-
stm32wb
Device support crates for STM32WB devices
-
bl702-pac
Embedded Rust's Peripheral Access Crate for BL702/BL704/BL706 RISC-V BLE + Zigbee microcontroller
-
drone-stm32-map-periph-rtc
STM32 peripheral mappings for Drone, an Embedded Operating System
-
pcf857x
Platform-agnostic Rust driver for the PCF8574, PCF8574A and PCF8575 I/O expanders
-
veml6040
Platform-agnostic Rust driver for the VEML6040 RGBW color light sensor
-
atsam4lc8a-pac
Peripheral access crate for the ATSAM4LC8A microcontroller
-
embassy-time-queue-driver
Timer queue driver trait for embassy-time
-
esp8266
Peripheral access crate for the ESP8266
-
nrf52820-pac
Peripheral Access Crate for Nordic's nrf52820 microcontroller
-
ch32l1
Device support crates for CH32L1 devices
-
esp32-hal
HAL for ESP32 microcontrollers
-
panic-itm
Log panic messages using the ITM (Instrumentation Trace Macrocell)
-
drone-stm32-map-periph-spi
STM32 peripheral mappings for Drone, an Embedded Operating System
-
gemma_m0
Board Support crate for the Adafruit Gemma M0
-
atsame70n20b
Peripheral access API for the ATSAME70N20B MCU from Microchip (generated using svd2rust 0.30.3)
-
atsam4lc2b-pac
Peripheral access crate for the ATSAM4LC2B microcontroller
-
kxcj9
Platform-agnostic Rust driver for the KXCJ9 ultra-low-power tri-axis accelerometer
-
esp32s2-hal
HAL for ESP32-S2 microcontrollers
-
imxrt1062-ccm
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…
-
d1-mini
A Board Support Package (BSP) which provides a type-safe API for the WEMOS/LOLIN D1 mini
-
panic-semihosting
Report panic messages to the host stderr using semihosting
-
stm32h5
Device support crates for STM32H5 devices
-
drone-stm32-map-pieces-10
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsams70q21b
Peripheral access API for the ATSAMS70Q21B MCU from Microchip (generated using svd2rust 0.30.3)
-
atsam4ls2a-pac
Peripheral access crate for the ATSAM4LS2A microcontroller
-
esp32c2-hal
HAL for ESP32-C2 microcontrollers
-
ch643
Device support crates for CH643 devices
-
tcs3400
Platform-agnostic Rust driver for the TCS3400 RGB color light to digital converter with IR filter
-
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…
-
itsybitsy_m4
Board Support crate for the Adafruit ItsyBitsy M4 Express
-
drone-stm32-map-pieces-6
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsam4lc4b-pac
Peripheral access crate for the ATSAM4LC4B microcontroller
-
atsams70j20b
Peripheral access API for the ATSAMS70J20B MCU from Microchip (generated using svd2rust 0.30.3)
-
atsam4lc4c-pac
Peripheral access crate for the ATSAM4LC4C microcontroller
-
trinket_m0
Board Support crate for the Adafruit Trinket M0
-
atsam4lc8c-pac
Peripheral access crate for the ATSAM4LC8C microcontroller
-
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…
-
atsam4e16e-pac
Peripheral access crate for ATSAM4E16E microcontrollers
-
atsame70n21b
Peripheral access API for the ATSAME70N21B MCU from Microchip (generated using svd2rust 0.30.3)
-
sodaq_sara_aff
Board Support crate for the Sodaq SARA AFF
-
drone
CLI utility for Drone, an Embedded Operating System
-
grand_central_m4
Board Support crate for the Adafruit Grand Central M4 Express
-
atsam4s16b-pac
Peripheral access crate for the ATSAM4S16B microcontroller
-
esp32c6-hal
HAL for ESP32-C6 microcontrollers
-
edgebadge
Board Support crate for the Adafruit EdgeBadge
-
atsamv70n20b
Peripheral access API for the ATSAMV70N20B MCU from Microchip (generated using svd2rust 0.30.3)
-
atsam4e8c-pac
Peripheral access crate for ATSAM4E8C microcontrollers
-
imxrt1062-iomuxc-gpr
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…