-
portable-atomic
Portable atomic types including support for 128-bit atomics, atomic float, etc
-
embedded-hal
A Hardware Abstraction Layer (HAL) for embedded systems
-
rhai
Embedded scripting for Rust
-
fixed
Fixed-point numbers
-
embedded-hal-mock
A collection of mocked devices that implement the embedded-hal traits
-
smoltcp
A TCP/IP stack designed for bare-metal, real-time systems without a heap
-
compiler_builtins
Compiler intrinsics used by the Rust compiler. Also available for other targets if necessary!
-
critical-section
Cross-platform critical section
-
redox_syscall
access raw Redox system calls
-
oorandom
A tiny, robust PRNG implementation
-
riscv
Low level access to RISC-V processors
-
nickel-lang-cli
The Nickel interpreter CLI
-
defmt
A highly efficient logging framework that targets resource-constrained devices, like microcontrollers
-
gdbstub
GDB Remote Serial Protocol in Rust
-
polkavm
A fast and secure RISC-V based virtual machine
-
semihosting
AArch64, Arm, RISC-V, MIPS32, MIPS64, and Xtensa
-
espflash
A command-line tool for flashing Espressif devices
-
embassy-sync
no-std, no-alloc synchronization primitives with async support
-
embedded-graphics
Embedded graphics library for small hardware displays
-
pc-keyboard
PS/2 keyboard interface library
-
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
-
microfft
Embedded-friendly Fast Fourier Transforms
-
northstar
container runtime for Linux targetting embedded systems
-
probe-rs
A collection of on chip debugging tools to communicate with microchips
-
arbitrary-int
Modern and lightweight implementation of u2, u3, u4, ..., u127
-
embedded-storage
A Storage Abstraction Layer for Embedded Systems
-
embedded-graphics-simulator
Embedded graphics simulator
-
tock-registers
Memory-Mapped I/O and register interface developed for Tock
-
rtthost
RTT (Real-Time Transfer) client
-
stm32-hal2
Hardware abstraction layer for the STM32 MCUs
-
rp2040-hal
Embedded-HAL impl for the rp2040 microcontroller
-
optimization_engine
A pure Rust framework for embedded nonconvex optimization. Ideal for robotics!
-
byte-slice-cast
Safely cast bytes slices from/to slices of built-in fundamental numeric types
-
aligned
A newtype with alignment of at least
A
bytes -
r-efi
UEFI Reference Specification Protocol Constants and Definitions
-
aarch64-cpu
Low level access to processors using the AArch64 execution state
-
flip-link
Flips the memory layout of embedded programs to protect against stack overflows
-
foreign-types
A framework for Rust wrappers over C APIs
-
eeprom24x
Platform-agnostic Rust driver for the 24x series serial EEPROMs
-
ux
Implement the following non standard integers: u2, u3, u4, u5, u6, u7, u9, u10, u11, u12, u13, u14, u15, u17, u18, u19, u20, u21, u22, u23, u24, u25, u26, u27, u28, u29, u30, u31, u33…
-
esp-backtrace
Bare-metal backtrace support for Espressif devices
-
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…
-
fugit
Time library for embedded targets with ease-of-use and performance first
-
linked_list_allocator
allocator usable for no_std systems. It builds a linked list from the freed blocks and thus needs no additional data structures.
-
rppal
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals
-
stm32-fmc
Hardware Abstraction Layer for STM32 Memory Controllers (FMC/FSMC)
-
uguid
GUID (Globally Unique Identifier) no_std library
-
wasmparser-nostd
event-driven library for parsing WebAssembly binary files
-
imxrt-iomuxc
Pad configuration interface for NXP i.MX RT processors. Part of the imxrt-rs project
-
managed
An interface for logically owning objects, whether or not heap allocation is available
-
yaxpeax-arm
arm decoders for the yaxpeax project
-
rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
stm32f4xx-hal
Peripheral access API for STM32F4 series microcontrollers
-
rtt-target
Target side implementation of the RTT (Real-Time Transfer) I/O protocol
-
ftdi-embedded-hal
embedded-hal implementation for FTDI USB devices
-
atomic
Generic Atomic<T> wrapper type
-
stm32h7xx-hal
Hardware Abstraction Layer implementation for STM32H7 series microcontrollers
-
avr-device
Register access crate for AVR microcontrollers
-
pinned-init
facilitate safe pinned initialization
-
miniconf
Serialize/deserialize/access reflection for trees
-
utralib
Xous UTRA (Unambiguous Thin Register Abstration) library generator
-
atat
AT Parser for serial based device crates
-
st-map
Runtime for a stack-alocated map
-
drmemd
Main process of the DrMem control system
-
psm
Portable Stack Manipulation: stack manipulation and introspection routines
-
risc0-zkvm-platform
RISC Zero zero-knowledge VM
-
stm32-eth
Embedded Rust Ethernet driver for the STM32 MCU series
-
pinenote_dbus_service
A DBus service for the Pine64 Pinenote
-
embassy-executor
async/await executor designed for embedded usage
-
embedded-nal
A Network Abstraction Layer (NAL) for Embedded Systems
-
ext4-view
No-std compatible Rust library for reading ext2/ext4 filesystems
-
smlang
A no-std state machine language DSL
-
embedded-text
TextBox for embedded-graphics
-
ravedude
easily flash code onto an AVR microcontroller with avrdude
-
imxrt-ral
Register access layer for all NXP i.MX RT microcontrollers
-
industrial-io
Linux Industrial I/O (IIO) Support
-
espup
installing and maintaining Espressif Rust ecosystem
-
rustc-std-workspace-alloc
integration of crates.io crates into rust-lang/rust standard library workspace
-
updatehub-package-schema
UpdateHub Packages metadata schemas
-
device-driver
A toolkit to write better device drivers, faster
-
nrf-modem
Async modem api for the nRF91xx
-
atsame54_xpro
Board Support crate for the SAM E54 Xplained Pro Evaluation Kit
-
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…
-
stak-device
Devices for Stak Scheme
-
embedded-nano-mesh
Lightweight mesh communication protocol for embedded devices
-
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
-
ostool
operating system development
-
virtio-bindings
Rust FFI bindings to virtio generated using bindgen
-
postcard-rpc
A no_std + serde compatible RPC library for Rust
-
aht20-driver
Rust embedded-hal driver for the AHT20 temperature and humidity sensor
-
statime
Precision Time Protocol implementation library for embedded and desktops
-
buddy_system_allocator
A bare metal allocator that uses buddy system
-
mustang
Rust programs written entirely in Rust
-
rustc-build-sysroot
Build a rustc sysroot with custom flags
-
nrf-hal-common
details of the nRF HAL crates. Don’t use this directly, use one of the specific HAL crates instead (
nrfXYZ-hal
). -
sbi-spec
Definitions and constants in the RISC-V Supervisor Binary Interface (RISC-V SBI)
-
delog
Deferred logging, an implementation and extension of Rust's standard logging facade
-
ufix
Flexible and usable generic fixed-point numeric type
-
edge-dhcp
Async +
no_std
+ no-alloc implementation of the DHCP protocol -
fstr
A stack-allocated fixed-length string type
-
uwheel
Embeddable Aggregate Management System for Streams and Queries
-
w5500
IoT Controller implementation
-
jep106
A pollable collection of all JEP106 manufacturer codes
-
libc_alloc
global allocator which hooks into libc's malloc/free
-
epd-waveshare
An embedded-hal based driver for ePaper displays from Waveshare formerly published as eink-waveshare-rs
-
safe-mmio
Types for safe MMIO device access, especially in systems with an MMU
-
psx
developing homebrew for the Sony PlayStation 1
-
embedded-devices
Device driver implementations for many embedded sensors and devices
-
atomic-maybe-uninit
Atomic operations on potentially uninitialized integers
-
rlsf
Real-time dynamic memory allocator based on the TLSF algorithm
-
spacepackets
Generic implementations for various CCSDS and ECSS packet standards
-
wlink
WCH-Link flash tool for WCH's RISC-V MCUs(CH32V, CH56X, CH57X, CH58X, CH59X, CH32L103, CH32X035, CH641, CH643)
-
pygamer
Board Support crate for the Adafruit PyGamer
-
dlt-core
Parser and writer for autosar DLT Diagnostic Log and Trace
-
cargo-hex-to-uf2
Cargo tool to convert hex to uf2 files
-
bme280
device driver for the Bosch BME280 temperature, humidity, and atmospheric pressure sensor and the Bosch BMP280 temperature, and atmospheric pressure sensor
-
svdtools
modifying bugs in CMSIS SVD
-
raki
RISC-V instruction decoder written in Rust
-
sbi
A pure-Rust library to interact with the RISC-V Supervisor Binary Interface
-
static_cell
Statically allocated, initialized at runtime cell
-
biquad
digital second order IIR filtrers, also known as biquads
-
flipperzero
Flipper Zero
-
esp-println
print!
andprintln!
implementations various Espressif devices -
efm32pg1b-pac
Peripheral access API for Silicon Labs EFM32PG1B microcontrollers
-
chirpstack_api
ChirpStack Protobuf / gRPC API definitions
-
idsp
DSP algorithms for embedded, mostly integer math
-
esp-hal
Bare-metal HAL for Espressif devices
-
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.
-
itm-parser
A command-line tool to parse and format ITM (Instrumentation Trace Macrocell) output for embedded systems development using probe-rs
-
edge-nal
Hosts a bunch of traits which are not yet available in the embedded-nal-async crate
-
inky-frame
Driver and protocol library for InkyFrame devices with peripheral support
-
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
-
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.
-
aarch64-paging
manipulate AArch64 VMSA page tables
-
dfu-core
Sans IO core library (traits and tools) for DFU
-
gd32f1x0-hal
HAL for the GD32F1x0 family of microcontrollers
-
embedded-sdmmc
A basic SD/MMC driver for Embedded Rust
-
svd2utra
SVD to UTRA library generator
-
cmsis-pack
managing CMSIS Packs
-
dcmimu
no_std DCM IMU implementation
-
embassy-futures
no-std, no-alloc utilities for working with futures
-
buoyant
SwiftUI-like UIs in Rust for embedded devices
-
littlefs2
Idiomatic Rust API for littlefs
-
embedded-test
A test harness and runner for embedded devices
-
droid-juicer
Extract firmware from Android vendor partitions
-
xmc4100
Cortex-M peripheral access library
-
timerfd
interface to the Linux kernel's timerfd API
-
port-expander
Abstraction for I2C port-expanders
-
rtsc
Real-time Synchronization Components
-
rustkey
— rust library for tillitis TKey application development
-
lis3dh-async
An embedded-hal-async driver for the LIS3DH accelerometer
-
hx711_spi
A platform agnostic driver to interface with the HX711 using SPI
-
esp32-nimble
A wrapper for the ESP32 NimBLE Bluetooth stack
-
windows_i686_gnu
Import lib for Windows
-
libspecr
standard library for specr lang
-
bluerobotics-ping
serves as the entry point for embedding applications using Rust on Blue Robotics's Ping devices family
-
waterman
A CLI tool to easily flash code onto AVR microcontrollers using avrdude, enhancing the development workflow for embedded Rust projects
-
ws2812-spi
SPI-based driver for ws2812 leds
-
minimq
A minimal MQTT5 client designed for no_std platforms
-
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.
-
esp-at-nal
Network layer client for ESP-AT modems
-
intuicio-core
Core module for Intuicio scripting platform
-
ohos-drawing-sys
Bindings to the
native_drawing
API of OpenHarmony OS -
map_vec
The Map and Set APIs backed by Vec
-
rhai-dylib
Dylib support for Rhai
-
moondancer
firmware for the Great Scott Gadgets Cynthion USB Test Instrument
-
m-bus-parser
parsing M-Bus frames
-
eerie
Rustic binding to the IREE Compiler/Runtime
-
lilos
A tiny embedded OS based around Futures and async
-
jelly-mem_access
Memory Mapped I/O access library
-
os-terminal
Beautiful terminal emulator on no-std environment
-
product-os-http
Product OS : Http is a derivative of the http crate restructured for both std and no_std environments
-
cargo-esp-new
A cargo-new extension for esp8266 chips
-
zfi
Zero-cost and safe interface to UEFI firmware
-
nmea0183
NMEA 0183 parser targetting mostly embedded devices but not limited to
-
st7565
Driver for ST7565 based displays
-
wai-bindgen-rust
Generate WAI glue for a Rust guest
-
sbat
UEFI Secure Boot Advanced Targeting (SBAT) no_std library
-
tiny-varint
A no_std compatible VarInt encoding/decoding Rust library
-
ushell
Embedded shell over serial connection
-
embive
A lightweight, recoverable sandbox for executing untrusted RISC-V code in constrained environments (ex.: microcontrollers)
-
hifmt
Format output without Rust code segment in binary to reduce the ultimate binary size
-
morse-codec
live decoding and encoding of morse code messages. Supports multiple embedded devices and operating systems by being no_std.
-
mcp2003a
LIN transceiver driver with embedded-hal traits for no-std environments
-
atsamx7x-hal
HAL and peripheral access API for ATSAME70, ATSAMS70, ATSAMV70, and ATSAMV71 microcontrollers
-
ina226-tp
Rust Driver for device INA226 High-Side or Low-Side Measurement, Bi-Direcional Current and Power Monitor
-
sgp30
Platform agnostic Rust driver for the Sensirion SGP30 gas sensor
-
py32f0xx-hal
Peripheral access API for py32F0 series microcontrollers
-
mlx90640-capture
Image capture utility for MLX90640 cameras
-
rusty_libimobiledevice
An ergonomic library to communicate with iOS devices
-
sysfs_gpio
access to GPIOs using the Linux sysfs interface
-
aligned-array
A newtype with alignment of at least
A
bytes -
nrf24-rs
Platform agnostic Rust driver for the nRF24L01 2.4 GHz transciever for wireless communication between embedded devices
-
iso7816
Types for ISO 7816
-
postcard-bindgen
generate bindings for the postcard binary format for other languages than Rust
-
embedded-aht20
Platform-agnostic Rust driver for the AHT20 temperature & humidity sensor
-
arm-gic
A driver for the Arm Generic Interrupt Controller version 2, 3 or 4
-
fdt
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
quadrature-decoder
Pure logic-level implementations of quadrature decoders with support for full-, half- an quad-stepping
-
mplusfonts
Parametrized bitmap font family for embedded-graphics
-
c2a-core
Core of Command Centric Architecture
-
loongArch64
loongArch64 support for Rust
-
tinyrand
Lightweight RNG specification and several ultrafast implementations in Rust
-
u8g2-fonts
A text renderer for embedded-graphics, based on U8g2
-
ltc681x
Client LTC681X battery monitoring family
-
cartesian
QOL macro that creates the cartesian product of multiple iterators
-
qhyccd-rs
bindings for the QHYCCD SDK. This crate provides a safe interface to the QHYCCD SDK for controlling QHYCCD cameras, filter wheels and focusers. The libqhyccd-sys crate provides the raw FFI bindings…
-
heretek
GDB TUI Dashboard for the understanding of vast knowledge
-
va108xx
PAC for the Vorago VA108xx family of microcontrollers
-
embedded-websocket
A lightweight websocket library for embedded systems (no_std)
-
subplotlib
functions and types for
subplot codegen
generated Rust based test suites. Relies onsubplotlib-derive
for associated macros. -
gt911
An embedded touchscreen driver for GT911
-
statig
Hierarchical state machines for designing event-driven systems
-
cortex-m
Low level access to Cortex-M processors
-
elf_loader
A pure-rust library for loading all ELF format files from both memory and files
-
flat_device_tree
A pure-Rust
#![no_std]
crate for parsing Flattened Devicetrees -
dht-pio
A DHT Implementation using PIO (Programmable Input/Output), tested on Rasberry Pi Pico
-
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
-
teensy4-bsp
Rust-based BSP for the Teensy 4. Part of the teensy4-rs project
-
mcp4728
Platform agnostic rust driver for the MCP4728 4-channel, 12-bit I2C DAC
-
windows_x86_64_gnullvm
Import lib for Windows
-
pir-motion-sensor
PIR motion sensors
-
embedded-huffman
A paginated, streaming library for Huffman coding on embedded
-
embedded-dht-rs
A driver for interfacing with DHT11, DHT20 (AHT20), DHT22 (AM2302) temperature and humidity sensors, designed for embedded systems
-
defmt-rtt
Transmit defmt log messages over the RTT (Real-Time Transfer) protocol
-
ws2812-esp32-rmt-driver
WS2812 driver using ESP32 RMT
-
fdt-parser
parsing FDT
-
svd-vector-gen
process Microcontroller SVD files(e.g. STM32) and generate vector tables and linker scripts.
-
google-baremetalsolution2-cli
A complete library to interact with baremetalsolution (protocol v2)
-
tritium_remote
connecting to remote Robots running TritiumOS
-
shared-mem-queue
Single-writer single-reader queues which can be used for inter-processor-communication in a shared memory region
-
machine-check-avr
formal verification of AVR microcontrollers by machine-check
-
embedded-canvas
Draw anything with ease on the Canvas before drawing it to your small hardware display
-
embedded-iconoir
1300+ icons for embedded-graphics, ported from the Iconoir icon pack
-
quectel-bg77
Driver for Quectel's BG77 and BG770 eMTC and NB-IoT Modems
-
profirust
PROFIBUS-DP compatible communication stack in pure Rust
-
rotary-encoder-hal
platform agnostic rotary encoder library using embedded_hal
-
usbd-dfu-rt
USB DFU run-time class
-
bitfields
Macro for generating flexible bitfields. Useful for low-level code (embedded or emulators).
-
bno055
Bosch Sensortec BNO055 9-axis IMU driver
-
autd3-link-soem
autd3 link using SOEM
-
molt-forked
Embeddable TCL interpreter for Rust applications (personal forked)
-
imxrt-hal
Hardware abstraction layer for NXP i.MX RT microcontrollers
-
hopter
A Rust-based embedded operating system designed to enable memory safe, memory efficient, reliable, and responsive applications
-
ServerLauncher
server launcher written in Rust
-
bit-cursor
A cursor that supports bit-level reads and writes
-
wartcl
A minimal embeddable Tcl-like language
-
kble-eb90
Virtual Harness Toolkit
-
bilge
Use bitsized types as if they were a feature of rust
-
dot15d4
IEEE 802.15.4 implementation in Rust
-
rpsp
small, but extensible platform support package for RP2040 devices
-
bgt60trxx
An async and no_std library for the XENSIV™ BGT60TRxx 60 GHz FMCW radar sensors from Infineon
-
embassy-nrf
Embassy Hardware Abstraction Layer (HAL) for nRF series microcontrollers
-
strain
A CPU stressing utility written in Rust
-
byte
A low-level, zero-copy and panic-free serializer and deserializer for binary
-
sen6x
no-std driver for the SEN6X sensor modules
-
codas
Compact and streamable data format that works anywhere--from web apps to robots
-
fdt-rs
A flattened device tree parser for embedded no-std environments
-
dac8568
platform agnostic library for the Texas Instruments DAC8568, DAC8168 and DAC7568
-
bitsutils
Bits viewer
-
py32-hal
HAL and Embassy support for the Py32 family of microcontrollers
-
fixed32
Fixed Point types
-
r2u2_core
R2U2: A stream-based runtime monitor in no_std
-
embedded-lora-rfm95
A
no-std
-compatible, opinionated driver for the RFM95 LoRa modem -
sht31
temperature and humidity sensor
-
json-lines
A no_std + serde compatible message library implementing JSON Lines
-
tinywasm
A tiny WebAssembly interpreter
-
pollex
Arm instruction manipulator
-
libscd
Rust drivers for various SCD devices such as scd30 and scd4x CO2 sensors
-
flaw
Control-law-inspired embedded signal filtering, no-std and no-alloc compatible
-
fuchsia-zircon-sys
Types for low-level Rust bindings for the Zircon kernel
-
ssd1306
I2C/SPI driver for the SSD1306 OLED display controller
-
vl53l0x
A platform agnostic driver to interface with the vl53l0x (time-to-flight sensor)
-
a653rs
Arinc653 abstraction library for hypervisor independent partition programming
-
elf2tab
Compiles from ELF to TAB (a Tock Application Bundle using the Tock Binary Format)
-
microjson
No frills JSON parsing without allocations
-
svd2rust
Generate Rust register maps (
struct
s) from SVD files -
cbqn
Embed BQN in Rust via CBQN FFI
-
arm-psci
Arm Power State Coordination Interface (PSCI) library
-
gc9a01-rs
SPI 4-wire driver for GC9A01 display controller
-
lpc55-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
fixed-slice-vec
FixedSliceVec
is a dynamic length Vec with runtime-determined maximum capacity backed by a slice -
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).
-
const-fnv1a-hash
A #![no_std] crate for performing FNV1A-16/32/64/128 hashing on Rust stable at compile time
-
rusty_list
A no_std compatible, intrusive doubly linked list implementation
-
swamp-compile
Main driver for the Swamp compiler, orchestrating bootstrapping, dependency loading, parsing, and semantic analysis phases
-
atsamd-hal
HAL and Peripheral access API for ATSAMD11, ATSAMD21, ATSAMD51, ATSAME51, ATSAME53 and ATSAME54 microcontrollers
-
dmx-rdm
communicating DMX512 (ANSI E1.11) and DMX-RDM (ANSI E1.20) over a RS485 bus by using interchangeable drivers
-
rttmon
RTT monitor for OpenOCD
-
containers-image-proxy
Interact with the github.com/containers/image library via skopeo
-
it8951
E-Paper driver
-
unarray
working with uninitialized arrays
-
pasts
Minimal and simpler alternative to the futures crate
-
stak-file
File system for Stak Scheme
-
uds-client
UDS client crate in Rust
-
esp-wifi
A WiFi, Bluetooth and ESP-NOW driver for use with Espressif chips and bare-metal Rust
-
sht4x
Sensirion SHT4x Driver for Embedded HAL
-
redox-scheme
writing Redox scheme daemons
-
postcard-dyn
Dynamic ser/de for postcard
-
usbd-midi
USB MIDI device class implementation for use with usb-device
-
realman
robot Rust SDK
-
bmi088
6DOF IMU driver for embedded hal
-
sgp40
Rust driver for the Sensirion SGP40 gas sensor
-
include_data
Include typed data directly in your executable
-
sx1262
A embedded-hal driver for the Semtech SX1261/2 sub-GHz radio transceiver
-
scpi
SCPI/IEEE488.2 parser library
-
j1939
SAE J1939 is a set of standards that define how ECUs communicate via the CAN bus in heavy-duty vehicles
-
singlevec
Vec-like container optimized for storing only a single item
-
no-std-net
Rust's std::net... without the 'std'.
-
nostd_structs
Datastructures and algorithms for nostd environments
-
dbc-codegen
CAN DBC code-gen for embedded Rust
-
is31fl3728-rs
Rust embedded driver for is31fl3728 - led-matrix controller
-
mcuvisa
lib used by self
-
w5500-hl
Driver for the Wiznet W5500 internet offload chip
-
drone-cortexm
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
accelerometer
Generic, embedded-friendly accelerometer support, including traits and types for taking readings from 2 or 3-axis accelerometers and tracking device orientations
-
stm32_i2s_v12x
Driver for I2S communication (using SPI peripherals) for some STM32 microcontrollers
-
nvme
driver
-
xdvdfs
interacting with XISO/XDVDFS images
-
zenoh-ros-type
Common Rust struct for ROS 2 messages used by Zenoh
-
libosdp
IEC 60839-11-5 OSDP (Open Supervised Device Protocol)
-
ringstack
A very simple circular buffered stack implementation
-
embedded-sdmmc-dev
A basic SD/MMC driver for Embedded Rust
-
at-commands
AT Commands builder and parser for Rust #![no_std]
-
oglo-cpu-asm
Official assembler implementation for Oglo CPU
-
dcf77_utils
DCF77 receiver for embedded platforms
-
microbit
Board support crate for the BBC Micro:bit V1
-
quadrature-encoder
Hardware-level implementations of drivers for incremental encoders with support for full-, half- an quad-stepping
-
ellie_core
Core modules for ellie
-
zngur-autozng
Generating Zngur zng files automatically for a Rust crate
-
deploy-temp-fringe
safe, lightweight userland context switches
-
atsamd21g
Peripheral access API for ATSAMD21G microcontrollers (generated using svd2rust)
-
mousefood
embedded-graphics backend for Ratatui
-
lorawan
structures and tools for reading and writing LoRaWAN messages from and to a slice of bytes
-
ili9341
A platform agnostic driver to interface with the ILI9341 (ald ILI9340C) TFT LCD display
-
piddiy
DIY custom PID controller toolkit
-
da14531-pac
Peripheral Access Crate (PAC) for DA14531
-
tatl
in-process alerting
-
yamos6502
MOS 6502 emulator
-
disarmv7
Decodes armv7 instructions in to a rust enum
-
is31fl3741
Driver for Lumissil Microsystem's IS31FL3741 IC
-
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.
-
avr-tester
Framework for testing AVR binaries
-
stm32h7
Device support crates for STM32H7 devices
-
atomic-shim
Atomic types for unsupported platforms
-
ohrs
a cli tool for ohos-rs
-
rt
A real-time operating system capable of full preemption
-
fixed_trigonometry
Fixed point numerical approimations to trigonometric functions
-
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).
-
derse
binary serialization protocol for Rust
-
agb_tracker_interop
interop between tracker plugins and agb itself. Designed for use with the agb library for the Game Boy Advance.
-
minitel
interaction library
-
krata-xenplatform
Xen platforms for krata
-
quick-flash
Flash centrally hosted firmware binaries with one command
-
stm32l0xx-hal
Peripheral access API for STM32L0 series microcontrollers
-
mcp2515
#![no_std]
library for interacting with MCP2515 CAN controller chips -
ug_max
Down-top left-right defined font. Seemly design for 5x5 display.
-
transient-asm
Toolchain for TransientAssembly. Includes a compiler and virtual machine.
-
compact_strings
A more compact but limited representation of a list of strings or bytestrings
-
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…
-
cs43l22-embedded
A cs43l22 DAC driver using embedded-hal
-
automotive
providing a variety of automotive related libraries, such as communicating with CAN interfaces and diagnostic APIs
-
reqwless
HTTP client for embedded devices
-
max6675-hal
An embedded-hal driver for the MAX6675 digital thermocouple converter
-
format_no_std
Bare metal formatting
-
ls013b7dh03
Sharp LCD driver for embedded-hal
-
timeslice
periodic time slice scheduler
-
ssd1681
Driver for the SSD1681 e-Paper display (EPD) controller, for use with embedded-hal
-
daisy
A board support package for the Electro-Smith Daisy Seed and Patch SM
-
libabort
A abort function that doesn't require the standard library
-
driver-interface
Sparreal OS kernel
-
gpiocdev-embedded-hal
embedded-hal wrappers around gpiocdev Requests
-
wasefire-applet-api-desc
Description of the Wasefire applet API
-
numlang
A compiler for an esolang that uses hexadecimal
-
typus_fugit
typenum
powered time library for the embedded ecosystem -
ibm437
font for uses with the embedded-graphics crate
-
avr-progmem
Progmem utilities for the AVR architectures
-
ndless
interacting with Ndless for the TI-Nspire
-
embedded-c-sdk-bind-hal
Embedded C SDK bind HAL
-
glyphr
A no_std, lightweight and simple font rasterizing library
-
faster-rs
Rust wrapper for FASTER by Microsoft Research
-
esp-ota
Easy OTA updates for ESP32 chips using only safe Rust. Transport agnostic.
-
embedded-nal-coap
A CoAP server and client implementation built on embedded-nal-async
-
weather-utils
Set of common and useful weather-related computations
-
epson
support for communicating with Epson brand thermal POS printers
-
lcd1602-driver
A LCD1602 driver
-
bitutils2
A package of tools for bit manipulations, including bit indexing, bitfields, and a variation of regular expressions for binary data
-
sim7020
driver for sim7020E NB IoT modem
-
android_system_properties
Minimal Android system properties wrapper
-
cc2538-pac
Peripheral access API for CC2538 System-on-Chip
-
mc-sst25
Microship SST25* flash memory series
-
stm32f3xx-hal
Peripheral access API for STM32F3 series microcontrollers
-
gpt_disk_io
GPT (GUID Partition Table) disk IO no_std library
-
linux-sysno
A list of system call numbers
-
rotary-encoder-embedded
A rotary-encoder library built with embedded-hal
-
rhai-fs
Filesystem package for Rhai
-
aligned-cmov
Fast constant-time conditional moves of aligned bytes
-
nrf24l01-commands
Register bitfields and commands for the nRF24L01+
-
esp-idf-svc
embedded-svc traits for ESP-IDF (Espressif's IoT Development Framework)
-
cpu-utils
Contains utility functions to work with CPU
-
fieldset
Struct to enum derivation
-
squid_ewe
A helper tool for squid that extracts CFG metadata from C code
-
embedded-timers
Softwaretimers and -delays (ms/us) based on a Clock implementation
-
risc0-build-kernel
RISC Zero tool for building kernels
-
iso15765-2
ISO-TP trait define
-
adafruit-seesaw
Platform-agnostic implementation for communicating with devices that run the Seesaw firmware
-
flatipc
Zerocopy IPC between Xous clients and servers
-
meshtastic
communicating with and configuring Meshtastic devices
-
emc2101
Platform-agnostic Rust driver for the EMC2101 temperature sensor and fan sensor/controler
-
structpack
Dynamic bit-field accessor
-
blake2ya
The BLAKE2 cryptographic hash and message authentication code
-
scd4x
Rust driver for the Sensirion SCD4x series. Carbon Dioxide / Temperature / Humidity sensors.
-
width_counters
Atomic counters with variable bit widths and customizable atomic ordering
-
uln2003
28BYJ-48 stepper motor with and ULN2003 Driver on any hardware implementing embedded_hal
-
data-streams
Extension traits for reading and writing data with streams
-
wpilib
FRC's WPILib written in Rust
-
rpk-common
RPK common fields between config tool and firmware builder
-
nourl
Url primitive for no_std environments
-
critical-once-cell
Thread-safe OnceCell and Lazy backed by critical section
-
binread
helping read structs from binary data using ✨macro magic✨
-
fh101rf
Driver crate for the FH101RF Wake-Up Radio
-
lilygo-epd47
driver for the LilyGo T5 4.7 inch E-Ink Display (HW-Version V2.3 / ESP32S3)
-
cutools
-
canadensis
A Cyphal implementation: Node types and re-exports from some other canadensis crates
-
ruspiro-lock
Providing Spinlock, Semaphore and mutual exclusive data access for cross core usage on Raspberry Pi
-
pmsa003i
Plantower PMSA003I Driver for Embedded HAL
-
bmm350
Platform agnostic Rust driver for the BMM350 Magnetometer
-
mcumgr-smp
smp protocol for microcontrollers in pure rust
-
embassy-stm32
Embassy Hardware Abstraction Layer (HAL) for ST STM32 series microcontrollers
-
stm32f4-staging
Device support crates for STM32F4 devices
-
gc9a01a_driver
Display Driver to Support for GC9A01A LCD 1.28 inch with embedded-graphics support
-
embedded_cotoutf8
COTO is a library that translates numerical primitives into readable ASCII UTF-8 arrays
-
lsrmod
lsmod written in rust and outputs into std and json
-
gpt-parser
GUID Partition Table (GPT) read-only parser. Endian aware and usable against no_std+alloc.
-
bbqueue
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
max7219
A platform agnostic driver to interface the MAX7219 (LED driver)
-
product-os-service-handler
Product OS : Service Handler is a full implementation of the Javascript feathers endpoint framework handling reads and writes to services in the same manner so that a Product OS server is compatible with FeathersJS
-
msf60_utils
MSF receiver for embedded platforms
-
playdate-rs
Safe Rust bindings for the Playdate SDK C-CPI
-
astarte-device-sdk
that provides communication and pairing primitives to an Astarte Cluster
-
pico-xs
Embedded-SDK for bare-metal development on the RP2040 Raspberry Pi Pico microcontroller
-
localtime
Minimal monotonic unix-time library
-
fallible_vec
Fallible allocation functions for the Rust standard library’s
Vec
type -
tnnl
tnnl gives you full control over whether and when your IoT devices should be reachable from the internet
-
labview-interop
Types and wrappers for interperating with LabVIEW when called as a library
-
rustsbi
Minimal RISC-V's SBI implementation library in Rust
-
flipperzero-alloc
Flipper Zero
-
simple-json-parser
No allocation JSON key value parser with comment support
-
force-send-sync
Unsafe wrappers to force Send and Sync
-
nrfxlib
Rust driver for the LTE stack on the Nordic nRF9160
-
edge-mdns
Async +
no_std
+ no-alloc implementation of an mDNS responder -
sdio-host
SD host protocol library
-
frclib-core
A collection of utilities to be used across the FRC in rust ecosystem
-
r3
R3-OS: Experimental static component-oriented RTOS for deeply embedded systems
-
aps490_pfpu2_mini
Control software for PFPU2 automated brain detection system
-
print-no-std
The
print
/eprint
macros for no_std Windows/Linux/UNIX/DOS apps -
cargo-embassy
Get up and running with Embassy in seconds
-
tinywake
A minimal, no_std-compatible waker implementation for Cortex-M async executors
-
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.
-
seeed-erpc
Driver crate for interacting with seeed-studio eRPC Wifi devices
-
defmt-test
A test harness for embedded devices
-
fast-trap
Provide a framework for bare-metal trap handling, aiming at ensuring performance while reusing code
-
memacc
Memory access functions
-
rt-thread
realtime
-
ns16550a
UART driver
-
hd44780-driver
HD44780 compliant displays with embedded-hal
-
eva-common
Commons for EVA ICS v4
-
femtopb
A no-std, no-alloc set of tools for protobuf encoding and decoding
-
ciborium-io
Simplified Read/Write traits for no_std usage
-
errno-dragonfly
Exposes errno functionality to stable Rust on DragonFlyBSD
-
bootimage
create a bootable OS image from a kernel binary
-
sfsm
Static state machine generator for no_std and embedded environments
-
dlopen-rs
A dynamic linker fully implemented in Rust
-
cmsis-cffi
Foreign Function Interface for cmsis-pack
-
rave_engine
Rave Engine for Unyt enabling embedded scripting for holochain-rust
-
mpr121-hal
MPR121 proximity capacitive touch sensor controller hal driver implementation
-
fringe
safe, lightweight userland context switches
-
json-crawler
Wrapper for serde_json that provides nicer errors when crawling through large json files
-
mmap-fixed
dealing with memory-mapped I/O This is a fork of a fork of the original rust-mmap with updated dependencies and a fix for the Windows version. This exists only because there are no other…
-
aoko
extension library
-
garnish_lang
Single library for re-exporting and documenting all Garnish core libraries
-
shtcx
Platform agnostic Rust driver for the Sensirion SHTCx series temperature/humidity sensors
-
neotron-romfs-lsfs
Dump a Neotron ROM-FS image
-
autd3-emulator
autd3 emulator for calculating sound field, emulation of firmware, etc
-
linear_curve_fit
A
no_std
and noalloc
library for linear curve coefficents calculation -
rockfile
Rockchip specific file parsers
-
esp32c3
Peripheral access crate for the ESP32-C3
-
zigzag-rs
A dependency-free ZigZag encoding/decoding library
-
motion
A bare metal physics engine
-
std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
simulink-rs
Simulink C to Rust library builder
-
northstar-nstar
Northstar is an container runtime for Linux targetting embedded systems
-
arm-ffa
Arm Firmware Framework for Arm A-profile support library
-
tauri-plugin-board
vending machine development board of kits for tauri, use kotlin
-
mcan
Unofficial MCAN Hardware Abstraction Layer
-
mcx-pac
Peripheral Access Crate for NXP MCX Series MCUs
-
trapframe
Handle Trap Frame across kernel and user space on multiple ISAs
-
stabilizer
Firmware for the Sinara Stabilizer board (STM32H743, Ethernet, PoE, 2 ADCs, 2 DACs)
-
lsm6dsox
Platform-agnostic embedded-hal driver for the ST LSM6DSOX iNEMO inertial module
-
assign-resources
Macro to split up fields of a Peripherals struct into new structs
-
advanced-pid
An advanced PID control library implemented in Rust
-
esp-hal-dhcp-server
DHCP server for embassy-net (main target is esp-hal)
-
lysogeny-broth
Substrate for cellular automata in Rust
-
rhai-rand
Random number package for Rhai
-
uwheel-stats
profiling utility for uwheel
-
smallnum
Compile-time size optimization for numeric primitives
-
u4
nibble (4-bit integer) library, with packed representations
-
nmea2000
An NMEA 2000 library
-
infrared
remote control library
-
minifs-extractor
CLI tool to extract files from a minifs binary
-
compressed_log
Log compression on the fly
-
ruduino
Reusable components for AVR microcontrollers
-
twincat
ADS tools
-
hooker
a helper for hooking functions in x64
-
shabi
(S)imple (H)ex (A)nd (B)inary (I)nspector - CLI Tool
-
zngur-cli
CLI of the Zngur, a Rust/C++ interoperability tool
-
embedded-jsonrpc
A JSON-RPC 2.0 server implementation for embedded systems
-
imxrt-rt
Startup and runtime support for i.MX RT processors
-
lists3
Light-weight CLI tool to create a file browser for S3 buckets provisioning bucket listing
-
strobe
Fast, low-memory, elementwise array expressions on the stack. Compatible with no-std (and no-alloc) environments.
-
bosch-bme680
A pure rust implementation for the BME680 environmental sensor
-
mimxrt685s-pac
Peripheral Access Crate for MIMXRT685s devices
-
corncobs
COBS encode/decode for Rust no_std targets
-
circ_buffer
A bare-metal fixed-size statically allocated ring-buffer with optional serde (De)-Serialization
-
mos-hardware
Hardware register tables and support functions for 8-bit retro computers like the Commodore 64, MEGA65 and others
-
dfplayer-async
embedded-hal-async driver for the DFPlayer mini MP3 module
-
buffered-io
Bufferering types for embedded-io
-
rp-binary-info
Code and types for creating Picotool compatible Binary Info metadata
-
recbox
audio recorder
-
parr
A C-like unknown-length array type
-
blendr
The hacker's BLE (bluetooth low energy) browser terminal app
-
piper-bot
A bot that reads messages from a named pipe and sends them to Discord
-
cc1101
A platform agnostic driver to interface with the CC1101 (Sub-1GHz RF Transceiver)
-
vs1053
SPI driver for for the generic VS1053 Breakout by VLSI Solution
-
st7920
SPI driver for the ST7920 LCD display controller
-
polyhal
interface for multiple platforms
-
embassy-time
Instant and Duration for embedded no-std systems, with async timer support
-
unchecked-std
some methods from the Rust standard library without some checks
-
bitpiece
bitfields for rust
-
async-opcua
OPC UA client and server API
-
world_magnetic_model
NOAA World Magnetic Model
-
heavy_duty_bools
working with heavy-duty boolean values
-
rhai-env
Environment package for Rhai
-
dot15d4-frame
Frame parsing and building for the dot15d4 crate
-
typst-embedded-package
Support to embed typst package to the binary
-
hcms-29xx
Platform agnostic driver for HCMS-29XX and HCMS-39XX display ICs
-
is31fl3743b-driver
Platform-agnostic Rust driver for the Lumissil IS31F13743B LED matrix controller
-
size-of-trait
determine the size of a future or trait impl at compile time
-
wavv
no_std library for parsing and creating wav files
-
a121-rs
Rust driver for the Acconeer A121 radar sensor
-
untyped-box
A heap allocation utility when the datatype is unknown
-
imxrt-boot-gen
Generate data structures for booting iMXRT processors
-
cloudabi
Low level interface to CloudABI. Contains all syscalls and related types.
-
sths34pf80
ST STHS34PF80 driver
-
macro-bits
performing macro-based bit manipulation
-
no_std_collections
Auxiliary structures and traits for using dynamically resizable arrays (Vectors) in flexible environments, supporting both std and no_std contexts
-
rtic-sync
Synchronization primitives for asynchronous contexts
-
xmc4700
XMC peripheral library for XMC4700 generated from SVD
-
sensorlog
A lightweight data logging service
-
moore-vhdl-syntax
The VHDL parser implementation of the moore compiler framework
-
aem10900
Driver crate for the AEM10900 Energy Harvester
-
hex-slice
Extends the std::fmt::*Hex traits to slices
-
grid-iter
Ideomatic Grid operations via Iterators
-
avrd
Device-specific constants and information for all AVR microcontrollers
-
avra-rs
Assembler for Microchip AVR Microcontroller family (similar to Atmel)
-
embedded-semver
Compact representation of semantic versions as an i32, u32 i64 or u64
-
no_std_strings
no_std version of crate fixedstr: strings of constant maximum size that can be copied and stack allocated
-
hadusos
Half-duplex session over serial
-
tlv-rs
A parser for SIMPLE TLVs
-
modality-trace-recorder-plugin
A Modality reflector plugin suite and ingest adapter library for Percepio's TraceRecorder data
-
at24cx
A rust-embedded async driver for the Atmel AT24Cx eeprom storage family
-
m24c64-driver
embedded-hal(-async) driver for the M24C64 I2C EEPROM
-
fans
structures common to controlling fans
-
cd74hc4067
A platform agnostic driver to interface with CD74HC4067
-
wasefire
High-level Wasefire applet API
-
w65c02s
Cycle-accurate, exhaustively tested simulator of W65C02S microprocessor
-
sonant
port of the Sonant 4K synth with streaming support
-
ssd1322_rs
A no-std async Rust driver for the SSD1322 OLED screen
-
scratchpad
Stack-like memory allocator with double-ended allocation support
-
const_array_map
A const-capable Map type backed by a static array
-
pac25
Device support crates for PAC25 devices
-
stm32mp25-rgmii-gtx-clock-delay
calibrate RGMII GTX clock delay on STM32MP2
-
kbot-pwrbrd
interfacing with the K-Bot power board over CAN
-
synctools
Synchronization tools for no_std
-
exo_task
A lightweight async task executor for bare metal (or any) systems
-
embedded-io
Embedded IO traits
-
zssh
Minimal SSH server for embedded applications
-
printf-compat
printf reimplemented in Rust
-
windows_i686_gnullvm
Import lib for Windows
-
pico-uf2
elf to uf2, Automatically restart to enter BootSLE
-
embedded-cli
CLI with autocompletion, help and history for embedded systems (like Arduino or STM32)
-
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
-
ubits
Bit fields and masks
-
machine-check
Formal verification tool for digital systems
-
bsec
Rust API to the Bosch BSEC library
-
wpa-ctrl
WPA controller interface
-
reversejp
reverse geocoding in Japan
-
moving_median
A no-std moving median filter
-
kbuild
This package help you to build rust kernel quickly and easily
-
mb2-wukong-expansion
Board crate for Elecfreaks Wukong Extension for the BBC micro:bit v2
-
wyrcan
The Container Bootloader
-
pop-os/popsicle
USB Flasher
-
cobs-rs
A minimal no-std library for doing Consistent Overhead Byte Stuffing
-
flanterm_bindings
flanterm bindings
-
rp2040-pac
A Peripheral Access Crate for the Raspberry Pi RP2040 SoC
-
cayenne_lpp
that implements the Cayenne Low Power Payload (LPP) format
-
nickel-lang-vector
Persistent vectors for Nickel
-
croftsoft
Re-export of com-croftsoft-* crates
-
rhai-url
Url package for Rhai
-
cirque-pinnacle
driver for working with Cirque Pinnacle Glidepoint touchpads on embedded systems
-
stm32-metapac
Peripheral Access Crate (PAC) for all STM32 chips, including metadata
-
weev
Small and embeddable no_std multiplexer
-
async_labjack
A pure rust, async interface to the LabJack T-series via Modbus TCP
-
perfect6502-sys
Bindings to perfect6502
-
linux-embedded-hal
embedded-hal
traits for Linux devices -
constvec
no heap vec in const expr
-
heartbeat-watchdog
A versatile heartbeat watchdog
-
ft5336
A platform agnostic driver for the FT5336 touch screen driver used on the STM32F746 Discovery board, built using the embedded-hal
-
mklinker
为对应架构生成链接脚本
-
lp586x
matrix LED driver (supports LP5860, LP5861, LP5862, LP5864, LP5868)
-
kaori-hsm
A performant hierarchical state machine library
-
intx
Defines new integer types with non-standard but fixed sizes
-
talrost
A mathematics library for embedded scientific computation
-
pac55xx-pac
Peripheral Access Crate (PAC) for PAC55XX
-
tcn75a
Embedded HAL driver for accessing TCN75A temperature sensors
-
wasm-testsuite
Generic test harness for WebAssembly Runtimes
-
mfrc522
A platform agnostic driver to interface the MFRC522 (RFID reader/writer)
-
sbi-rt
Runtime library for supervisors to call RISC-V Supervisor Binary Interface (RISC-V SBI)
-
eva-lsl
EVA ICS v4 local service launcher
-
resol-vbus
processing RESOL VBus data
-
systick-timer
64-bit SysTick timer for Cortex-M0
-
apa102-spi
Driver for writing to APA102 (DotStar) and SK9822 LEDs over SPI
-
probe-rs-tools
A collection of on chip debugging tools to communicate with microchips
-
mks-servo42
A no_std library for encoding commands to a mks_servo motor
-
ieee1275
Safe and easy-to-use wrapper for building OpenFirmware/IEEE1275 apps
-
entro-hash
Entro Hash is a 32-bit, non-cryptographic hashing algorithm
-
gptinfo
A CLI tool to analyze partition tables
-
hmac-drbg
Pure Rust implementation of Hmac DRBG
-
ufmt
A (6-40x) smaller, (2-9x) faster and panic-free alternative to
core::fmt
-
wincwifi
WINC1500 Wifi chip embedded driver
-
rmodem
XMODEM (and variants) implementation in no-std Rust
-
shared-mime-embedded
Embedded copy of FreeDesktop Shared MIME data
-
ti154
creating and parsing TI 15.4 UART packets
-
embedded-io-convert
Convert embedded-io-async types back to futures ones (nightly only)
-
embedded-storage-file
file and in-memory interface for embedded-storage and embedded-storage-async
-
linker-sections
Custom linker section memory initialization for no-std
-
cluConstData
Create and merge any persistent data at compile time
-
ft6x36
Rust driver for Ft6x36 touch screen
-
vtl-rs
Very Tiny Language (VTL) in Rust, inspired by the historical VTL-2 on Altair 680b and others
-
wchisp
A command-line implementation of WCHISPTool, for flashing ch32 MCUs
-
hpm-metapac
Peripheral Access Crate (PAC) for all HPM's MCU chips, including metadata
-
button-driver
Advanced button handling crate
-
keypad
Platform-agnostic driver for keypad matrix circuits
-
drmem-api
Traits and types used internally by the DrMem control system
-
freertos-sys2
Low-level bindings to FreeRTOS. User's responsibility to provide the FreeRTOS
-
rtic-monotonics
that provides implementations of the Monotonic trait from rtic-time
-
tmtc-c2a
A command and control system for C2A-based satellites
-
lpc82x-pac
Low-level register mappings for the NXP LPC82x series of ARM Cortex-M0+ microcontrollers
-
signalo
A DSP toolbox with focus on embedded environments
-
adxl345_driver2
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
uefi-graphics2
An embedded-graphics display driver for UEFI environments
-
i2c-character-display
Driver for HD44780-based character displays connected via a I2C adapter
-
quickbits
Fast bit manipulation routines for Rust's native integer types
-
option-block
A minimal utility Rust crate for small, fixed-size blocks of optional types
-
lateinit
Unsafe late-initialization for statics
-
bma423
Rust driver for Bma423 accelerometer
-
lora-modulation
A definition of LoRa modulation characteristics with minimal external dependencies
-
kobo
interacting with Kobo devices
-
cody-c
zerocopy codec for encoding and decoding data in no_std environments
-
tudelft-quadrupel
Hardware support library for the quadrupel drone project (embedded systems lab)
-
thread-register
obtaining and modifying thread register
-
static_mime
mime type that embeds data from the IANA directly
-
unflappable
A batteries-included embedded-hal InputPin debouncer
-
baryuxn
Uxn stack machine as a no_std library
-
unitscale
Facade crate for statically-scaled unit macros and traits
-
ism330dhcx
driver for ST ism330dhcx sensor
-
navigator-rs
serves as the entry point for embedding applications using Rust on Blue Robotics's Navigator
-
veneer
A very thin std-like library that doesn't depend on libc
-
pca9539
Abstraciton for PCA9539 I/O expander
-
umm-malloc
A global allocator implementation for embedded systems using the umm_malloc library
-
beetle_bits
A collection of bit-based types. Currently only u1 (1bit uint) and f3 (3bit float) are implemented
-
explicit-endian
Transparent traits to explicitely declare in-memory endianness for a virable or struct record
-
omni-exporter
An exporter built for resource-constrained systems
-
crankstart-sys
A barely functional, wildly incomplete and basically undocumented Rust crate whose aim is to let you write games for the Playdate handheld gaming system in Rust
-
memonitor
Query CPU and GPU memory information in a portable way
-
armv5te
Disassembles ARMv5TE instructions
-
bittersweet
Add more intentional predicates to bitwise calcs
-
tinydyn
A lightweight dynamic dispatch library
-
cargo-esp-build
A cargo-build extension for esp8266 chips
-
da14583-pac
Peripheral Access Crate (PAC) for DA14583
-
TBV-Rust-SDK
Rust SDK for the TBV application and CLI
-
hx711
A platform agnostic driver to interface with the HX711 (load cell amplifier and ADC)
-
ps-pint16
Packs integers into a u16 via variable precision
-
rtt-log
Log facade implementation for the Segger RTT protocol
-
py32f0
Device support crates for PY32F0 devices
-
stm32l0x1-hal
Peripheral access API for STM32L0x1 microcontrollers
-
wiringx
safe and Rusty bindings to the wiringX library
-
rf24ble-rs
A fake BLE implementation for the nRF24L01
-
saberrs
interfacing with Dimension Engineering's Sabertooth motor drivers
-
max7800x-hal
A Hardware Abstraction Layer for the MAX7800X microcontroller family
-
loreyawen
An encrypted connection for low-datarate networks by piggybacking on LoRaWANs link encryption
-
arch-ops
encode and decode instructions for several architectures
-
sx126x
A driver for the SX126X Family of LoRa modems
-
himpp
Hi3XXX MPP API for Rust bindings
-
edma
Embedded Database Management for All
-
rs_ws281x
Wrapper for ws281x library using bindgen to track upstream
-
asahi-bless
select active boot partition on ARM Macs
-
embedded-websocket-embedded-io
A fork of the embedded-websockets crate that uses embedded-io-async for async IO
-
dtb_parser
no std but alloc depended device tree blob parsing lib
-
stepgen
Stepper motor speed ramp generator
-
array_map
Map backed array for fixed size keys with O(1) performance
-
bare_metal_deque
BareMetalDeque is a deque implementation intended for no_std use
-
tmp117
Driver for the tmp117 using the embedded-hal
-
nand7400
An assembler library for the nand7400 computer, created by me during my internship at the WCL
-
no-error-type
Error type for no error
-
quectel-bg9x-eh-driver
Rust embedded-hal driver for the Quectel BG9X cellular modems
-
sdmmc-core
SD/MMC core data structures and algorithms
-
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
-
moon_script
Fast and simple scripting language based on Rust
-
input-linux-sys
Bindings for <linux/{u,}input.h>
-
profont
monospace font for use with the embedded-graphics crate
-
boppo
API for creating new activities
-
sjlj2
Safer, cheaper and more ergonomic setjmp/longjmp in Rust
-
tagged-box
Box that uses tagged pointers
-
interchange
Request/response mechanism for embedded development, using atomics
-
chashmap
Fast, concurrent hash maps with extensive API
-
microflow
A robust and efficient TinyML inference engine
-
dac8564
platform agnostic library for the Texas Instruments DAC8564
-
visa-sys
FFI bind to VISA(Virtual Instrument Software Architecture) library
-
metrics-exporter-scope
Metrics scope exporter
-
librobotcontrol-sys
Rust port of librobotcontrol
-
task-stream
a global task executor, run in
no_std
-
e-write-buffer
A no_std, const-generic,
core::fmt::Write
able buffer -
prusst
A convenient interface to the UIO kernel module for TI Programmable Real-time Units
-
embedded-heatshrink
port of the heatshrink library for data compression in embedded systems
-
esp-partition-table
Read/write ESP flash partition table
-
rs_sha3_224
rs_sha3_224
is a Rust implementation of the SHA3-224 cryptographic hash algorithm, part of the largerrs_shield
project. This package provides SHA3-224 hashing functionality in a standalone manner… -
quark
Types for manipulating numeric primitives at the bit level
-
orion_cfmt
Format output without Rust code segment in binary to reduce the ultimate binary size
-
il0373
Driver for the IL0373 e-Paper display (EPD) controller, for use with embedded-graphics
-
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…
-
embassy-net
Async TCP/IP network stack for embedded systems
-
cpclib-bndbuild
Amstrad CPC project builder. Biased towards basm, but can still work with any tool
-
embassy-stm32-plus
embassy-stm32 plus
-
mpu6050
Platform agnostic driver for MPU6050 6-axis IMU
-
stak-build
Build scripts for Stak Scheme
-
dma-api
Trait for DMA alloc and some collections
-
simink
是一个嵌入式全系统模拟器, 提供大量的板卡模拟. simink 支持 Windows, macOS and Linux
-
spo-rhai
Embedded scripting for Rust
-
va416xx
PAC for the Vorago VA416xx family of MCUs
-
squares
A Counter-RNG faster than Philox
-
stk8ba58
Driver for the Sensortek STK8BA58 3-axis MEMS Accelerometer
-
libmapper-rs
Rust bindings for libmapper
-
yaxpeax-msp430
msp430 decoders for the yaxpeax project
-
pack1
Byte array newtypes for different primitive types
-
sensirion-i2c
Common functionality for I2C based sensors from Sensirion
-
rpi-led-panel
Control LED matrices with a Raspberry Pi
-
ice40
An embedded-hal driver for configuration of ice40 FPGA devices
-
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.
-
ssd1675
Driver for the SSD1675 e-Paper display (EPD) controller, for use with embedded-hal
-
springql
Open-source stream processor for IoT devices and in-vehicle computers
-
lipstick
C
-
embedded-nrf24l01
A driver for NRF24L01(+) transceivers on embedded-hal platforms
-
lemurs-8080
An emulator for the Intel 8080 microprocessor
-
embedded-layout
Extend embedded-graphics with simple layout functions
-
vl53l1x-uld
source port of the ULD driver for the VL53L1X
-
epd-spectra
Driver for Spectra EPDs from Pervasive Displays Inc
-
ohms
Electrical units library for embedded targets
-
safe-libc
Safe wrappers around the
libc
crate -
riscv-decode
decoding RISC-V instructions
-
cycle-menu
no-std compatible library to create a menu that can be cycled through and shown with custom input/output
-
ygen-mc
Ygens machine code playground
-
atsame70q19b
Peripheral access API for the ATSAME70Q19B MCU from Microchip (generated using svd2rust 0.33.5)
-
ironplc-plc2x
Compiler front-end for ironplc
-
armagnac
ARM emulation library for simulating embedded systems
-
embedded-registers
Procedural macro for effortless definitions of registers in embedded device drivers
-
charlcd
charlcd.c Linux driver (HD44780 et al.)
-
ak09915_rs
interacting with the AK09915 magnetometer
-
xargo
The sysroot manager that lets you build and customize
std
-
atdf2svd
convert Atmel's ATDF files to SVD
-
mdio
Management Data Input/Output
-
rk_pin
converting Rockchip GPIO pin names to pin numbers and vice versa
-
element-ptr
A macro to make accessing elements through raw pointers easier
-
rp2040-multicore-per-cpu
Enable use of per-core static variables on rp2040
-
max11300
A rust-embedded driver for the MAX11300 ADC/DAC
-
rp2040-rom
Access to Raspberry Pi RP2040 ROM functions from Rust
-
clock_helper
facilitate clock management on STM32 microcontrollers
-
icm20948-async
Async driver for the ICM20948 (Imu+Mag) for no_std environments
-
blynk_io
Blynk.io streaming API integration in Rust
-
a7105
Rust embedded-hal driver for the A7105 2.4GHz FSK/GFSK Transceiver
-
zerocopy
makes zero-cost memory manipulation effortless. We write "unsafe" so you don't have to.
-
rpi-st7789v2-driver
Raspberry-Pi driver for the ST7789V2 TFT display controller (WaveShare 1.69" 240x280 LCD)
-
Rusty_CryptoAuthLib
A platform agnostic I2C driver for Microchip’s Crypto Authentication HW (i.e. secure element
ATECC608A
), written in pure Rust. -
hopter_conf_params
Hopter embedded operating system configuration parameters
-
memory-pager
Access memory using small fixed size buffers
-
x11nas
X11 library bindings for Rust, forked to be no_std
-
backflip
Help your Flipper Zero perform tricks!
-
pulau-rs
allocation-free union-find library for bare metal environments
-
nrf51-hal
HAL for nRF51 microcontrollers
-
metro_m0
Board Support crate for the Adafruit Metro M0
-
mk20d7
Peripheral access API for MK20D7 microcontrollers
-
time-key-stream-set
A time-keyed stream set
-
rumya-binding
Rumya programming language's binding for Rust
-
ad9912
1 GHz DDS SPI driver
-
hs-hackathon-car
Car control support crate for Helsing's Rust Nation hackathon
-
origen_metal
Bare metal APIs for the Origen SDK
-
scalpel-bin
binary modification tool, cut, stitch, replace, sign
-
rust-lcm-codec
Rust support for reading and writing the LCM data format
-
urap
Specification and library for the URAP protocol
-
crc8-rs
A heapless no-std library for doing 8-bit cyclic redundancy checks
-
virt-sys
Native bindings to the libvirt C library
-
alt-std
Alternative Lightweight Std library for making small executables and shared objects
-
analog-multiplexer
A platform agnostic driver for 4051 and 4067 series analog multiplexers targetting the Rust embedded-hal
-
register-machine-traits
Traits for register machines
-
osdemo
An example of combining various libraries for aarch64 OS development
-
joybus-pio
controller side of the joybus protocol for gamecube for the RP2040 chip via its PIO functionality
-
quartet
Nibble (quartet, u4) slices
-
svd-generator
Converts device information from flattened device tree into an SVD description
-
ratchjob-web-dist-wrap
ratch-job server's console front-end dist embed wrap project
-
qemu-fw-cfg
reading fw_cfg from QEMU
-
ht32f523x2
Peripheral access API for HT32F523x2 microcontrollers
-
probe-rs-target
Target description schema for probe-rs
-
ds1302
A platform agnostic driver to interface with the DS1302 real time clock-calendar
-
mcp2517
CAN controller
-
dfu-nusb
DFU using nusb and dfu-core
-
apcaccess
get data from apcupsd
-
ethercat-soem-ctx
Wrapper for the SOEM open-source EtherCAT master context
-
blinkt
Interface for the Pimoroni Blinkt!, and any similar APA102 or SK9822 LED strips or boards, on a Raspberry Pi
-
qsdr-benchmarks
Benchmarks for qsdr experimental high-performance SDR runtime
-
aarch64
specific functionality and registers
-
escpos-rust
Control esc/pos printers with rust update from escpos-rs
-
i2c-multiplexer
An I2C Multiplexer library that supports the PCA9546 and TCA9546A chips
-
hcs-12ss59t
Platform-agnostic embedded-hal driver for Samsung HCS-12SS59T VFD displays
-
musb
musb(Mentor USB) regs and
embassy-usb-driver
,usb-device
impl -
naked-function
Proc macro implementation of #[naked]
-
autd3-driver
AUTD3 driver
-
ohos-xcomponent-sys
OpenHarmony's xcomponent binding for rust
-
is31fl3729
Driver for Lumissil Microsystem's IS31FL3729 IC
-
riscv_sys_monitor
A system monitor for RISC-V SBCs on Linux
-
usecop
Rust no_std implementation of the Sample Environment Control Protocol
-
ethercat-plc
Tools to build a PLC like program using the ethercat crate
-
embedded-mbedtls
no_std Rust wrapper for Mbed TLS
-
w5500-mqtt
MQTT client for the Wiznet W5500 internet offload chip
-
z80
z80 emulator
-
trenchcoat
JavaScript-ish virtual machine for embedded, LEDs, hot code reload, etc
-
ms5803-14ba
embedded-hal async and async driver for the MS5803-14BA pressure sensor
-
libertyos_kernel
The kernel for LibertyOS
-
bobbin-bits
Small bit fields and ranged integers
-
catnip
No-std, panic-never, heapless UDP/IP ethernet stack for data acquisition and real-time controls
-
tixml2svd
that converts Texas-Instruments device descriptions to standard SVD files
-
ledger_device_ui_sdk
Ledger devices abstractions for displaying text, icons, menus and other common gadgets to the screen
-
w5500-ll
Low level driver for the Wiznet W5500 internet offload chip
-
ds4432
Platform-agnostic Rust driver for the Maxim DS4432 Dual-Channel, I2C, 7-Bit Sink/Source Current Digital To Analog (DAC) converter
-
tlq
Tiny Little Queue
-
nanoval
A nan-tagged value for representing f64, i32, u32, booleans, null and arbitrary pointers
-
can
A general purpose library for common CAN types
-
rv8803
RTC clock driver for the rv8803 chip via I2C
-
small-fsm
Finite State Machine for Rust
-
local_static
Local static variable
-
debouncing
Debounce keys in an embedded context
-
embassy-usb
Async USB device stack for embedded devices in Rust
-
flem-serial-rs
A serial port implementation of the FLEM protocol for host computers running Windows, Linux, or MacOS
-
ieee802154
Partial implementation of the IEEE 802.15.4 standard for low-rate wireless personal area networks
-
rquickjs-extension
An extension system for rquickjs
-
micropb
Rust Protobuf library targetting embedded systems and no_std environments
-
afe4404
driver for Rust embedded-hal
-
encdec-base
encdec simple encoder/decoder base types and traits
-
disasm6502
6502 disassembler, complete with a working example
-
ws2812-flexio
A neopixel driver based on NXP i.MX RT's FlexIO bus
-
usb-descriptor-decoder
A no-std extensible USB Descriptor Decoder, support organize Descriptors as tree structure
-
discrete_count
Encapsulate counting for clocks, ab-encoders, etc
-
arm-gic-driver
A driver for the Arm Generic Interrupt Controller version 1-4
-
aw2013
Driver for the AW2013 3-Channel LED Controller
-
cbor-smol
Streamlined serde serializer/deserializer for CBOR
-
merkle-cbt-lean
Special implementation of Complete Merkle Binary Tree for minimal memory footprint
-
embedded-platform
Holistic embedded device support in a batteries-included manner
-
drs-0x01
Easily communicate with Dongbu Robot servomotors Herkulex DRS 0101 and DRS 0201
-
lcd1602rgb-rs
Native Rust driver for the waveshare LCD1602-RGB display module
-
k1921vk035-pac
The peripheral access crate for k1921vk035
-
embedded-executor
Embedded systems-friendly
Futures
executor -
koto_color
A Koto library containing simple color utilities
-
lp5018
no_std driver for the lp5018 i2c LED driver
-
pybadge-high
High Level Board Support crate for the Adafruit pybadge
-
eventlog-rs
Rust Parsing tool for TCG EventLog
-
pac22
Device support crates for PAC22 devices
-
gpt_disk_types
GPT (GUID Partition Table) disk data types no_std library
-
wasefire-error
Wasefire API errors
-
rpk-config
RPK configuration tool
-
libmosquitto-sys
Unsafe FFI bindings to libmosquitto
-
adi-adxl355
An embedded-hal driver for the ADXL355 accelerometer
-
goolog
no_std-compatible goolog logger and some macros to simplify printing logs
-
s7-sys
Rust bindings to s7 Scheme C API
-
helgoboss-midi
Interfaces, data structures and utilities for dealing with MIDI messages according to the MIDI 1.0 specification
-
pwm-pca9685
Platform-agnostic Rust driver for the PCA9685 I2C 16-channel, 12-bit PWM/Servo/LED controller
-
device-register
A
no_std
library to describe the registers permissions of a device to ease driver development -
max31865
generic driver for the MAX31865 RTD to Digital converter
-
resurgence
A VM backend designed to be embedded in an application
-
va108xx-hal
HAL for the Vorago VA108xx family of microcontrollers
-
treadmill-rs
Common type- and API-definitions for the Treadmill distributed hardware testbed
-
go-types
The type checker of the Goscript project
-
ssd1309
display-interface
compatible driver for the SSD1309 OLED display controller -
bmpe280
An I2C driver for the Bosch BMP280/BME280 barometer , thermometer
-
vex-libunwind
Idiomatic Rust bindings for LLVM libunwind on VEX V5 robots
-
cichlid
A color math library for programming addressable LEDs
-
seestr
pointer-wide nul-terminated strings with ownership semantics
-
nb
Minimal non-blocking I/O layer
-
neobridge-rust
Lets you control neopixels from your PC using a board
-
kble-dump
Virtual Harness Toolkit
-
onecable
1-Wire protocol
-
usbd-ethernet
Communication Device Class Network Control Model (CDC-NCM) class for usb-device
-
sac-base
Base crate of the sac-signal and sac-control crates
-
bbq2
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
tfmt
A tiny, fast and panic-free alternative to
core::fmt
-
libcoap-rs
An idiomatic wrapper around the libcoap CoAP library for Rust
-
tdc1000
no_std driver for the TDC1000 Ultrasonic Sensing Analog Front End
-
bitmap-font
Bitmap fonts for the embedded-graphics crate that don't require generics
-
embedded-vintage-fonts
Vintage fonts from embedded-graphics 0.6 back release 0.7
-
aarch64_sysreg
Address translation of system registers
-
bq34z100
embedded_hal driver for the fuel gauge series bq34z100
-
ic-mu
Magnetic Off-Axis Absolute Position Encoder driver
-
bool32
32-bit bool-ish type
-
bobbin-cli
A command line tool for automating your embedded development workflow
-
fixed-sqrt
Square root for fixed-point numbers
-
ruspiro-arch-aarch64
access to Aarch64 system registers as well as specific usefull aarch64 assembly instructions
-
zg-co2
ZyAura CO₂ sensor protocol implementation
-
microscpi
creating SCPI interfaces
-
wasefire-store
Key-value store for SLC flash storage
-
mini-backtrace
Backtrace support for no_std and embedded programs
-
enocean
serial protocol implementation
-
socketcan
Linux SocketCAN library. Send and receive CAN frames via CANbus on Linux.
-
stm32f1-staging
Device support crates for STM32F1 devices
-
itla
ITLA (micro laser) non-blocking control library using embedded-hal
-
intuicio-framework-pointer
Raw pointer framework module for Intuicio scripting platform
-
switch-hal
HAL and basic implementations for input and output switches (buttons, switches, leds, transistors)
-
hex-to-uf2
convert hex to uf2
-
lc3-codec
LC3 audio codec for embedded systems (no_std)
-
opcua
OPC UA client and server API
-
pa-spl
A no-std embedded-hal I2C driver for the PCB Artists SPL module
-
nickel-lang-git
Git utility functions for internal use in the Nickel configuration language
-
embedded-io-extras
Additional utilities for embedded-io, including a Cursor type for no_std environments
-
arm-targets
Compile-time feature detection for Arm processors
-
caller_line
Get the line from which the current function was called
-
ltr303
Platform agnostic Rust driver for the LTR-303 Ambient Light Sensor
-
gaia-ccsds-c2a
A command and control system for C2A-based satellites
-
mcp23017
driver for the MCP23017 (16-Bit I2C I/O Expander with Serial Interface)
-
tlsf
Two-Level Segregated Fit (TLSF) allocator with optimized memory footprint
-
uboot-shell
communicating with u-boot
-
ourobuf
A no_std circular buffer with constant-time operations
-
odd_is_odd
A very (not) safe library to check if a number is odd. Based on cve-rs.
-
usbd-hid-descriptors
Low-level, wire-format enums/bitfields used in HID descriptors
-
qdhex
helper functions to create hex dumps
-
nstd_collections
NSTD collections crate
-
stemma_soil_moisture_sensor
A pure generic I2C crate for the Adafruit STEMMA soil moisture sensor
-
ft6x06
A platform agnostic driver for the FT6x06 type touch panel controller used on STM32F4 series board
-
ens160-aq
ScioSense ENS160 driver
-
eeric
An easily embeddable RV64I core with MFDV extensions
-
pio-uart
A software UART implementation for the RP2040 using the PIO feature
-
lamm
functional paradigm programming language which uses Polish notation
-
stak-minifier
Stak Scheme source code minifier
-
bitregions
Generate a unit structure to represent a set of bit-regions
-
dht20-rs
A
no_std
Rust driver for the DHT20 temperature and humidity sensor -
memfault-ssf
Supporting crate for the Memfault memfaultd embedded Linux agent
-
max78000-pac
A Peripheral Access Crate for the MAX78000 microcontroller
-
esp-csi-rs
ESP CSI Driver for Rust
-
ladybug
A small library for triggering a logic analyzer from program events
-
odrive_can
A no_std driver for ODrive compatible motor controllers over CAN
-
hadris-fat
working with FAT32 file systems, a standalone crate included in the hadris project
-
esp-idf-unda
Embedded neural network forward feeding for precompiled models created by the unda crate
-
megadrive-sys
Bindings to the Sega Mega Drive (Genesis) hardware
-
embedded-nal-tcpextensions
Extensions to embedded-nal's TCP parts around the more precise use of the stack's buffers
-
fp
Fast & safe fixed-point arithmetic via compile-time checks
-
wasm32-unknown-unknown-openbsd-libc-wctypes-fix
The parts of OpenBSD libc that make sense on wasm32-unknown-unknown
-
aya-ebpf-cty
Type aliases to C types like c_int for use with bindgen
-
fdcan
STM32 FDCAN peripheral driver
-
vedirect_rs
Parse Victron VE.Direct serial output to a well-formed struct
-
xous-api-log
Log server API
-
shared-bus
Abstraction for sharing a bus between multiple devices
-
garnish_lang_runtime
Runtime and execution library for Garnish Lang
-
panic-persist
Persist panic messages in the targets' RAM
-
plic
Provide structs and methods to operate riscv plic device
-
ra8835a
/ SED1335 display driver
-
canadensis_data_types
Automatically generated types for all Cyphal public regulated data types
-
levarint64
Little-Endian VARiable-length INTeger codec, compatible with no_std
-
unsize
A stable alternative to CoerceUnsize
-
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… -
embedded-runtime
A tiny async runtime for embedded devices
-
mimxrt633s-pac
Peripheral Access Crate for MIMXRT633s devices
-
aw-fel
dealing with Allwinner devices in FEL mode, in pure Rust
-
vl53l1x-simple
driver for the VL53l1X TOF ranging sensor
-
hss-tty-flasher
TTY Flasher for PolarFire SoC with HSS bootloader
-
flip-ui
Rust integration for handling and compiling the UI built via the UI Flip UI Builder
-
equilibrium
A framework for creating distributed control systems
-
ruspiro-register
definitions to conviniently work with register field values that are typically presented by a set of bit fields
-
mlx9064x
interfacing with Melexis MLX9064* thermal cameras
-
ufloat
Wrappers around floating point numbers with ufmt trait implementations
-
wings_host
WASM plugin system for Geese
-
adxl345_driver
Driver for Analog Device ADXL345/ADXL346 3-Axis Digital Accelerometer
-
sancov
Rust bindings to LLVM’s
SanitizerCoverage
interface -
car-nostd
car files for no_std
-
nan-tag
NaN-tagged pointers in Rust, storing an f64 in the same space as a pointer
-
dns-protocol-patch
A DNS protocol implementation in Rust
-
mqttrust
MQTT Client
-
swiftnav-sys
FFI bindings for libswiftnav
-
embassy-rp
Embassy Hardware Abstraction Layer (HAL) for the Raspberry Pi RP2040 microcontroller
-
rtforth
Forth implemented in Rust for realtime application
-
monitor_cli
Command line tool to sync monitor resources and execute file defined procedures
-
fixed-array
Fixed-size array
-
embedded-display-controller
Traits for display controllers
-
panic-probe
Panic handler that exits
probe-run
with an error code -
mips-rt
Minimal runtime for MIPS MCU cores
-
rkaiq
Rockchip RKAIQ bindings for Rust
-
entro-sort
Entro Sort is an in-place, linearithmic, unstable sorting algorithm
-
cpclib-basm
z80 assembler relying on cpclib-asm
-
rs-streams
minimal stream library (no dependency on std)
-
lcd-ili9341-spi
Embedded_hal driver for ILI9341 SPI LCD, compatible with Waveshare 2,4 inch board
-
esp-bsp
Rust Bare Metal Board Support Packages for ESP32 related boards with focus on Embassy Async
-
thumb2-stack-size
estimates stack space requirements of thumb2 programs
-
i2cdev
API for safe access to Linux i2c device interface
-
arm7tdmi_aeabi
proc-macro to put aeabi functions into your code
-
ender
An encoding library to work with any binary data format
-
async-io-mini
Async I/O fork for embedded systems
-
ellie_tokenizer
Tokenizer for ellie language
-
stak-interpret
Stak Scheme bytecode interpreter
-
smoltcp_null_modem
smoltcp null modem drivers
-
memac
A custom memory allocator using slab and buddy allocators
-
timeywimey
Quick and dirty RTC differential measurement tool
-
cloudmqtt
A pure Rust MQTT client and server library
-
sds011-rs
A driver for the SDS011 particle sensor based on embedded-io
-
seasick
FFI-safe nul-terminated strings with ownership semantics
-
virtual-fan
Virtual fan driver for simulation and testing
-
rm1masm
MICRO-1 micro assembler written in Rust
-
pcf8563
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
apple-nvram
parse and write apple-formatted nvram entries
-
kasimir-sys
Small helper crate for communication with HS100 smart wifi plugs and similar devices
-
xmc4500
XMC peripheral library for XMC4500 generated from SVD
-
jtag-taps
interacting with individual TAPs on a JTAG scan chain
-
ember_os
OS kernel implemented in rust, which has referenced https://os.phil-opp.com/
-
embedded-multi-page-hmi
Multi page HMI targetting embedded devices with a few of buttons input and a constrainted display
-
northstar-sextant
Northstar is an container runtime for Linux targetting embedded systems
-
isla-axiomatic
Isla is a symbolic execution engine for Sail instruction set architecture specifications. This crate implements utilities for handling axiomatic memory models.
-
ndef
#[no_std]
library to implement a NFC Data Exchange Format structures -
cargo-dfu
cargo extension for flashing embedded rust programs via dfu
-
s32k144
Peripheral access API for NXP S32K144 microcontrollers (generated using svd2rust)
-
stdworld
signal-safe std replacement
-
embedded-runtime-rp2040
A tiny async runtime for embedded devices, with predefined runtime hooks for the rp2040
-
aht10-embedded
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor, tested on Rasberry Pi Pico
-
modio-logger
Dbus service
-
negicon-protocol
Definitions and utility functions for the Negicon v3 communication protocol
-
domain-lookup-tree
A tree structure in Rust optimized for looking up domain names, with wildcard support
-
embedded-time
Fully defined, inter-operable, ergonomic, and fast human-time units (both duration and rate types) with hardware timer abstraction and software timers
-
pinetime-mynewt
Mynewt Bindings for PineTime Smart Watch
-
gba_env
detecting the environment for GameBoy Advance ROMs (GBA/NDS/mGBA/VBA/gpSP/etc)
-
lib6502
An experimental 6502 emulation library
-
lcd
Hitachi HD44780-compatible LCD screen support for embedded development
-
smart-leds
device drivers
-
cs4272
Rust I2S driver for the CS4272
-
himpi-sys
Hi35XX MPI API for Rust unsafe bindings
-
lfsr
Galois linear feedback shift registers
-
async-debounce
Debounce using embedded-hal and embedded-hal-async traits and embassy-time
-
esp32
Peripheral access crate for the ESP32
-
multi-mono-font
Multi mono font mixed typesetting for embedded-graphics
-
embedded-graphics-unicodefonts
Monospaced embedded-graphics fonts with more glyphs
-
pdf417
No-std PDF417 encoder
-
edge-nal-embassy
edge-nal based on
embassy-net
-
l3l4kit
convert l3 packets to l4 data and vice versa
-
flash-algorithm
write CMSIS-DAP flash algorithms for flashing embedded targets
-
alarmo
convenient API to bootstrap firmware and access peripherals on the Nintendo Alarmo
-
pca9535
PCA 9535 IO-Expander driver using embedded-hal
-
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
-
cyclen
userland linux programming without libc
-
pac194x
Platform-agnostic Rust driver for the PAC194x 9V, 16-bit power monitor with alerts
-
hackflight
flight-control software for makers in Rust
-
wtflip
A language in a Rust macro... or something.
-
sbus-rs
A no_std compatible SBUS protocol parser for embedded systems
-
memprint
A way to print memory layout of a struct
-
zeitstempel
A timestamp you can serialize, and it might include suspend time
-
ds323x
Platform-agnostic Rust driver for the DS3231, DS3232 and DS3234 extremely accurate real-time clocks (RTC)
-
rpi_ws281x-sys
Bindings to rpi_ws281x C library
-
terebinth
Lightweight, compiled programming language
-
st7735-lcd-doublebuffering
Double-Buffered ST7735 TFT LCD driver with embedded-graphics support
-
drive_74hc595
Drive for IC 74HC595 Shift Register
-
st7789
TFT LCD driver with embedded-graphics support
-
spwm_generator
cli tool for genrate SPWM lookup tables
-
rs-max31865
Generic driver for the MAX31865 RTD to Digital converter
-
epicinium_keycode
A small utility crate for generating lossy unique ids encoded with base32
-
vgastream-rs
High level VGA(0xB8000) library in freestanding Rust
-
device-driver-generation
Code generation for the
device-driver
crate -
jvs-packets
that provide structures for JVS protocols
-
da14580-pac
Peripheral Access Crate (PAC) for DA14580
-
hdc302x-async
An embedded-hal-async driver for the HDC302x(-Q1) low-power humidity and temperature digital sensor
-
jrk-g2
embedded driver for pololu Jrk G2
-
trace-recorder-parser
parse Percepio's TraceRecorder data
-
authenticode
working with Authenticode (no-std)
-
microasync
Very small async runner
-
mimxrt600-fcb
Flash Configuration Block for MIMXRT600 devices
-
spicat
Full-duplex SPI transactions from the command line
-
hf2-cli
CLI for Microsoft HID Flashing Library for UF2 Bootloaders
-
esp32s3
Peripheral access crate for the ESP32-S3
-
empm
A convenient and fast embedded package manager
-
xous-api-susres
Manager of suspend/resume operations
-
endian-type-rs
Type safe wrappers for types with a defined byte order
-
sen5x-rs
embedded-hal driver for the sen5x environmental sensor node for HVAC and air quality applications
-
ws2811-spi
SPI-based driver for ws2811 chips
-
libiio-sys
Native, unsafe, bindings to the Linux libiio library. Used by industrial-io.
-
pm1006
Platform-agnostic Rust driver for the pm1006 particulate matter sensor
-
ogc-rs
wrapper library for devkitPro's libogc
-
rp_sandbox_c
Testing project -- please ignore
-
rs_shield
comprehensive Rust library providing robust and efficient implementations of cryptographic hash functions including SHA and Keccak families, and HMAC, suitable for no_std environments…
-
ape-fatfs
versitile FAT library for embedded systems
-
go-vm
The vm of the Goscript project
-
fring
Lightweight, no_std, and *fast* ring buffer
-
ldproxy
A linker proxy tool
-
aw9523b
A general driver for AW9523B which is 16 bit gpio explander & led driver
-
veml7700
Platform-agnostic Rust driver for the VEML7700 High Accuracy Ambient Light Sensor
-
py32csdk-hal-sys
PY32 HAL bindings
-
embedded-simple-ui
UI elements (LED, hw switch, etc.) with implementations on top of embedded-hal and embedded-time crates
-
lsm303agr
Platform-agnostic Rust driver for the LSM303AGR ultra-compact high-performance eCompass module: ultra-low-power 3D accelerometer and 3D magnetometer
-
a121-sys
Raw bindings to the A121 radar sensor C SDK
-
a653rs-linux
a653rs partition library for a653rs-linux hypervisor
-
txmodems
various MODEM file transfer protocols
-
esb-ng
Nordic's Enhanced ShockBurst communication protocol
-
ellie_vm
Ellie VM for running Ellie ByteCode
-
jetson_gpio
port of NVIDIA's Python library for controlling GPIO pins on select Jetson devices
-
stepper
Universal Stepper Motor Interface
-
wm8960
Register map and embedded-hal based driver for Wolfson WM8960 Audio Codec
-
ufmt_float
A rough implementation of a writer for f32 and f64 for ufmt
-
mcp9808
Platform agnostic Rust driver for the Microchip MCP9808 temperature sensor
-
moto-sys
Motor OS system crate
-
urpc
uRPC (pronounced micro RPC) is a simple and lightweight RPC framework designed with embedded systems in mind
-
foundation-arena
Heapless arena allocator
-
thermostat-eem
Firmware for the Sinara Thermostat-EEM temperature controller
-
tudelft-arm-qemu-runner
The runner code for the TU Delft Software Systems course
-
bern-kernel
Preemptive real-time kernel for microcontrollers
-
gopro-controller
Open source Rust Library for interacting with GoPro Cameras over BLE and WiFi
-
lcd_parallel_bus
A driver for various liquid crystal displays driven by HD44780 or equivalent, including double controller like 40x4 displays
-
one-fpga
One FPGA general traits and types
-
mutex-traits
An abstraction over closure-based mutexes
-
enc424j600
Embbeded Rust Ethernet driver for ENC424J600 Ethernet controller with SPI interface
-
robotiq-rs
interfacing Robotiq Gripper
-
gdeh0154d67
Driver for the GDEH0154D67 E-Paper display
-
pt-rtd
Calculation of resistance and temperature for platinum type RTDs, e.g. PT100.
-
stm32g0xx-hal
Peripheral access API for STM32G0 series microcontrollers
-
simple6502
A dead-simple MOS 6502 emulator, no std or allocator needed, no dependencies
-
booster
Firmware for the Sinara Booster device (STM32F4, Ethernet, RF power amplifiers)
-
embedded-sensors
Sensors in one place, with only one feature away
-
avr-oxide
An extremely simple Rusty operating system for AVR microcontrollers
-
zigbee2mqtt_types_vendor_gledopto
Struct definitions for zigbee2mqtt json messages
-
pid-ctrl
A flexible PID controller
-
lcd1602-diver
A driver for the LCD1602 display using the PCF8574 I2C bus
-
iowarrior-embedded-hal
that provides access to the IOWarrior GPIO, I2C, PWM, SPI and ADC peripherals
-
modbus_buffer
Circular buffer implementation tailored for Modbus communication in no_std environments
-
lp50xx
platform agnostic library for the Texas Instruments LP50XX led driver
-
ink_ir
data structures and algorithms for ink! intermediate representation
-
quad-compat-rhai
Embedded scripting for Rust
-
rs-melsec
MELSEC Communication library for communicating with Mitsubishi PLCs
-
cty
Type aliases to C types like c_int for use with bindgen
-
fixed-queue
no_std, no_alloc, use [T; N]. support
Vec
/VecDeque
/History
-
dac_lib_mcp4725
A driver for the MCP4725 DAC module
-
mm32f3270-pac
Peripheral Access Crate for MindMotion's mm32f3270 microcontroller
-
PY32f030xx-pac
Peripheral Access Crate for Puya's PY32f030xx microcontroller
-
avr-libcore
Minified version of libcore for AVR
-
spi-memory-async
A generic driver for different SPI Flash and EEPROM chips
-
bno080
AHRS driver
-
fullhouse
statically-allocated deque
-
backlash
processor for signal conditioning
-
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
-
order-maintenance
Totally-ordered priorities for the order maintainence problem
-
apyee
yeelight api
-
binks
scripting language
-
arducam-legacy
Driver for Arducam legacy cameras based on embedded-hal
-
embuild
A build support library for embedded Rust
-
scall
Friendlier raw system calls for Rust
-
bounced
Debouncing and Testing for Signals and Buttons
-
choreographer
A color pattern sequencer, intended for groups of RGB LEDs
-
arrform
String formatting without memory allocator
-
uart8250
provide a struct with many methods to operate uart 8250
-
aht10-async
A platform agnostic driver to interface with the AHT10 temperature/humidity sensor
-
diff-in-place
A no_std, zero-copy, in-place diff trait for constant sized arrays
-
dht-sensor
Driver for the DHT11/DHT22 sensor based on embedded-hal
-
rtlsdr
Rust bindings for librtlsdr
-
ffi-convert
A collection of utilities to ease conversion between Rust and C-compatible data structures
-
arm_gicv2
ARM Generic Interrupt Controller version 2 (GICv2) register definitions and basic operations
-
PY32m030xx-pac
Peripheral Access Crate for Puya's PY32m030xx microcontroller
-
PY32f002xxx-pac
Peripheral Access Crate for Puya's PY32f002xxx microcontroller
-
PY32c670xx-pac
Peripheral Access Crate for Puya's PY32c670xx microcontroller
-
PY32c610xx-pac
Peripheral Access Crate for Puya's PY32c610xx microcontroller
-
PY32f040xx-pac
Peripheral Access Crate for Puya's PY32f040xx microcontroller
-
PY32f071cxx-pac
Peripheral Access Crate for Puya's PY32f071cxx microcontroller
-
PY32f071xx-pac
Peripheral Access Crate for Puya's PY32f071xx microcontroller
-
PY32f303xx-pac
Peripheral Access Crate for Puya's PY32f303xx microcontroller
-
PY32L020xx-pac
Peripheral Access Crate for Puya's PY32L020xx microcontroller
-
PY32c611xx-pac
Peripheral Access Crate for Puya's PY32c611xx microcontroller
-
PY32f001xx-pac
Peripheral Access Crate for Puya's PY32f001xx microcontroller
-
PY32f003xx-pac
Peripheral Access Crate for Puya's PY32f003xx microcontroller
-
PY32T020xx-pac
Peripheral Access Crate for Puya's PY32T020xx microcontroller
-
PY32f072cxx-pac
Peripheral Access Crate for Puya's PY32f072cxx microcontroller
-
PY32f002axx-pac
Peripheral Access Crate for Puya's PY32f002axx microcontroller
-
PY32f040cxx-pac
Peripheral Access Crate for Puya's PY32f040cxx microcontroller
-
PY32f403xx-pac
Peripheral Access Crate for Puya's PY32f403xx microcontroller
-
PY32m070xx-pac
Peripheral Access Crate for Puya's PY32m070xx microcontroller
-
rt-watchdog
Real-time userspace watchdog for Rust
-
PY32c641xx-pac
Peripheral Access Crate for Puya's PY32c641xx microcontroller
-
PY32c640xx-pac
Peripheral Access Crate for Puya's PY32c640xx microcontroller
-
PY32m010xx-pac
Peripheral Access Crate for Puya's PY32m010xx microcontroller
-
jtag-adi
interacting with ARM Debug Interface components
-
imxrt-dcd
Device Configuration Data (DCD) generator for i.MX RT1060 series firmware images
-
bare-metal
Abstractions common to bare metal systems
-
cic-fixed
CIC filter implementation for fixed point numbers
-
canadensis_filter_config
Automatic receive filter configuration for Cyphal
-
rvv-encode
encode RISC-V V extension (rvv) instructions
-
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 ``#… -
ramlink
RAM-based, producer-consumer, one-way communication for microcontrollers, using a ring buffer
-
can-bit-timings
procedural macro to calculate CAN bus timings
-
embedded-threadsafe
safe global or thread-local cells for embedded devices
-
ft6236
embedded-hal driver for the FT6236/FT6206/FT6236U touch controller
-
stm32f469i-disc
Board support crate for the STM32F469 DISCOVERY kit
-
embedded-ccs811
Platform-agnostic Rust driver for the CCS811 ultra-low power digital gas sensor for monitoring indoor air quality
-
rocket_static_fs
static file server for the rocket framework
-
retro-display
Embedded display drivers for retro computers
-
ciborium
serde implementation of CBOR using ciborium-basic
-
c99
C99 types for easier interop
-
lora-phy
A LoRa physical layer implementation enabling utilization of a range of MCU/LoRa board combinations within embedded frameworks supporting embedded-hal-async
-
pi_timer
Irrevocable timer
-
honeycomb
A portable parser combinator library that does not require a runtime
-
blimp
Terminal based status page for embedded devices
-
bq40z50
Rust driver for Texas Instrument BQ40Z50 battery manager
-
data-view
data view for reading and writing data in a byte array
-
lcd_1602_i2c
I2C character LCD displays that use the AiP31068L chip with embedded-hal
-
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
-
simple-fatfs
A simple-to-use FAT filesystem library for Rust (mainly targeted at embedded systems)
-
forsyde-io-core
Core component of the Rust ForSyDe IO supporting library
-
l0g
Opinionated l0gging facade meant for the no_std libraries
-
lis2dtw12
no_std library for the LIS2DTW12 dual motion and temperature sensor using embedded-hal traits
-
sega-controller
Embedded driver for reading Sega controller input
-
robo6502
A cycle-accurate 6502 emulator
-
is31fl3193
I2C driver for the IS31FL3193 RGB LED driver
-
pas-co2-rs
Inofficial Rust driver for Infineon PAS CO2 sensor
-
apu_pcengines_hal
A safe wrapper around the direct memory interface of the APU2+ hardware
-
good-os-framework
operating system framework for framekernel written in Rust
-
nobcd
BCD number primitive for no_std environments
-
bm1397-protocol
Rust protocol driver for the BM1397 Bitcoin Mining ASIC
-
embedded-hal-sync-pins
embedded-hal pin implementations that can be shared between threads
-
pca9548a
I2C-Expander driver using embedded-hal
-
bad64-sys
Rust bindings for Binja's arm64 disassembler
-
mctp
Management Component Transport Protocol (MCTP) base types and traits
-
persistent-buff
A buffer that stays persistent in ram between boots
-
dcc-stream
Poll the ARM debug communications channel over JTAG
-
byte-arena
no_std, no_alloc arena for allocating byte buffers
-
w7500x-pac
Peripheral Access Crate for Wiznet's W7500x microcontrollers
-
atsame70j20
Peripheral access API for ATSAME70J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70j19
Peripheral access API for ATSAMV70J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71n19
Peripheral access API for ATSAMV71N19 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)
-
atsamv71j20
Peripheral access API for ATSAMV71J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71n20
Peripheral access API for ATSAMV71N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70j21
Peripheral access API for ATSAME70J21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71q20
Peripheral access API for ATSAMV71Q20 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)
-
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)
-
atsamv70q19
Peripheral access API for ATSAMV70Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70j20
Peripheral access API for ATSAMV70J20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70j19
Peripheral access API for ATSAME70J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70q20
Peripheral access API for ATSAMV70Q20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70n20
Peripheral access API for ATSAME70N20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
unid
Automate device security provisioning with edge intelligence
-
atsam3n4a
Peripheral access API for ATSAM3N4A microcontrollers (generated using svd2rust)
-
tmc5072
A TCM5072 driver compatible with
embedded-hal
-
atsam3n00a
Peripheral access API for ATSAM3N00A microcontrollers (generated using svd2rust)
-
atsam3n2a
Peripheral access API for ATSAM3N2A microcontrollers (generated using svd2rust)
-
atsam3n2b
Peripheral access API for ATSAM3N2B microcontrollers (generated using svd2rust)
-
atsam3n0a
Peripheral access API for ATSAM3N0A microcontrollers (generated using svd2rust)
-
atsam3n1a
Peripheral access API for ATSAM3N1A microcontrollers (generated using svd2rust)
-
ubench
stopgap rust benchmarking solution for microcontrollers
-
atsam3n0b
Peripheral access API for ATSAM3N0B microcontrollers (generated using svd2rust)
-
atsam3n1b
Peripheral access API for ATSAM3N1B microcontrollers (generated using svd2rust)
-
srex
managing SRecord files
-
interrupt
-
p256-cortex-m4-sys
Low-level bindings to P256-Cortex-M4
-
stackdump-core
stack dump definitions
-
platform-millis
generic trait of milliseconds counter for embedded-nano-mesh crate
-
atsam3n00b
Peripheral access API for ATSAM3N00B microcontrollers (generated using svd2rust)
-
ostd-pod
A marker trait for plain old data (POD)
-
svisual
Base Rust structures and traits for SVisual client
-
msr-core
Industrial Automation Toolbox - Common core components
-
atsam3n4b
Peripheral access API for ATSAM3N4B microcontrollers (generated using svd2rust)
-
coap-lite
A lightweight CoAP message manipulation crate, ideal for embedded environments
-
awrite
awrite!(): the async write!()/format!() scratch buffer
-
embedded-error
Universal error kinds for embedded systems
-
tictactoe-llem
Probably? efficient tictactoe(no heap, modificable size) game backend/frontend cli, can be used for gui or idk
-
on-off-sequence-output
Sends a sequence of on/off states to a GPIO Pin
-
scd30pi
Interfaces the SCD30 i2c CO2, temperature and humidity sensor from Sensirion for Raspberry Pi
-
lis3dh-spi
no_std driver for the ultra-low-power high-performance 3-axis "nano" accelerometer LIS3DH using SPI
-
spl06-007
Driver for the SPL06-007 barometric pressure sensor
-
max7219-async
Async driver for the MAX7219
-
dht-embedded
reading temperature and humidity from the DHT11 and DHT22 sensors
-
bitty_write_macro
A drop-in
write!
replacement that optimizes non-formatting writes for code size -
yaxpeax-6502
6502 decoder implementing yaxpeax-arch traits
-
overlay
trait for reinterpreting a slice of bytes as an arbitrary type
-
bitfield-register
Rust bitfield library for low-level registers
-
bmp280-driver
A platform agnostic driver to interface with the BMP280 pressure sensor
-
rust-guile-client-example
a small example program demonstrating how to use rust-guile
-
layout-lib
view the data layout of a struct
-
ruwren-sys
Low-level bindings to Wren programming language. Not affiliated with the main team for Wren.
-
embassy-net-tuntap
embassy-net driver for Linux TUN/TAP interfaces
-
smbus-request-parser
Parse SMBus requests. Register functions to call for each type of write/read request. Agnostic regarding polling, irq, dma usage.
-
ma734
Platform agnostic Rust driver for the MA734, digital angle sensor that detects the absolute angular position of a permanent magnet
-
krab
minimalistic interpreted programming language written in Rust
-
msoffice_pptx
pptx file format deserializer
-
ape-table-trig
implementations of sin, cos, and tan using precalculated tables
-
mimxrt500-bootstub
Glue code to make cortex-m-rt work with NXP i.MX RT500 series chips when booting from FlexSPI NOR flash
-
armv7
Low level routines for the armv7 instruction set with VMSA
-
noted
creating ELF notes
-
a800xl-utils
misc utilities for mos-a800xl-none target (Atari 800XL/XE)
-
ft-hal-generic
Traits and generic implementations of a rusty Hardware Abstraction Layer (HAL) for fischertechnik-compatible controllers
-
rt-xenomai
xenomai
-
mt9v034-i2c
mt9v034 image sensor two-wire programming driver
-
freertos-sys
Builds FreeRTOS from source for specific device families and provides easy linking
-
l3gd20-registers
A typed map of the STMicroelectronics L3GD20 Gyroscope registers
-
defmt-ringbuf
defmt persistent ring buffer logger
-
hxcadaptor
Bindings for libhxcfe https://github.com/jfdelnero/HxCFloppyEmulator/. Unfinished work, contributions are welcomed.
-
swap-n
an n argument extension to std::mem::swap
-
rumio
Control your MMIO and CPU registers without pain
-
bcm2835-lpa
Peripheral access crate for BCM2835 found in the Raspberry Pi 1 and Zero
-
aws-greengrass-nucleus
aws greengrass nucleus in Rust (unofficial)
-
overlay_macro
A proc-macro for implementing Overlay, to reinterpret a slice of bytes as a bit/byte packed struct
-
slice-string
A String backed by a slice
-
hrs3300
Platform-agnostic Rust driver for the HRS3300 heart rate sensor/monitor
-
platform-serial
generic trait of generic serial interface for embedded-nano-mesh crate
-
standard-pid
Standard PID implementation in Rust for serious embedded projects
-
atsamv71q19
Peripheral access API for ATSAMV71Q19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71j19
Peripheral access API for ATSAMV71J19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsame70q20
Peripheral access API for ATSAME70Q20 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv71j21
Peripheral access API for ATSAMV71J21 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
atsamv70n19
Peripheral access API for ATSAMV70N19 microcontrollers from Atmel/Microchip (generated using svd2rust)
-
embedded-controls
Based on switch-hal library that allows to handle primitive controls(buttons, encoders and etc.)
-
unitscale_core
UnitScale core and traits for simplifying conversions over bus communication
-
platform-switch
Namespace facades for switching between platforms
-
is31fl3218
A rust-embedded driver for the Lumissil Microsystems IS31FL3218 LED driver
-
ens160
driver implementation
-
rust-forth-compiler
A Forth compiler written in Rust
-
bmp180-embedded-hal
A platform agnostic driver to interface with the BMP180 barometric pressure sensor
-
wpilib-sys
FRC's WPILib system bindings for rust
-
sae-j1939
both embedded and non-embedded use cases
-
ssd1680
Driver for the SSD1680 e-Paper display (EPD) controller, for use with embedded-hal
-
rf24-rs
A pure-rust driver for the nRF24L01 wireless transceiver
-
gp2y0e02b
driver for the GP2Y0E02B (SHARP I2C Distance Measuring Sensor, 4-50cm)
-
max553x
Driver for the 12-bit MAX5532–MAX5535 DACs
-
dac5578
Texas Instruments DAC5578 Driver for Rust Embedded HAL
-
bmp280-core
Driver for BMP280
-
const-assoc
A const-capable Map type backed by a static array
-
radio-sx127x
Rust driver for the Semtec SX127x Sub GHZ LoRa Radio ICs
-
embedded-i2s
An embedded Inter-IC Sound (I2S) abstraction layer
-
pico-tflmicro-sys
Rust bindings of TensorFlow Lite for Microcontrollers for Raspberry Pi Pico
-
btf2wit
Convert btf info to wit info
-
sparkfun-openlog
A platform-agnostic, embedded-hal driver for the Sparkfun OpenLogger
-
stuw81300
An embedded-hal driver for the STuW81300
-
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.
-
rhai_codegen
Procedural macros support package for Rhai, a scripting language and engine for Rust
-
carlo-run
A runner for the simple interpreted programming language Carlo
-
kc11b04
Driver for the KC11B04 4-button analog keypad
-
arm_pl011
ARM Uart pl011 register definitions and basic operations
-
ltc690x
driver crate for LTC690x serial programmable oscillator
-
parse_sbus
parse SBUS packets to data
-
wasm32-unknown-unknown-openbsd-libc
The parts of OpenBSD libc that make sense on wasm32-unknown-unknown
-
si1145
No-std driver for the Si1145 ambient light sensor
-
mono-clock
Embedded-time Clock implementation using RTIC Monotonic
-
time-series-filter
Filters such as exponential weighted moving average (IIR LPF)
-
fs1027-dg-hal
FS1027-DG Gas Flow Sensor Module driver for no_std embedded-hal
-
driver-3461bs-rs
Driver for 3461BS LED driver
-
cortex-m-rtfm
Real Time For the Masses (RTFM): a concurrency framework for building real time systems
-
l293x
Platform agnostic library for the L293 and L293D motor drivers using embedded-hal
-
linux-syscalls
easily invoke linux system calls
-
megatiny_hal
A hardware abstraction layer for attiny and atmega avr devices
-
drogue-boot
A cortex-m bootloader toolkit
-
mks979b
no_std driver for the MKS 979B Atmosphere to Vacuum Transducer. Based on the embedded-hal traits.
-
atsamda1e14b
Peripheral access API for the ATSAMDA1E14B MCU generated using svd2rust
-
avr-vm
VM with JIT-compiler for ATMega32
-
nuki-backend-hifb
A HiFB + HiTDE drawing backend for the Nuki 2D immediate GUI library
-
embedded-utils
embedded-utils
provides some features in Rust(no_std) embedded systems -
p9813
RGB controller
-
apds9253
Driver for APDS9253 light sensor
-
huber-pilot-one
huber Pilot ONE library
-
cotton-unique
Deterministic per-device unique IDs for embedded systems
-
cmsis-rtos2
wrapper for the CMSIS-RTOS2 API, which should be provided by another library, and linked into the consuming library or application
-
midi-stream-parser
Parser to convert bytes from a MIDI stream into messages
-
phm
Pretty HAL Machine
-
rtic-common
lib TODO
-
arducam-mega
SPI driver for the Arducam Mega
-
rtic-macros
Procedural macros, syntax parsing, and codegen of the RTIC crate
-
sharp-memory-display
A no-std-compatible embedded-graphics driver for SHARP memory-in-pixel displays
-
hdc20xx
Platform-agnostic Rust driver for the HDC2080, HDC2010 and HDC2021 low-power humidity and temperature digital sensor
-
ft260
used for interfaceing with the ftdi ft260 chip
-
atsam3x8e
Peripheral access API for ATSAM3X8E microcontrollers (generated using svd2rust)
-
cargo-n64
Cargo subcommand to build Nintendo 64 ROMs
-
sectorize
A small library for writing arbitrarily-aligned data to sectored mediums
-
embedded-freetype-sys
Low level binding for FreeType font library for no_std targets
-
atsam3u1c
Peripheral access API for ATSAM3U1C microcontrollers (generated using svd2rust)
-
atsam3s8c
Peripheral access API for ATSAM3S8C microcontrollers (generated using svd2rust)
-
atsam3x8c
Peripheral access API for ATSAM3X8C microcontrollers (generated using svd2rust)
-
atsam3n1c
Peripheral access API for ATSAM3N1C microcontrollers (generated using svd2rust)
-
atsam3sd8c
Peripheral access API for ATSAM3SD8C microcontrollers (generated using svd2rust)
-
atsam3sd8b
Peripheral access API for ATSAM3SD8B microcontrollers (generated using svd2rust)
-
atsam3s2a
Peripheral access API for ATSAM3S2A microcontrollers (generated using svd2rust)
-
atsam3u1e
Peripheral access API for ATSAM3U1E microcontrollers (generated using svd2rust)
-
atsam3s1b
Peripheral access API for ATSAM3S1B microcontrollers (generated using svd2rust)
-
atsam3s8b
Peripheral access API for ATSAM3S8B microcontrollers (generated using svd2rust)
-
atsam3s4b
Peripheral access API for ATSAM3S4B microcontrollers (generated using svd2rust)
-
inout_port-rs
inb/outb port in freestanding Rust
-
atsam3u2e
Peripheral access API for ATSAM3U2E microcontrollers (generated using svd2rust)
-
atsam3s4c
Peripheral access API for ATSAM3S4C microcontrollers (generated using svd2rust)
-
atsam3n0c
Peripheral access API for ATSAM3N0C microcontrollers (generated using svd2rust)
-
atsam3s2c
Peripheral access API for ATSAM3S2C microcontrollers (generated using svd2rust)
-
atsam3s2b
Peripheral access API for ATSAM3S2B microcontrollers (generated using svd2rust)
-
atsam3x4e
Peripheral access API for ATSAM3X4E microcontrollers (generated using svd2rust)
-
atsam3x4c
Peripheral access API for ATSAM3X4C microcontrollers (generated using svd2rust)
-
atsam3u4c
Peripheral access API for ATSAM3U4C microcontrollers (generated using svd2rust)
-
rkaiq-sys
Rockchip RKAIQ FFI bindings for Rust
-
tt21100-async
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
timed-signal
Helper crate for generating time-dependent signals
-
ink_prelude
[ink!] Common API for no_std and std to access alloc crate types
-
atsam3u2c
Peripheral access API for ATSAM3U2C microcontrollers (generated using svd2rust)
-
ykoath-protocol
Implementaion of YKOATH Protocol
-
atsam3s1a
Peripheral access API for ATSAM3S1A microcontrollers (generated using svd2rust)
-
ads122x04
Platform-agnostic driver for the ADS122C04 and ADS122U04 analog to digital converters
-
atsam3s4a
Peripheral access API for ATSAM3S4A microcontrollers (generated using svd2rust)
-
atsam3s1c
Peripheral access API for ATSAM3S1C microcontrollers (generated using svd2rust)
-
libalgobsec-sys
Unsafe bindings to the Bosch BSEC library
-
atsam3n4c
Peripheral access API for ATSAM3N4C microcontrollers (generated using svd2rust)
-
atsam3a8c
Peripheral access API for ATSAM3A8C microcontrollers (generated using svd2rust)
-
atsam3n2c
Peripheral access API for ATSAM3N2C microcontrollers (generated using svd2rust)
-
atsam3a4c
Peripheral access API for ATSAM3A4C microcontrollers (generated using svd2rust)
-
atsam3u4e
Peripheral access API for ATSAM3U4E microcontrollers (generated using svd2rust)
-
atsam3x8h
Peripheral access API for ATSAM3X8H microcontrollers (generated using svd2rust)
-
vga-framebuffer
A text console output over a VGA compatible signal
-
gpt-partition
GptPartitionCursor implements the Read + Write + Seek + Debug. It's used for backing up or restoring partition images, such as in embedded upgrades.
-
rpi_embedded
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals. Forked from RPPAL
-
otm8009a
Hardware Abstraction Layer for OTM8009A LCD controller IC
-
gbafix
Rust port of the C
gbafix
utility. For GBA rom patching. -
xtensa-lx106-rt
Low level access for xtensa lx6 processors and peripherals
-
autd3-simulator
AUTD Simulator
-
gy521-rppal
accessing GY-521 sensor data using the rppal library on a Raspberry Pi
-
freebsd-embedded-hal
embedded-hal
traits for FreeBSD devices -
diskio
trait for handling disk IO devices
-
telit-me310g1
interoperate with the Telit ME310G1 LTE-M radio with AT commands
-
esp-storage
embedded-storage traits to access unencrypted ESP32 flash
-
openthread-rust
Sample for Rust bindings for OpenThread
-
nrf-modem-nal
An embedded-nal implementation for the nrf9160 modem
-
relox
ELF32 relocation compression and decompression
-
si70xx
series relative humidity and temperature sensor driver
-
saelient
SAE-J1939 support library
-
bh1750
light sensor driver using embedded-hal
-
rx8900
device driver for the Epson RX8900SA/CE I2C-Bus Interface Real Time Clock Module
-
limone
work with the limine boot protocol
-
atsamd51j
Peripheral access API for ATSAMD51J microcontrollers (generated using svd2rust)
-
ringu
Thread-safe no_std ring buffer
-
one-wire-bus
1-Wire protocol for embedded-hal
-
pio-parser
Raspberry Silicon PIO asm parser
-
msp430fr247x-hal
embedded-hal for microcontrollers MSP430FR2475 and MSP430FR2476
-
rv32-asm
RISC-V(RV32IM) instructions and assembler for Rust
-
afe4400
An
embedded-hal
compatible driver for the TI AFE4400 pulse oximetry analog front-end chip -
binder_ndk
Rust bindings for Android's Binder IPC mechanism
-
ws2812-nrf52833-pwm
nrf52833 PWM driver for ws2812 leds
-
esp-idf-servo
A wrapper of esp-idf-sys bindings for Servo PWM control
-
apds9960
Platform-agnostic Rust driver for the APDS9960 digital proximity, ambient light, RGB and gesture sensor
-
owned-drop
A wrapper that enables ownership on drop
-
hlk_ld6002
interfacing with the HLK-LD6002 respiratory and heartbeat radar module
-
diswh-esp
way to send webhook messages on the ESP platform, or edit for discord. Fully featured with builders to make things easy!
-
bitutils
Bitfield macro and utilities
-
atomic-polyfill
Atomic polyfills, for targets where they're not available
-
wm8731
HAL for the WM8731 audio codec
-
k510-pac
Peripheral access API for Canaan K510 SoC generated from unofficial SVD file
-
sensorhive-idw
Sensor Hive Initial Disk Writer
-
e-ring
A no_std append only ring buffer, when full new element replace oldest one
-
wasm-embedded-rt-wasm3
Embedded WASM C/wasm3 runtime library
-
jt_util
jt808 jt1078等基础库实现
-
taiyi
Cross platform DDS implementation in Rust
-
not-io
A synthesis between no-std, no-alloc and std::io
-
dht11
Platform-agnostic Rust driver for the DHT11 temperature and humidity sensor
-
axp173
Device-agnostic X-Powers AXP173 power management IC driver
-
iot_localproxy_rs
Rust binding for AWS IoT Secure Tunneling Local Proxy
-
u7
dotnet's 7bit int in Rust
-
open-vector-tile
reads/writes The Open Vector Tiles 1.0 Specification
-
mii
A rust-embedded implementation of the monome ii protocol
-
cosey
Data types and serde for public COSE_Keys
-
hilog-binding
hilog binding for rust
-
plckit
Kit for PLCs and real-time micro-services
-
rgbled
driver for controlling RGB LEDs using PWM, with built-in gamma correction
-
dp32g030
Peripheral Access Crate for the DP32G030 microcontroller
-
qwiic-button-led
A driver for the SparkFun Qwiic Button LED
-
scl3300
Driver for the SCL3300 inclinometer
-
tmcl
Trinamic Motion Control Language
-
smbus-adapter
smbus standardized transfers to i2c devices
-
btmgmt-packet-helper
btmgmt-packet helper
-
lps25hb
A platform agnostic driver to interface with LPS25HB pressure sensor module
-
w25q
A generic driver for different SPI Flash and EEPROM chips
-
at42qt1070
Embedded-hal implementation for the AT42QT1070
-
thingy-91-nrf9160-bsp
BSP for the Nordic Thingy:91 nRF9160
-
AT42QT2120
Platform agnostic Rust driver for the AT42QT2120
-
unmp-link-udp
udp link for unmp
-
tca62724fmg
RGB LED driver for embedded hal
-
sogi_pll
SOGI-PLL imlementation
-
allegro-motor-drivers
Allegro microsystems motor controller driver registers
-
pca9555
A rust-embedded driver for the (P|T)CA9555 i/o port expander
-
avrisp
AVR ISP library
-
heatshrink
A minimal implementation of the heatshrink compression algorithm for no_std environments
-
ssd1315
OLED driver
-
scd30-interface
An I2C driver for the SCD30 sensor in Rust
-
bmp388
A platform agnostic driver to interface with the BMP388 pressure sensor
-
esp-tm1637
platform agnostic driver for a LED-display powered by TM1637 chip
-
esp-max31865
An ergonomic wrapper for interfacing with Max31865 SPI RTD devices using an ESP32
-
clerk
A fully featured hardware agnostic HD44780 LCD controlling library
-
az65
A multi-CPU assembler
-
vgainfo-rs
VGA(0xB8000) info in freestanding Rust
-
microchip-eeprom-25lcxx
A platform agnostic driver to interface with the Microchip 25LCxx EEPROM through SPI
-
mwatch-sdk
A development SDK for applications on the https://github.com/MWatch
-
shiftreg-spi
SPI-based driver for shift registers such as 74HC595 with embedded-hal API
-
fchashmap
A fixed capacity no_std hashmap
-
hmc5983
magnetometer driver for embedded hal
-
mm-std-embedded-nal
embedded-nal
traits for large devices that support the standard library -
tinypointers
Pointer implementations that take 8 or 16 bits
-
k64
Peripheral access API for Kinetis K64 microcontrollers
-
alloc-traits
Traits to replace or supplement the alloc module in no_std
-
ea-big
open ea .big game files
-
unmp
-
blend-srgb
A small,
#![no_std]
-compatible sRGB conversion and blending library designed for performance -
max7797x-driver
An embedded async driver for the MAX77975/MAX77976 battery charger
-
si_format
format numbers using metric prefixes
-
nu-isp
Nuvoton ISP_HID protocol library
-
usbd-blaster
USB Blaster for Embedded Devices
-
microchip-eeprom-25x
A platform agnostic driver to interface with the Microchip 25xxxx EEPROM through SPI
-
syscon-rs
A driver for syscon poweroff, and reboot in rust
-
dtb-early-console
Init early console from device tree, mostly for Arm
-
mnemos
A tiny embedded operating system kernel
-
sntpc
making SNTP requests
-
embedded-graphics-core
Core traits and functionality for embedded-graphics
-
bl61x-pac
Embedded Rust's Peripheral Access Crate for BL616/BL618 microcontrollers
-
stackdump-capture
capturing stack dumps
-
ellie_engine
Why ellie? Ellie is a type-safe programing language that runs on embedded and sandboxed environments
-
nng-c
High level bindings nng C library
-
rust-forth-tokenizer
A Forth tokenizer written in Rust
-
bitwrap
pack/unpack data into byte array
-
nu-isp-cli
CLI tool for Nuvoton ISP_HID Bootloaders
-
rkrga-sys
Rockchip RGA FFI bindings for Rust
-
aevum
A CLI utility to calculate timer register values for STM32 microcontrollers
-
ke04z4-pac
PAC for NXP Kinetis MKE04Zx microcontrollers
-
u32err
A neat error type for FFI functions (where non-zero = failure)
-
mos6502_assembler
DSL for MOS6502 assembly
-
hd44780_menu
A menu system for use with the HD44780 display
-
simplehttp
(and very immature) sync http client. Intended to have multiple implementations abstracting away API differences between platforms
-
core_ux
no_std implementation of the non-standard types u/i1..=63
-
rawtime
Basic timing infrastructure for no_std (currently x86 only) platforms
-
efm32zg210-pac
Peripheral access API for EFM32ZG210 MCU (generated using svd2rust)
-
efm32zg222-pac
Peripheral access API for EFM32ZG222 MCU (generated using svd2rust)
-
efm32zg110-pac
Peripheral access API for EFM32ZG110 MCU (generated using svd2rust)
-
hvac
hvac controller state machine
-
df2301q
Gravity Offline Voice Recognition Module Rust Driver
-
embedded-flight-scheduler
Embedded flight real-time scheduler library
-
ezo_i2c_rs
interface to interact with Atlas Scientific Ezo Devices, using the I2C protocol
-
teleprobe-meta
Embed teleprobe metadata into ELF binaries
-
s2json
supports the S2JSON 1.0 Specification
-
pic32mx567
Peripheral access API for PIC32MX5xx/6xx/7xx microcontrollers
-
umcan
A no_std rust crate to generate and parse CAN Frames for UltraMotion Actuators
-
cubic-splinterpol
efficient cubic spline interpolation on no_std
-
simavr-ffi
Low-level bindings to simavr
-
mics-vz-89te
driver implementation
-
allocvec
A vector type that preserves the index of every inserted element
-
sdio_sdhc
driver to drive sdhc over SDIO, no filesystem, only test stm32f407 board,other stm32f4xx boards have no test
-
usbd-microsoft-os
Microsoft OS USB descriptors for usb-device
-
ihex-merge
based on the ihex crate to merge ihex (intel HEX) object files into one
-
smart-leds-trait
A trait for implementing effects, modifiers and drivers for programmable leds
-
thghosting-data-centers
THG Hosting Data Centers
-
lcd-pcf8574
Hitachi HD44780-compatible LCD display attached to PCF8574 I2C expander
-
lpc-usbd
'usb-device' implementation for LPC microcontrollers
-
mcp4725-async
An async driver for the MCP4725 DAC
-
max485
embedded-hal driver for operating the MAX485 uart to rs485 module in half duplex mode
-
senseair
Protocol implementations to communicate with Senseair devices
-
trinamic
Motion Control Language (TMCL) in Rust
-
iaq-core
Platform-agnostic Rust driver for the iAQ-Core indoor air quality sensor. Compatible with iAQ-Core-C and iAQ-Core-P.
-
const-writer
Compile time checked byte manipulations
-
icube-sdk-sys
Bindings for the iCube SDK C API
-
microchip-tc72r-rs
A platform agnostic driver to interface with the Microchip TC72 (temperature sensor) through SPI using embedded-hal
-
ht32f1xxxx
Device support crates for HT32F1XXXX devices
-
r-efi-alloc
UEFI Memory Allocator Integration
-
ep-systick
embedded-profiling
implementation using systick -
embedded_font
Font rendering (ttf and otf) with embedded-graphics
-
phm-worker
The Embedded Worker for Pretty HAL Machine
-
eva-rjrpc
EVA ICS JSON RPC internals
-
xmc4400
XMC peripheral library for XMC4400 generated from SVD
-
max32660-hal
Hardware Abstraction Layer (HAL) for the MAX 32660 microcontroller
-
gc9a01a
SPI driver for the GC9A01A LCD display controller
-
spb_rs
Sparkplug-B client library
-
serial-can
Serial CAN (slcan) for small systems
-
aarch64-arch-helpers
Helper functions to access aarch64 CPU registers
-
light_seq
Raspberry Pi based light show program reacting to the audio input
-
ehlcd2d
embedded-hal driver for HD44780 with async support
-
kernaux-sys
Unsafe no-std binding to libkernaux - auxiliary library for kernel development
-
lvgl-sys
Raw bindings to the LVGL C library
-
multi-mission-library-rs
designed to hold composable, reusable driver code / wrappers for various sensors and hardware output devices. Currently it does not support differing STM32 models and only supports the STM32F4…
-
coreboot-table
Coreboot Table Parser
-
async-embedded-traits
A set of async traits for embedded systems
-
i2c-reg
Create registers for reading and writing with I2C interface
-
emc230x
An async driver for the EMC230x family of fan controllers
-
static-linkedlist
A linked list implementation on a static array. Intended for use in environments without dynamic memory allocation.
-
svm40
Rust driver for the Sensirion SVM40 sensor
-
bmx055
platform agnostic Rust driver for the BMX055 small, versatile 9-axis sensor module: 3D accelerometer, 3D gyroscope and 3D magnetometer
-
simple-pcf
parsing PCF bitmap font files
-
mcp9600
Basic embedded-hal-based I2C driver for the MCP9600 and MCP9601 thermocouple amplifier ICs
-
sh1122-rppal
A user mode driver for SH1122 (Raspberry PI interface)
-
hftwo
working with the HF2 protocol
-
bluetooth-hci
Bluetooth HCI
-
microasync-util
very small async runner
-
stratum-v1
Stratum v1 client. This provides a
#[no_std]
library to implement a Stratum v1 client -
bmp180-driver
A driver for BMP180 Digital Pressure Sensor
-
atomic_ref
Atomic &'a T types with support for static allocation
-
panic-custom
Small panicking rust crate that allows to easily set the behavior of panicking for embedded or regular no_std binaries
-
async-button
Async button handling crate for no_std environments
-
drmem-drv-weather-wu
DrMem driver which gets Weather Underground data
-
atsam4n8a-pac
Peripheral access crate for the ATSAM4N8A microcontroller
-
ft6x06-rs
A pure Rust driver for the FT6x06 capacitive touch screen controller
-
andes-riscv
Low level access to Andes' AndeStar V5 RISC-V processors
-
rydis
low level rust bindings for the zydis library
-
postform_decoder
Decoder for the Postform logging framework, an efficient logging framework for mcu's
-
rak-rui3-eh-driver
Rust embedded-hal driver for the RAK LoRaWAN modules running RUI3 firmware in AT mode
-
lvgl-codegen
Code generation based on LVGL source code
-
rdrive
A dyn driver manager
-
cross-stream
An event stream store for personal, local-first use, specializing in event sourcing
-
stm32f7xx-hal
HAL for the STM32F7xx family of microcontrollers
-
stm32wb-hal
Hardware abstraction layer for the STM32WB55 chips
-
modio-logger-db
modio-logger Dbus service
-
cursor-rs
Getter & Setter cursor position on VGA(0xB8000) in freestanding Rust
-
rflow-chat
Text protocol for embedded apps
-
teensycore
A kernel for the teensy4.0 microcontroller
-
ublox-cellular-rs
Driver crate for u-blox cellular devices, implementation follows 'UBX-13002752 - R65'
-
ldc1614
TI LDC1614 inductance-to-digital converter user-friendly driver for
embedded-hal
-
channel-bridge
Blocking and async Sender and Receiver traits and implementations
-
neon-rtos
A real-time operating system for ARM Cortex-M or RISC-V microcontrollers
-
seq
The module 'seq' provides the lightweight, generic sequence container 'Seq' for unmovable data and is embedded into the program during compile time
-
microbit-clock
clock app for the BBC micro:bit
-
pdm
Pulse Density Modulator
-
embassy-dht
interface for interacting with DHT1X and DHT2X temperature and humidity sensors using the Embassy framework
-
sel4
High-level Rust interface to the seL4 kernel
-
labrador-ldpc
Encoders and decoders for CCSDS LDPC error correcting codes
-
uart_xilinx
provide a struct with many methods to operate uarts in Xilinx's FPGA: XPS UART Lite, AXI UART Lite
-
sen0177
Read air quality data from the SEN0177 and PMSA003I sensors
-
simmer
A temperature unit library for Rust. It's intended to be minimal, embedded-aware, and easy to use!
-
kpal
An extensible and RESTful control system for physical computing
-
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
-
atsame70n20b
Peripheral access API for the ATSAME70N20B MCU from Microchip (generated using svd2rust 0.33.5)
-
bmp390
Asynchronous driver for the BMP390 pressure sensor
-
w5500-dns
DNS client for the Wiznet W5500 internet offload chip
-
hd44780-ntb
A non-text buffer embedded hal driver for hd44780 like LCD display controllers
-
edge-net
no_std and no-alloc async implementations of various network protocols
-
byte-calc
Helper crate to work with bit, byte, and block sizes
-
asm6502
A basic 6502 assembler
-
defmt-or-log
Logging macros that forward to either defmt or log
-
robokit
Build custom firmware for simple robotic automation
-
pinetime-lvgl
LVGL Bindings for Mynewt on PineTime Smart Watch
-
nickel-lang-core
Programmable configuration files
-
debouncr
no-std input debouncer to detect rising and falling edges with minimal RAM requirements
-
mpu6000
Platform agnostic driver for MPU6000 6-axis IMU
-
sm2335egh
Driver for the SM2335EGH LED controller found in the SwitchBot Color Bulb
-
ahtx0
An async driver implementation for the AHT10 and AHT20 sensors (no-std)
-
free-flight-stabilization
PID flight stabilization functions. no_std, no-alloc.
-
stm32l4
Device support crates for STM32L4 devices
-
itron
Interface to operating systems based on μITRON and its derivatives
-
avr_delay
AVR providing software-based delay functions
-
stm32ral
Register access layer for all STM32 microcontrollers
-
adafruit-bluefruit-protocol
A
no_std
parser for the Adafruit Bluefruit LE Connect controller protocol -
raw-slicee
Generic low-level raw slice types
-
northstar-runtime
Northstar is an container runtime for Linux targetting embedded systems
-
enumap
A HashMap and HashSet like interface for enums backed by an array
-
lsm9ds1
A platform agnostic driver to interface with LSM9DS1 3D accelerometer, 3D gyroscope, 3D magnetometer sensor module
-
sola
A 16-bit stack machine and forth language
-
defmt-serial
Log defmt-messages over serial
-
embedded-msgpack
MessagePack serialization implementation for Rust optimized for embedded/no_std environments
-
signalo_filters
A collection of filters used in 'signalo' umbrella crate
-
docopticon
An argument-parser based on the obligatory help-text
-
jh71xx-hal
Hardware abstraction library for the JH71xx SoCs
-
ofw
basic interfacing with OpenFirmware (former IEEE standard 1275)
-
canutils
A can-utils implementation in pure Rust
-
owned-buf
An owned buffer type for reading into possibly uninitialized memory
-
smolusb
An experimental lightweight library for implementing USB on embedded systems
-
panic-serial
Print panics on serial port
-
cmos
read, write CMOS and RTC data. Standard library not required.
-
xous-ticktimer
Provide high-resolution, non-rollover system time
-
ssd1306-i2c
SSD1306 I2C driver
-
dw1000
Driver for the Decawave DW1000 UWB wireless transceiver chip, providing radio communication based on IEEE 802.15.4 and distance measurement
-
rrt0
cross-platform runtime / startup (like crt0)
-
own_or_borrow
Unified references to owned or RefCell borrowed data
-
libgpiod
wrappers
-
sbus-parser
Futaba SBUS parser using loop and byte swap
-
mci
MultiMedia Card Interface (SD, MMC, SDIO) implementation using MCI
-
drogue-http-client
An HTTP client for embedded devices, based on drogue-network
-
teleinfo-parser
A small library for parsing TeleInfo frames from french EDF energy meters
-
sgpc3
Rust driver for the Sensirion SGPC3 gas sensor
-
sh1108
display-interface
compatible driver for the SH1108 OLED display controller -
ble-peripheral-rust
A cross-platform Rust crate for building Bluetooth Low Energy peripherals
-
flem
Flexible, Light-weight, Embedded Messaging Protocol
-
liboptic_edid
Parses EDIDs from raw bytes (in 100% Rust)
-
max7301
Driver for the MAX7301 serial I/O expander
-
dbc-codegen-cli
CLI for CAN DBC codegen
-
disarm64_defn
structures and enums for describing AArch64 (ARMv8) instructions
-
sx127x_lora
A platform-agnostic driver for Semtech SX1276/77/78/79 based boards
-
fel-cli
CLI tools for dealing with Allwinner devices in FEL mode, in pure Rust
-
vl53l0x-simple
driver for the VL53l0X TOF ranging sensor
-
entro-shift
Entro Shift is a 32-bit, pseudo-random number generator algorithm
-
juicebox
advanced programming language
-
safe-ftdi
A safe wrapper around libftdi
-
as5048a
Rust driver for AMS AS5048A Magnetic Rotary Encoder
-
nickel-lang-package
Nickel Package Manager
-
kernaux
Safe binding to libkernaux - auxiliary library for kernel development
-
atsam4-hal
HAL for the ATSAM4 microcontrollers
-
daisy_bsp
A board support package for the Electro-Smith Daisy Seed
-
sdmmc-driver
SD/MMC driver traits and implementations
-
rpk-firmware
RPK Keyboard firmware
-
slaballoc
Safe and lockless fixed-size memory allocator for
no_std
systems -
turbine-pd
Rust wrapper for the Playdate C API
-
liboscore-msgbackend
libOSCORE's CoAP messages based on the cjGoap-message crate
-
yaxpeax-pic18
pic18 decoder for the yaxpeax project
-
efr32xg1
Peripheral access API for EFR32xG1 microcontrollers
-
edge-captive
Async +
no_std
+ no-alloc implementation of a Captive Portal DNS -
sn3193
Driver for SN3193 3-Channel Fun LED Driver
-
wokwi_chip_ll
Wokwi Custom Chip API for Rust
-
char_lcd_rgb_i2c
controlling RGB1602 LCD displays via MCP23017 I/O expanders
-
hcsr04_async
A no-std driver for the HC-SR04 ultrasonic sensor using async
-
esp-app-format
binding to esp-idf/bootloader_support, it does not require specific target or RTOS
-
tiny-led-matrix
direct control of a small monochrome LED display
-
lps22hb
A platform agnostic driver to interface with LPS22HB pressure sensor module
-
array-utils
A no-std heapless set of array utils making use of const generics
-
mcp3425
Platform agnostic Rust driver for the Microchip MCP3425/6/7/8 ADC
-
tudelft-serial-upload
automatically upload to quadrupel drone boards
-
mintaka
Native
-
neotron-romfs
Parse a Neotron ROM-FS image
-
riscv-rt
Minimal runtime / startup for RISC-V CPU's
-
gpio-cdev
Linux GPIO Character Device Support (/dev/gpiochipN)
-
da14581-pac
Peripheral Access Crate (PAC) for DA14581
-
is31fl32xx
A rust-embedded driver for the Lumissil Microsystems IS31FL3205 LED driver
-
martos
elegant real-time operating system designed for creating complex multi-agent systems. Developers have the flexibility to write software for Martos using either Rust (preferred) or C languages.
-
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…
-
embedded-hal-bus
Bus/Device connection mechanisms for embedded-hal, a Hardware Abstraction Layer (HAL) for embedded systems
-
rgy
No-std Rust GameBoy emulator library
-
playdate-rs-sys
Raw unsafe Rust bindings for the Playdate SDK C-API
-
owfs
Rust API for OWFS (1-Wire file system)
-
rohi-hal
Robonomics Open Hardware Abstraction Layer
-
lc709203
Platform-agnostic Rust driver for the LC709302 battery gauge sensor
-
klaptik
Experimental UI rendering framework for LCD/OLED displays
-
drv8833-driver
A driver for DRV8833 motor driver
-
maikor-platform
Maikor Platform specifications (language, addresses, etc)
-
async-opcua-nodes
OPC UA node representation and import framework
-
qtest
Connector for working with the QTest socket
-
embedded-graphics-framebuf
Frame buffer helper for embedded-graphics
-
zip_parser
A zip file format parser, supporting no_std environment, stream parsing and seeking
-
mpfs-hal-embassy
Embassy integration for PolarFire SoC
-
dtb
Device tree blob manipulation
-
samd-timer
High-level API for the TC/TCC peripherals found on the Microchip SAM MCUs
-
am2301
interface with an AM2301 humidity and temperature sensor
-
rppal_w_frontend
Interface for the Raspberry Pi's GPIO, I2C, PWM, SPI and UART peripherals
-
yaxpeax-avr
AVR instruction set decoder for yaxpeax
-
SKEAZN642
Device support crate for KEAZN64 devices
-
bit_op
Bit manipulation
-
lsm303dlhc-ng
A platform agnostic driver to interface with the LSM303DLHC (accelerometer + compass)
-
iqs323-driver
An embedded async driver for the IQS323 IQ Switch ProxFusion touch and proximity sensing controller
-
keyberon
Parse command line argument by defining a struct
-
embedded-ads1220
Embedded Driver for the Texas Instruments ADS1220 ADC
-
embedded-runtime-nrf52840
A tiny async runtime for embedded devices, with predefined runtime hooks for the nrf52840
-
m95320
Driver for STMicroelectronics M95320 32-Kbit serial SPI bus EEPROM
-
drone-nrf91-dso
Nordic Semi nRF91 DSO implementation for Drone, an Embedded Operating System
-
phidget
Phidget library for Rust
-
r3_port_std
Simulator port for the R3-OS original kernel
-
simple-psf
parsing PSF bitmap font files
-
qwiic-lcd-rs
aims at controlling QwiicLCD screens using I2C from Linux
-
opcua-crypto
Encryption / decryption used by OPC UA client and server
-
trallocator
A no_std lbrary for wrapping an existing allocator and tracking the heap usage
-
lorawan-device
LoRaWAN device stack implementation
-
xmc4-hal
Peripheral access API for XMC4 series microcontrollers
-
rure
A C API for Rust's regular expression library
-
lpc845-pac
Low-level register mappings for the NXP LPC845 series of ARM Cortex-M0+ microcontrollers
-
yaxpeax-avnera
avnera decoder for the yaxpeax project
-
stm32f4
Device support crates for STM32F4 devices
-
esp32s2
Peripheral access crate for the ESP32-S2
-
microamp
Asymmetric Multi-Processing on microcontrollers
-
pac55xx-hal
Hardware Abstraction Layer (HAL) for PAC55XX
-
px4flow_bsp
A board support package for the PX4FLOW optical flow sensor board
-
defmt-bbq
A generic bbqueue based transport for defmt log messages
-
i2c_lcd_screen
Rewrite of I2C driver for LM1602 LCD displays based on port of LiquidCrystal_I2C.h
-
tsl2591-eh-driver
Rust embedded-hal driver for the TSL2591 Light Sensor
-
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.
-
rtic-monotonic
Core abstractions of the Real-Time Interrupt-driven Concurrency Monotonic timers
-
mcumeter
Firmware for my MCU power meter based upon STM32F042 and INA260
-
stm32wb-hci
Bluetooth HCI for the STM32WB family
-
mju-bits
no_std typed bitfield access for u8, u16, u32 and u64
-
apdu-dispatch
Dispatch layer after nfc-device and usbd-ccid
-
anyleaf
Driver for AnyLeaf sensors
-
winpipe2serial
link a windows named pipe to a serial COM port
-
edge-executor
Async executor suitable for embedded environments
-
bcm2837-lpa
Peripheral access crate for BCM2837 found in the Raspberry Pi 3 and Zero 2W
-
pimoroni-pico-explorer
Board Support Package for the Pico Explorer
-
lpc177x_8x
Peripheral access API for LPC177x and LPC178x microcontrollers (svd2rust 0.13.1)
-
cc2650
Device support for TI CC2650 microcontrollers
-
simavr-section
Add simavr-compatible metadata to your binary
-
pimoroni_gfx_pack
Driver for LCD GFX PACK by Pimoroni
-
vexide-embedded-graphics
embedded-graphics driver for the VEX V5 Brain
-
canadensis_can
A Cyphal implementation: Cyphal/CAN (CAN and CAN FD) transport layer
-
volatile-register
Volatile access to memory mapped hardware registers
-
websocket-std
Websocket implementation using std support, focus on microcontrollers and interoperability with other languages like C through the ffi
-
samd11_bare
Support crate for the ATSAMD11C
-
stm32wlxx-hal
Hardware abstraction layer for the STM32WL series microcontrollers
-
lsm303dlhc-registers
A typed map of the STMicroelectronics LSM303DLHC E-Compass registers
-
usbd-ctaphid
usb-device driver for CTAPHID
-
nfp1315
NFP1315-61A display (I2C SSD1306 driver)
-
embedded-ads111x
ADS111x 16bit ADCs I2C rust driver no_std
-
hifb-sys
Hi35XX FB API for Rust unsafe bindings
-
pavo-traits
Traits for the Pavo Framework
-
iffi
Make assertions about values used over FFI
-
embedded-plots
Heapless plotting library for embedded targets based on embedded-graphics crate
-
stm32g4-staging
Device support crates for STM32G4 devices
-
resolution
Retrieves current screen resolution
-
portable
A minimal and portable low-level x86 IO port handling library
-
embedded-nano-mesh-linux-examples
Lightweight mesh communication protocol for linux
-
ostd-test
The kernel mode unit testing framework of OSTD
-
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.
-
volatile-mem
managing volatile memory
-
ch32-metapac
Peripheral Access Crate (PAC) for all WCH's MCU chips, including metadata
-
defmt-print
that decodes defmt logs and prints them to the console
-
rpi_sim868
RPi SIM868 is a crate designed to facilitate interaction with the Waveshare SIM868 HAT for Raspberry Pi
-
wasefire-logger
Wasefire platform logging
-
hds
Heapless Data Structures for
no_std
environments -
barebones-watchface
Barebones Watch Face for Mynewt on PineTime Smart Watch
-
ueight
Helpers for raw AVR programming
-
rustot
AWS IoT
-
metrics-controller
Metrics Controller is a project to collect metrics for Mozilla IOT projects
-
lcd_i2c_rs
interfacing with I2C LCDs on the ESP32 using the ESP-IDF HAL
-
git-tags-semver
extract SemVer Version Information from annotated git tags
-
clock_source
set a common clock source
-
drogue-embedded-timer
Macro to shim heterogeneous HAL timers to embedded-time
-
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
-
rn2xx3
Rust driver for Microchip RN2483 and RN2903 LoRaWAN modules. [WIP]
-
panic-dcc
Report panic messages to the host using the Debug Communication Channel (DCC)
-
tmp1075
Platform-independent Rust driver for TMP1075 digital temperature sensor
-
aarch64_define
aarch64 架构以及一些配置定义
-
wasefire-cli-tools
Command-line utilities for Wasefire
-
canparse
A CAN signal and definition parser
-
rkrga
Rockchip RGA bindings for Rust
-
bbqueue-ng
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
embedded-bacnet
A bacnet library for embedded systems (no_std)
-
arduino-run
A cargo runner for Arduino boards
-
sk6812_rpi
SK6812RGBW library for RaspberryPi
-
ssd1331-async
Async driver for SSD1331-based displays with SPI interface
-
esp-alloc
A heap allocator for Espressif devices
-
manchester-code
A no-std library to allow Manchester encoding and decoding of datagrams
-
imxrt-usbd
USB driver for NXP iMX RT processors
-
msp430-atomic
Atomic operations for MSP430 microcontrollers
-
ti-lp55231
Linux I2C driver for Texas Instruments LP55231 LED controller
-
mh-z19c
Pure rust implementation to read out the Winsen MH-Z19C CO2 sensor
-
nrf-hal
Hardware abstraction layer for Nordic nRF5x chips
-
mcp3424
Async Rust driver for the MCP3422/3/4 ADC
-
msp430
Low level access to MSP430 microcontrollers
-
embedded-svc
A set of traits for services higher level than embedded-hal and typically found in embedded microcontrollers with WiFi or BLE support
-
pcd8544
communicate and write to PCD8544 using embedded_hal as abstraction layer. WIP
-
pimoroni_gfx_pack_button
Driver for LCD GFX PACK buttons by Pimoroni
-
fpgrars
Fast Pretty Good RISC-V Assembly Rendering System
-
wave
A no-std no-alloc gesture recognition library for low resolution TOF-Sensors
-
breakwater-parser
Parses Pixelflut commands as fast as possible
-
easy-modbus
Modbus library
-
microasync-rt
A runtime for the very small async runner
-
embedded-hal-nb
Non-blocking Hardware Abstraction Layer (HAL) for embedded systems using the
nb
crate -
tmp1x2
Platform-agnostic Rust driver for the TMP102 and TMP112 digital temperature sensors
-
satrs-shared
Components shared by multiple sat-rs crates
-
nrf52833-hal
HAL for nRF52833 microcontrollers
-
ads129xx
Driver crate for the Texas Instruments ADS1292 24-bit 2-channel low-power analog front end for ECG applications
-
bt-hci
Bluetooth HCI data types
-
nrf9160-pac
Peripheral Access Crate for Nordic's nrf9160 microcontroller
-
nrf24l01
A pure Rust user space driver for NRF24L01(+) transceivers on Linux
-
edge-raw
Async +
no_std
+ no-alloc implementation of IP and UDP packet creation and parsing -
chunked-buffer
A chunked buffer for memory constrained systems
-
rbd_dimmer
Rewrite RBDDimmer for Rust. Work only on ESP32
-
sram23x
Platform-agnostic Rust driver for the 23xx series serial SPI SRAMs
-
vl53l1x
Time-of-Flight sensor
-
lpc8xx-hal
Hardware Abstraction Layer (HAL) for the NXP LPC800 series of ARM Cortex-M0+ microcontrollers
-
atsame54p
Peripheral access API for ATSAME54P microcontrollers (generated using svd2rust)
-
ad9850
Embedded driver for the AD9850 DDS synthesizer chip
-
person-sensor
An embedded-hal driver for the Useful Things Person Sensor
-
nucleo-h7xx
Board support crate for the STMicroelectronics STM32H7 Nucleo-144 boards
-
satrs-mib
Helper crate of the sat-rs framework to build a mission information base (MIB) from the On-Board Software (OBSW) code directly
-
rv3028c7-rtc
RV-3028-C7 and similar Real Time Clock (RTC) no_std driver
-
tmp108
Platform-agnostic Rust driver for the TMP108 temperature sensor
-
mkl25z4
Peripheral access API for NXP KL25Z microcontrollers
-
adp5360
An async embedded-hal driver for the ADP5360 Power Management IC
-
stm32f3-discovery
Board support package for the STM32F3DISCOVERY board
-
stackdump-trace
tracing stack dumps
-
fuchsia-zircon-types
Types for low-level Rust bindings for the Zircon kernel
-
postform_rtt
Decodes Rtt logs for Postform, an efficient logging framework for mcu's
-
radio-sx128x
Driver for the Semtec sx1280 2.4GHz RF IC
-
e310x
With svd2rust generated peripherals for Freedom E310 MCU's
-
w5500-tls
TLS client for the Wiznet W5500 internet offload chip
-
dyn-smooth
Dynamic smoothing filter based on an algorithm by Andrew Simper
-
defmt-itm
Transmit defmt log messages over the ITM (Instrumentation Trace Macrocell) stimulus port
-
rcore-os/linux-syscall
Linux syscalls implementation
-
efm32gg11b820
Peripheral access API for EFM32GG11B820 microcontrollers
-
mil_std_1553b
MIL STD 1553B message parsing and types
-
mecha-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 -
wasefire-wire
Wasefire wire format
-
canadensis_serial
A Cyphal implementation: Cyphal/Serial transport
-
ht32-usbd
'usb-device' implementation for HT32 microcontrollers
-
aarch64-rt
Startup code and exception vector for aarch64 Cortex-A processors
-
derive-mmio
A mechanism for making it easier to access MMIO peripherals
-
atomik
Generic Atomic type
-
stackdump-cli
capturing stack dumps
-
c3io
Like C3PO but for IO
-
atsaml21j18bu
Device crate for the Microchip ATSAML21J18BU, generated from its SVD file
-
edwardium_logger
logger implementation
-
chip-select
Chip select GPIO support traits
-
ruspiro-mailbox
Raspberry Pi mailbox property tag interface API
-
vorago-reb1
Board Support Crate for the Vorago REB1 development board
-
cortex-m-asyncrt
A minimal async runtime for Cortex-M devices
-
autd3-core
AUTD3 core traits and types
-
ina233
driver for the Texas Instruments INA233 power monitor
-
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.
-
pic32-config-sector
Calculate constant values for PIC32 configuration words
-
a653rs-xng
a653rs partition library for xng hypervisor
-
nstr
A no_std, no_alloc, embedded-friendly string library
-
as8510
An async no_std driver for the AS8510 SPI current and voltage sensor
-
naive-timer
A minimal naive timer for embedded (no_std) platforms
-
nrf-pac
Peripheral Access Crate (PAC) for Nordic Semiconductor nRF chips
-
ade791x
Driver for the ADE7912/ADE7913 3-Channel, Isolated, Sigma-Delta ADC with SPI
-
vs1003-pac
VS1003 audio codec peripheral access crate
-
nrf52840-pac
Peripheral Access Crate for Nordic's nrf52840 microcontroller
-
codde_protocol
Multi Communication protocol in heart of the C.O.D.D.E. Pi framework
-
stm32f0xx-hal
Peripheral access API for STM32F0 series microcontrollers
-
heatshrink-lib
A minimal library implementing the heatshrink compression algorithm for no_std environments
-
defmt-tcp
Prints defmt logs received from a TCP interface
-
stockbook
1-bit image embedding at compile time
-
yotasm
Assembler for my 16 bit CPU
-
da14582-pac
Peripheral Access Crate (PAC) for DA14582
-
atsams70j19b
Peripheral access API for the ATSAMS70J19B MCU from Microchip (generated using svd2rust 0.33.5)
-
ellie_fmt
Formatter for ellie
-
loadstone
Portable secure bootloader for Cortex-M MCUs
-
rust-rsm
RSM:A Realtime Software Middleware framework. Asynchronous, event driven framework
-
scd4x-rs
query SCD4x sensors over I²C
-
sfsm-base
Traits for the sfsm crate
-
gd32f1
Device support crate for GD32F1 devices
-
steami-rs
Board support crate for the STeaMi (steami.cc)
-
northstar-client
Northstar is an container runtime for Linux targetting embedded systems
-
tm1637
A platform agnostic driver to a LED-display powered by the TM1637 chip
-
atsam4n16c-pac
Peripheral access crate for the ATSAM4N16C microcontroller
-
ufmt-stdio
C stdio writer for ufmt
-
wake-rs
Wake protocol library written in Rust
-
embassy-time-driver
Driver trait for embassy-time
-
mstak
Minimal Stak Scheme interpreter
-
moondancer-pac
A peripheral access crate for the Cynthion Moondancer SoC
-
tinyrlibc
Tiny, incomplete C library for bare-metal targets, written in Stable (but Unsafe) Rust
-
stm32f7-staging
Device support crates for STM32F7 devices
-
eg-seven-segment
Seven-segment displays for embedded-graphics
-
arena-alloc
A small arena allocator with a static backing store and ability to allocate arbitrary types
-
cargo-minicov
Code coverage support for no_std and embedded programs
-
embedded-sgp30
Platform-agnostic Rust driver for the SGP30 gas sensor for indoor air quality applications
-
embedded-menu
interactive menu for embedded devices
-
ag-lcd
port of the LiquidCrystal arduino library
-
wasper
A Webassembly interpreter written in Rust without standard library
-
icewrap
Port of Heatshrink to Rust
-
adafruit_nxp
Driver for Adafruit Precision NXP 9-DOF Breakout Board - FXOS8700 + FXAS21002 modules
-
nostd_async
An asyncronous runtime for a single-threaded no_std environment
-
drogue-esp8266
Networking stack for ESP8266 Wifi offload board
-
rpi_ws281x-c
Wrapper for rpi_ws281x C library
-
ab1024-ega
An embedded-hal SPI driver for AB1024-EGA/AC057TC1 (as used in Inkplate 6 COLOR)
-
rselib
Misc algorithms implemented for embedded usage (i.e., wasm)
-
msp430-periph
Peripheral definition for all MSP430s
-
qingke
Low level access to WCH's QingKe RISC-V processors
-
epd-gde021a1
An embedded-hal based driver for ePaper displays with chip: GDE021A1 (172x72 B/W via SPI)
-
ws2812-async
Async SPI driver for ws2812 leds
-
avr-std-stub
Contains simple implementations of required language items that
libstd
normally defines on other targets -
dynisland_clock_module
Clock module for dynisland
-
xmc4200
Peripheral access library for XCM4200 ARM Cortex-M
-
iis2mdc
driver for ST iis2mdc sensor
-
panic-rtt-target
Logs panic messages over RTT using rtt-target
-
ina219
current/power monitor driver
-
awedio_esp32
ESP32 backend for the awedio audio playback library
-
dasharo_ectool
Dasharo EC tool
-
mpfs-hal
Hardware Abstraction Layer for PolarFire SoC
-
embedded-hal-compat
Compatibility layer for interoperability between different embedded-hal versions
-
teensy4-pins
Helpers for configuring and using a Teensy 4's pins. Part of the teensy4-rs project
-
poller
File I/O events library for Rust
-
embassy-embedded-hal
Collection of utilities to use
embedded-hal
andembedded-storage
traits with Embassy -
scpi-contrib
SCPI/IEEE488.2 contrib library
-
async-opcua-crypto
OPC UA cryptography library
-
libgreat
Pure rust implementation of Great Scott Gadgets' libgreat communications protocol
-
lpc11uxx
Register mappings for the NXP LPC11Uxx family of ARM Cortex-M0+ microcontrollers
-
sb-rotary-encoder
Rotary encoder processor for embedded systems
-
nucleo-l031k6-bsp
Board support crate for the ST L031K6-NUCLEO
-
max3263x
svd2rust generated peripheral crate for the max3263x
-
himipi-sys
Hi35XX MIPI API for Rust unsafe bindings
-
esp-idf-sys
Bindings for ESP-IDF (Espressif's IoT Development Framework)
-
svd2html
Generates a webpage for a given SVD file containing details on every peripheral and register and their level of coverage
-
signalo_sinks
A collection of filters used in 'signalo' umbrella crate
-
embedded-nrf24l01-async
A driver for NRF24L01(+) transceivers on embedded-hal-async platforms(base on embedded-nrf24l01)
-
ppproto
Point-to-Point Protocol (PPP) for embedded systems.
no-std
compatible, no alloc (heap) required. -
easy_esp
Wrapper around socket functionality to make using devices safer and easier
-
xdevs-no-std
no-std implementation of xDEVS for real-time simulation on embedded systems
-
oxide-spark
enables sensor sampling & LED strips control over Wifi/MQTT on ESP Rust Board
-
rt-rtai
rtai
-
nrf51-pac
Peripheral Access Crate for Nordic's nrf51 microcontroller
-
linuxfb
Interface to the Linux Framebuffer API
-
efm32gg-hal
HAL for the EFM32GG (EFM32 Giant Gecko) family of microcontrollers
-
com_logger
Serial port logger through COM ports
-
udatatable
creating data tables in an embedded no_std environment without an allocator
-
esp-hal-embassy
Embassy support for esp-hal
-
atsamd11d
Peripheral access API for ATSAMD11D microcontrollers (generated using svd2rust)
-
sparreal-rt
Sparreal OS kernel
-
mcp23017-driver
A comprehensive Rust driver for the Microchip MCP23017 IO expander
-
smart-leds-matrix
DrawTarget implementation for smart led based matrixes. It allows the usage of the embedded-graphics Drawables.
-
aya-ufmt
A fork of
ufmt
tweaked to play nice with the eBPF kernel verifier -
jh71xx-pac
Peripheral access crate for the JH71xx SoCs
-
drone-stm32-map
STM32 peripheral mappings for Drone, an Embedded Operating System
-
embedded-list
A list component for embedded-graphics
-
atomic-pool
Statically allocated pool providing a std-like Box
-
plan9_asm
Plan9 Assembly wrapper
-
max3010x
Platform-agnostic Rust driver for the MAX3010x high-sensitivity pulse oximeter and heart-rate sensor for wearable health
-
ch58x
Device support crates for CH58X devices
-
d3xs
Physical access control (daemon)
-
dwm1001
Board Support Crate for the Decawave DWM1001 module and development board
-
cs47l63
driver for the CS47L63 DSP
-
lsm303c
A platform agnostic driver to interface with the LSM303C (accelerometer + compass)
-
ethercat-sys
Binding to the Etherlab open-source EtherCAT master
-
r3_support_rza1
Supporting package for running R3-OS on Renesas RZ/A1
-
max2034x
Driver crate for the MAX20343/MAX20344 family of buck/boost converters
-
tb6612fng
A
no_std
driver for the TB6612FNG motor driver -
eeprom
emulation on top of FLASH for STM32
-
rustos
Writing an OS in Rust
-
trussed
Modern Cryptographic Firmware
-
kea-hal
HAL for NXP KEA devices
-
drmem-drv-sump
DrMem driver which monitors a sump pump
-
bma400
A platform-agnostic Rust driver for the BMA400 12-bit ultra-low-power 3-axis accelerometer
-
scsi
A
no-std
library for easily interfacing with SCSI-based storage devices -
ms8607
A platform agnostic driver for the MS8607 Pressure, Temperature, and Humidity Sensor from TE Connectivity
-
embedded-io-async
Async embedded IO traits
-
cu40026
display driver for the CU40026 vacuum fluorescent display (VFD)
-
sensor-temp-humidity-sht40
Driver for SHT40 temperature and humidity sensor
-
stm32f1xx-hal
HAL for the STM32F1xx family of microcontrollers
-
bluenrg
Interface to ST Micro BlueNRG Bluetooth radios
-
rainmaker
ESP RainMaker Agent
-
alt-stm32f30x-hal
Alternative HAL impl for the STM32F30x family of microcontrollers
-
esp-display-interface-spi-dma
Rust Bare Metal SPI Display Interface with DMA support for ESP32 chips
-
dwt-systick-monotonic
RTIC Monotonic implemenation based on Systick and DWT
-
femtopb-build
A code generator for
femtopb
-
std-embedded-time
embedded-time Clocks using std::time
-
embedded-dma
Traits to aid in the creation of sound DMA abstractions
-
nstd-sys
Cross platform general purpose C library written in Rust
-
sevseg_3642bs
Driver crate for the 3642BS seven segment display
-
NBC_cli
A CLI for NavasotaBrewing/brewdrivers
-
tcs3472
Platform-agnostic Rust driver for the TCS3472 RGB color light to digital converter with IR filter
-
pico_gpio
PicoGPIO is a tool to turn a raspberry pi pico into a decently powerful GPIO port
-
jetgpio
Peripheral Abstraction Layer for Jetson Nano Devices
-
sketchbook
Interactive visual applications in Rust
-
embassy-usb-logger
log
implementation for USB serial usingembassy-usb
-
tmp451
Platform-agnostic Rust driver for the TMP451 remote and local temperature sensor
-
senml-deser
serialization and deserialization using SenML specifications
-
defmt-brtt
Defmt logs over RTT as well as through a BBQueue
-
riscv_emu_rust
RISC-V emulator written in Rust
-
mpfs-pac
Peripheral Access Crate for PolarFire SoC
-
elf
A pure-rust library for parsing ELF files
-
msp430-rt
Minimal runtime / startup for MSP430 microcontrollers
-
defmt-semihosting
Transmit defmt log messages over the Cortex-M Semihosting protocol
-
atsamd21e
Peripheral access API for ATSAMD21E microcontrollers (generated using svd2rust)
-
panic-msp430
Halting panic implementation for MSP430 microcontrollers
-
bytex
8bit helper functions, mostly for AVR
-
st7567_rs
ST7567 LCD driver with embedded-graphics support
-
embedded-hal-async
An asynchronous Hardware Abstraction Layer (HAL) for embedded systems
-
wasefire-scheduler
Wasefire scheduler
-
stak-util
Stak Scheme utilities
-
pl011-uart
A driver for the Arm PL011 UART
-
font_7seg
7セグメントLED風数字フォント
-
mcp23017-tp
Rust Driver for device MCP23017 16-Bit I2C I/O Expander with Serial Interface
-
hitde-sys
Hi35XX TDE API for Rust unsafe bindings
-
microbit-text
Scrolling text on a 5×5 (micro:bit) display
-
stm32h5-staging
Device support crates for STM32H5 devices
-
r3_port_riscv
RISC-V port for the R3-OS original kernel
-
embassy-usb-synopsys-otg
embassy-usb-driver
implementation for Synopsys OTG USB controllers -
nrf-dfu-target
Nordic nRF DFU protocol for devices
-
svd-rs
A CMSIS-SVD base structures
-
reg-map
Derive volatile accesses to a register map and memory-mapped IO
-
spl_tool
Port of StarFive's C spl_tool with default support for VisionFive2
-
async-gcode
An async gcode parser for no_std targets
-
bmp280-ehal
A platform agnostic driver to interface with the BMP280 pressure sensor
-
sensd
The ultimate data logger and control system
-
miracl32
version of miracl/core for 32-bit no_std platforms
-
lpc55-pac
Peripheral access API for NXP LPC55 microcontrollers
-
axp20x
Rust driver for axp20x Power Management Unit
-
simp_protocol
simplistic protocol to communicate over serial ports. It supports ack, automated escaping and unescaping of special bytes and checksum error detection.
-
saks
Swiss Army Knife Shield for Raspberry Pi
-
liboscore-cryptobackend
libOSCORE's cryptographic primitives backend based on Rust implementations
-
rustberry-poe-monitor
PoE Monitor for Raspberry Pi Waveshare PoE HAT (B)
-
pcie
driver for enumerating devices
-
is25lp064a
An embedded-hal driver for the IS25LP064A
-
touch-selection
Selection data structure intended for touch and single button devices
-
bxcan
STM32 bxCAN peripheral driver
-
embedded-sht3x
Platform-agnostic Rust driver for the SHT3x temperature and humidity sensors
-
mp2667
Platform agnostic Rust driver for the MP2667, highly integrated, single-cell, Li-ion/Li-polymer battery charger IC
-
async-opcua-core-namespace
OPC UA generated code for the core namespace
-
openmv_h7_bsp
Board support crate for OpenMV H7 machine vision board
-
vhost-device-i2c
vhost i2c backend device
-
herkulex-drs-0x01-stm32f1xx
A driver for servomotors Herkulex DRS-0101 and DRS-0201 using USART on stm32f1xx
-
vin-info
VIN (Vehicle identifier number) parser
-
drone-core
The core crate for Drone, an Embedded Operating System
-
esp-config
Configure projects using esp-hal and related packages
-
tinymqtt
A very tiny no-std MQTT client, mainly for embedded systems
-
rn4870
A platform agnostic driver for the RN4870 BLE module
-
ector
open source async, no-alloc actor framework for embedded devices
-
adi-adxl355-async
An embedded-hal-async driver for the ADXL355 accelerometer
-
wasm-embedded-rt
Runtime for embedded-wasm applications
-
lpc55
Host-side tooling to interact with LPC55 chips via the ROM bootloader
-
klogger
logging in kernel mode
-
ds18b20
temperature sensor driver for embedded-hal
-
gd32e2
Device support crate for GD32E2 devices
-
ublox-short-range-rs
Driver crate for u-blox short range devices, implementation follows 'UBX-14044127 - R40'
-
da14683-pac
Peripheral Access Crate (PAC) for DA14683
-
ellie_renderer_utils
Ellie Renderer contains utilities cli apps such as elliec
-
minireq
Lightweight support for MQTT-based request/response handling interfaces
-
ghostfat
Virtual FAT16 file system for embedded USB Mass Storage Device use
-
ht32f1yyy
Device support crates for HT32F1YYY devices
-
ibus-rs
A no_std compatible IBUS RC protocol parser for embedded systems
-
urukul
Sinara Urukul quad 1 GHz DDS driver
-
espsign
signing ESP32 firmware images for ESP RSA Secure Boot V2
-
gdb-server
A gdb stub implementation for on chip debugging and flashing of ARM chips
-
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
-
num-align
Some hal for os
-
tock/riscv-csr
RISC-V CSR interface developed for Tock
-
bitwrap_extra
pack/unpack data into byte array
-
at32f4xx-pac
Device support crates for AT32F4 devices
-
sensor_lib_as5600
A driver for the AS5600 sensor module
-
iso7816_tx
ISO7816 Smart Card T=1 Transmission protocol
-
lora-e5-bsp
Board support package for the seeed LoRa-E5 development kit
-
edid-rs
An EDID parsing crate with no_std support
-
rtic-time
Basic definitions and utilities that can be used to keep track of time
-
longan-nano
Board support package for the Longan Nano board
-
w5500-dhcp
DHCP client for the Wiznet W5500 internet offload chip
-
fe_rtos
OS for Arm Cortex-M CPUs
-
cyw43
Rust driver for the CYW43439 WiFi chip, used in the Raspberry Pi Pico W
-
embassy-time-queue-utils
Timer queue driver trait for embassy-time
-
zerocrush
Low-overhead compression for sparse files
-
atsam4n8c-pac
Peripheral access crate for the ATSAM4N8C microcontroller
-
bhi160
driver for the Bosch Sensortec BHI160(B) smart sensors
-
gbl
GBL firmware file handling library
-
ral
Base layer for generated libraries for specific MCUs
-
r3_portkit
writing a port of R3
-
edge-nal-std
A STD implementation of edge-nal based on
async-io
-
signalo_sources
A collection of filters used in 'signalo' umbrella crate
-
imxrt-dma
DMA driver for i.MX RT processors
-
atsams70q19b
Peripheral access API for the ATSAMS70Q19B MCU from Microchip (generated using svd2rust 0.33.5)
-
r3_port_arm
Armv7-A port for the R3-OS original kernel
-
ublox-sockets
Common sockets layer for host-based ublox devices
-
drone-nrf-map
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
ruspiro-console
Lightweight console abstraction for bare metal implementations to print strings to an output channel that could be easely configured/attached
-
xdrk
open XRK and DRK files, produced by AiM devices
-
esp32c6
Peripheral access crate for the ESP32-C6
-
sparreal-kernel
Sparreal OS kernel
-
unmp-id
unmp
-
teensy4-panic
Panic handler for the Teensy 4. Part of the teensy4-rs project
-
jt808-rs
JT808 protocol
-
heatshrink-bin
A minimal library implementing the heatshrink compression algorithm for no_std environments
-
max32660
Register mappings for the Analog Devices MAX32660 Cortex-M4 microcontroller
-
atsaml21e18a
Device crate for the Microchip ATSAML21E18A, generated from its SVD file
-
vcnl36825t-rs
Vishay VCNL36825T proximity sensor driver for embedded-hal i2c traits
-
va416xx-hal
HAL for the Vorago VA416xx family of MCUs
-
max112x
Driver for the 24-bit MAX11214 and similar ADCs
-
memory-lcd-spi
A driver for Sharp's Memory LCD or JDI's Memory In Pixel display, LPM013M126A, LPM009M360A, LS027B7DH01, etc
-
lps28dfw
Platform-agnostic Rust driver for the LPS28DFW pressure sensor
-
xmc4300
XMC peripheral library for XMC4300 generated from SVD
-
cortex-m-interrupt
Function-like, trait-based interrupt handler registration
-
dps310
A platform agnostic driver to interface with the DPS310 barometric pressure & temp sensor through I2C
-
push2_display
Ableton Push2 Embedded-graphics display driver
-
gd32c1x3-hal
HAL for the GD32C1x3 family of microcontrollers
-
blinq
An embedded-hal blinking queue
-
opcua-server
OPC UA server API
-
led
Various LED implementations built on the embedded-hal traits
-
armv6-m-instruction-parser
parsing ARMv6-M thumb instructions. Usefull for decompilition and emulation etc.
-
akafugu_twidisplay
Platform-agnostic Rust driver for the NXP PCF8563 real-time clock
-
p256-cm4
P256-Cortex-M4 re-written in rust
-
n32g4xx-hal
Peripheral access API for N32G4xx series microcontrollers
-
embedded-drivers
Platform-agnostic Rust drivers for BME280/BMP280/BMP180, LM75, PMSx003
-
avr-mcu
Pragmatic structures for all AVR microcontrollers
-
si7021-t-rh
Si7021 driver (7013, 7020 and 7021)
-
nrf24radio
Asynchronous embedded driver for NRF24L01(+) devices
-
opcua-types
OPC UA types and constants
-
mcp23s17-async
Asynchronous MCP23S17 driver A driver for the MCP23S17 16 bit I/O expander chip addressed over an asynchronous SPI bus
-
cynthion
Great Scott Gadgets Cynthion USB Test Instrument
-
ekv
Key-value database for embedded systems, for raw NOR flash, using an LSM-Tree
-
cstream
libc::FILE
streams ‘c streams’ -
ws2812-nrf52833-hal-pwm
nrf52833 PWM driver for ws2812 leds
-
xmc4800
XMC peripheral library for XMC4800 generated from SVD
-
tockloader-proto
A #[no_std] implementation of the protocol used by tockloader and the TockOS bootloader
-
juggle
Async task switching for cooperative multitasking in single thread environments with no_std support
-
canadensis_bxcan
Bridge between Canadensis and the BXCAN peripherals found in some microcontrollers
-
embassy-net-adin1110
embassy-net driver for the ADIN1110 ethernet chip
-
imxrt-uart-panic
Panic handler for i.MX RT that reports to UART
-
bbqueue-sync
A SPSC, lockless, no_std, thread safe, queue, based on BipBuffers
-
esp32c2
Peripheral access crate for the ESP32-C2
-
esp32-wroom-rp
Rust-based Espressif ESP32-WROOM WiFi driver crate for RP2040 series microcontroller boards
-
postform_persist
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
sht25
Rust driver for SHT25 temperature/humidity sensor
-
trussed-hkdf
HKDF extension for trussed
-
eeprom25aa02e48
Platform-agnostic Rust driver for the 25AA02E48 EEPROM
-
systick-monotonic
RTIC Monotonic implementation based on SysTick
-
minimult_cortex-m
A minimal multitask library, or RTOS, for Cortex-M microcontrollers
-
lbfgs
L-BFGS algorithm
-
serial-settings
Embedded device settings management over serial terminal and flash
-
cortex-m-log
Logging facilities for Cortex-M processors
-
utrace
Instrumentation-based profiling library for embedded targets with async support
-
ruspiro-mmio-register
macros to conviniently define memory mapped I/O (MMIO) registers
-
ham-cats
Reference implementations for CATS, the ham radio protocol
-
msp430g2211
Peripheral access API for MSP430G2211 microcontroller
-
light-control
mqtt light control
-
esp_idf_build
Build scripts helpful when working with ESP-IDF
-
tinkerforge-async
Async Rust API bindings for https://www.tinkerforge.com Bricks and Bricklets, based on Version: 2.0.20
-
lpc81x-pac
Device support crates for LPC81X-PAC devices
-
lcd1604_gpio
Abstraction layer for interfacing between Raspberry Pi and 16x2 or 16x4 LCD display modules through GPIO
-
serial-sensors-proto
wire format for transmitting MEMS sensor data and friends
-
hpm-riscv-rt
Low level access to HPMicro's RISC-V processors
-
the-bridge
Efficient Binary Protocol Bridge for std and no_std Environments
-
ch32v0
Device support crates for CH32V0 devices
-
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.
-
ral-registers
MMIO registers abstraction with a macro API
-
async-embedded-sdmmc
Embedded sdmmc driver with async support
-
drone-stm32-map-svd
STM32 SVD to bindings for Drone, an Embedded Operating System
-
embedded-midi
embedded hal uart to send and receive midi
-
stm32g0-staging
Device support crates for STM32G0 devices
-
sw3526
driver based on embedded-hal. Support
async
andsync
features. -
rucos-cortex-m
A port of the RuCOS kernel to ARM Cortex-M
-
groundhog
A rolling timer abstraction
-
avr-simulator
Oxidized interface for simavr
-
rtic-syntax
The Real-Time Interrupt-driven Concurrency (RTIC) meta language
-
sequential-storage
storing data in flash with minimal erase cycles
-
neotron-api
The API between Neotron OS and Neotron applications
-
embedded-can
HAL traits for Controller Area Network (CAN) devices
-
gihex-hc-sr04
access HC-SR04 ultrasonic sensor
-
nucleo-h743zi
Example programs for nucleo-H743zi and nucleo-H743zi2 boards
-
pudding-kernel
RealTime-OS Kernel
-
pcal6416a
Platform-agnostic Rust driver for the Texas Instruments BQ25773 battery charge controller
-
critical-section-lock-mut
Provide locks for mutable data using
critical-section
crate -
mh-z19
serial protocol for Winsen MH-Z19 / MH-Z19B / MH-Z14 CO2 sensors
-
neokey_trinkey
Board Support crate for the Adafruit Neokey Trinkey
-
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 -
st7789-lcd
ST7789 TFT LCD driver with embedded-graphics support
-
mdev-parser
Parse the Busybox mdev configuration file
-
threadx-rs
Safe Rust Bindings for ThreadX using threadx-sys
-
wasm-embedded-spec
Embedded WASM WITX specification
-
embedded-nal-minimal-coaptcpserver
A minimal CoAP-over-TCP server implementation built on embedded-nal
-
cyw43-pio
RP2040 PIO SPI implementation for cyw43
-
da14682-pac
Peripheral Access Crate (PAC) for DA14682
-
rfm69
A generic rust driver to support RFM69 family wireless chips
-
neorv32-rt
NEORV32 runtime support for Rust
-
atsamd51g
Peripheral access API for ATSAMD51G microcontrollers (generated using svd2rust)
-
oxy-linux-pwm
controlling the PWM on the linux
-
stm32g0
Device support crates for STM32G0 devices
-
l3gd20
A platform agnostic driver to interface the L3GD20 (gyroscope)
-
adafruit-lcd-backpack
Unofficial driver for the Adafruit I2C LCD backpack
-
serialmessage
Pack serial data into a fast, reliable, and packetized form for communicating with e.g. a Microcontroller.
-
avr-config
An AVR foundational crate for retrieving details, such as the CPU clock frequency, at runtime
-
wasefire-cli
Wasefire CLI to manage applets and platforms
-
drmem-drv-ntp
DrMem driver which monitors ntpd daemons
-
onewire
using embedded_hal as abstraction layer, based on arduino OneWire library. WIP
-
wasefire-protocol
Wasefire protocol between platform and host
-
rvvm
idiomatic RVVM Rust bindings
-
mcp230xx
MCP23008/MCP23017 8/16-Bit I2C I/O Expander with I2C Interface
-
edge-frame
Yew & Wasm-based user interface for microcontrollers
-
stm32l4xx-hal
Hardware abstraction layer for the stm32l4xx chips
-
wasefire-board-api
Wasefire board API
-
emb-ssdraw
embedded screen saver that draws random points on a display
-
eds
Easy data separator
-
pirate-midi-rs
send serial commands to pirate midi bridge devices
-
linux-raw-vdso
Linux vDSO parser for all the architectures
-
sound_find
Find the device by playing a sound
-
liboscore
Rust wrapper around the libOSCORE implementation of OSCORE (RFC8613), a security layer for CoAP
-
atsam4n8b-pac
Peripheral access crate for the ATSAM4N8B microcontroller
-
blinker
easily creating async blinky programs for embedded systems
-
gd32e1
Device support crate for GD32E1 devices
-
rtos-trace
RTOS tracing trait
-
nmos6502
A no_std compliant NMOS6502 emulator suitable for embedded environments
-
efm32gg12b-pac
Peripheral access API for EFM32GG12B MCU (generated using svd2rust)
-
encoded_pin
Binary encoded OutputPin, e.g. for encoded SPI chip select
-
esptools
(esptool, espsecure and espefuse) bundler
-
alazar
randomness
-
tinywasm-parser
TinyWasm parser
-
stm32f407g-disc
Board support crate for the STM32F407G DISCOVERY microcontroller board
-
arduino
Reusable components for the Arduino Uno
-
embedded-error-chain
Easy error handling in no-alloc and no-std environments
-
tinywasm-types
TinyWasm types
-
scoped-mutex
An abstraction over closure-based mutexes
-
rs-matter
Native Rust implementation of the Matter (Smart-Home) ecosystem
-
bl602-sdk
Rust Wrapper for BL602 IoT SDK
-
nrf52840
Peripheral access API for nrf52840 microcontrollers
-
cortex-m-rt
Minimal runtime / startup for Cortex-M microcontrollers
-
pudding-pac
Peripheral Access Crate
-
ufmt-write
μfmt
’suWrite
trait -
drogue-bme680
interface with the BME680 environmental sensor
-
gd32f3
Device support crates for GD32F3 devices
-
figments
A high performance graphics API for microcontrollers
-
mcxn947-pac
Peripherals Access Crate for NXP mcxn947
-
i2c-write-iter
Exports iterator based parallels to embedded-hal & embedded-hal-async for Write & WriteRead
-
palloc
portable linked-list allocator for baremetal systems
-
embedded-sensors-hal
A HAL for various peripheral sensors
-
r3_support_rp2040
Supporting package for running R3-OS on RP2040
-
rtt-logger
An rtt-target logger implementation for Cortex-M embedded platforms
-
ir-remote
Create a programatic IR remote to control devices
-
atsams70n19b
Peripheral access API for the ATSAMS70N19B MCU from Microchip (generated using svd2rust 0.33.5)
-
bme280-rs
query BME280 sensors over I²C
-
rust-mqtt
MQTT client for both embedded and non-embedded devices
-
lpc55-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
anachro-forth-core
A forth-inspired, bytecode-compiled scripting language for Anachro Powerbus
-
bmi160
Platform-agnostic Rust driver for the BMI160 inertial measurement unit (IMU)
-
d1-pac
Peripheral access API for Allwinner D1 SoC generated from unofficial SVD file
-
embedded-storage-async
A Storage Abstraction Layer for Embedded Systems
-
rdrive-macros
macros for rdrive
-
anpp
Advanced Navigation Packet Protocol
-
stm32f1
Device support crates for STM32F1 devices
-
apds9151
platform agnostic Rust driver for the APDS9151 Digital Proximity and RGB Color I2C Sensor
-
async-pool
Statically allocated pool providing a std-like Box, with async functionality
-
stm32f3xx-hal-v2
Peripheral access API for STM32F3 series microcontrollers
-
opcua-client
OPC UA client API
-
rv-decoder
A RISC-V instruction decoder
-
svd-encoder
A CMSIS-SVD file encoder
-
nrfxlib-sys
Rust bindings to the Nordic nRF91* Socket Library
-
mnemos-userspace
A tiny embedded operating system userspace library
-
external-memory-tools
HAL to keep data in memory that could not be directly mapped to RAM
-
sh1106
I2C/SPI driver for the SH1106 OLED display controller
-
atsamd51p
Peripheral access API for ATSAMD51P microcontrollers (generated using svd2rust)
-
cntrlr
async embedded framework
-
postform_serial
Decodes persistent logs for Postform, an efficient logging framework for mcu's
-
stm32f1xx-lal
LAL for the STM32F1xx family
-
axp192
A driver for the AXP192 power management IC
-
pico_pll_config
PLL configuration macro for the Raspberry Pi Pico
-
xca9548a
Platform-agnostic Rust driver for the TCA954xA and PCA954xA I2C switches/multiplexers
-
rucos
Rust Microcontroller Operating System (RuCOS) Kernel
-
rpi-mh-z19c-exporter
Export CO2 concentration measured with a Winsen MH-Z19C sensor on a Raspberry Pi to Prometheus
-
atsam4n16b-pac
Peripheral access crate for the ATSAM4N16B microcontroller
-
avr-boot
Self Programming functions for AVR MCUs
-
esp-idf-part
parsing and generating ESP-IDF partition tables
-
mwatch_kernel
A embedded 'Smart' watch
-
efm32hg309f64-pac
Peripheral Access Crate for EFM32HG309 series MCU from Silicon Labs
-
icm42670
An embedded-hal driver for the ICM-42670 6-axis IMU
-
lm4f120
A set of drivers for writing bare-metal code for the Texas Instruments LM4F120
-
rusty-os
kernel for embedded systems written in Rust
-
rtcc
Real-time clock / calendar (RTC / RTCC) traits
-
redox_dmi
DMI table parser
-
cortex-ar
CPU support for AArch32 Arm Cortex-R and Arm Cortex-A
-
smoltcp-slip
SLIP network interface on top of smoltcp
-
atsaml21j17bu
Device crate for the Microchip ATSAML21J17BU, generated from its SVD file
-
probe-rs-cli-util
Helper library for CLI applications based on probe-rs
-
imxrt-log
Logging extensions for i.MX RT processors
-
gd32f2
Device support crate for GD32F2 devices
-
embedded-picofont
The PICO-8 font to use with embedded-graphics
-
riscv-semihosting
Semihosting for RISCV processors
-
bmp085-180-rs
Driver for BMP085 & BMP180 sensors
-
stm32f429
Peripheral access API for STM32F429 microcontrollers
-
rdrive-macro-utils
A dyn driver manager
-
opensensor
streaming and archiving measurements from sensors
-
nrf-softdevice
Rust interface to nRF SoftDevice
-
drmem-drv-tplink
DrMem driver for TP-Link devices
-
lilos-handoff
Synchronous rendezvous structure for lilos
-
phidget-sys
Low-level, unsafe, Rust wrapper for the phidget22 library
-
deforest
efficient
#![no_std]
parser for devicetree blobs -
rp235x-pac
A Peripheral Access Crate for the Raspberry Pi RP235x microcontrollers
-
esp-embassy-wifihelper
helper library to make it easier to connect to wifi with esp-embassy
-
edge-mqtt
Implements the embedded-svc MQTT traits on top of the rumqttc crate
-
n64-pac
low-level CPU and register abstractions for the Nintendo 64 console
-
atsamd21j
Peripheral access API for ATSAMD21J microcontrollers (generated using svd2rust)
-
da14681-pac
Peripheral Access Crate (PAC) for DA14681
-
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
-
l3gd20-ng
A platform agnostic SPI driver to interface with the L3GD2 gyroscope
-
embedded-nal-minimal-coapserver
A minimal CoAP server implementation built on embedded-nal
-
ms5611-i2c
no_std Library for the MS5611 barometric pressure sensor only for I2C with embassy
-
aemics-stm32g4xx-hal
Hardware abstraction layer (HAL) for STM32G473
-
push2_pong
Ableton Push2 Embedded-graphics display driver
-
itm
A decoding library for the ARM Cortex-M ITM/DWT packet protocol
-
canadensis_encoding
A Cyphal implementation: Transfer encoding and decoding
-
ralte32
Arithmetic Library Testing Environment for embedded RISC-V 32-bit
-
max32660-pac
Peripheral access API for MAX 32660 microcontroller
-
mstak-util
Minimal Stak Scheme utilities
-
signalo_pipes
A collection of pipes used in 'signalo' umbrella crate
-
stm32h7-staging
Device support crates for STM32H7 devices
-
tmledkey-hal-drv
HAL based driver for Titan Micro 7 segment LED controllers and key scanners
-
rs-usbtmc
USBTMC driver written in Rust
-
nutp
The New UART Transfer Protocol
-
esp32h2
Peripheral access crate for the ESP32-H2
-
framed
Send and receive data over lossy streams of bytes
-
megamorse
morse code translator
-
lcd1602_gpio
Abstraction layer for interfacing between raspberry pi and the lcd1602 - 16x2 lcd display module through GPIO
-
bh1730fvc
no-std driver for the BH1730FVC ambient light sensor
-
defmt-json-schema
defmt JSON schema
-
soft-i2c
Soft i2c for any open drain pin
-
aarch64-esr-decoder
command-line utility for decoding aarch64 Exception Syndrome Register values
-
drone-stm32-map-periph-gpio
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsame51g
Peripheral access API for ATSAME51G microcontrollers (generated using svd2rust)
-
stmpe1600
Platform-agnostic Rust driver for the STMPE1600 I/O expander
-
py32f030_hal
Peripheral Hal Crate for Puya's PY32F030 microcontroller
-
tock/tock-cells
A secure embedded operating system for microcontrollers
-
coap-zero
CoAP protocol implementation for no_std without alloc
-
aht20-async
A platform agnostic driver to interface with the AHT20 temperature/humidity sensors
-
embedded-qmp6988
Platform-agnostic Rust driver for the QMP6988 barometric pressure sensor
-
w5500-regsim
Register simulation for the Wiznet W5500 internet offload chip
-
ruspiro-singleton
easy to use singleton pattern
-
efm32gg11b-pac
Peripheral access API for EFM32GG11B MCU (generated using svd2rust)
-
epd
Drivers for EPD(E-Paper Displays), WIP
-
mcp4x
Platform-agnostic Rust driver for the MCP4x digital potentiometers
-
probe-rs-mi
The probe-rs machine interface for computers interfacing probe-rs
-
riscv-rt-macros
Attributes re-exported in
riscv-rt
-
probe-rs-t2rust
A collection of ARM chips for the
probe-rs
crate -
byte-slab
A statically allocated slab of bytes
-
atsame53n
Peripheral access API for ATSAME53N microcontrollers (generated using svd2rust)
-
hal_sensor_dht
A Embedded HAL driver for the DHT humidity and temperature sensors
-
atsame53j
Peripheral access API for ATSAME53J microcontrollers (generated using svd2rust)
-
atsame51j
Peripheral access API for ATSAME51J microcontrollers (generated using svd2rust)
-
is31fl3731
Driver for Lumissil Microsystem's IS31FL3731 IC
-
gfx-xtra
embedded-graphics xtras
-
chyyuu/os
OS kernel labs based on Rust/C Lang & RISC-V 64/X86-32
-
riscv-asm
A WIP, simple-to-use assembler and disassembler for
riscv32i-unknown-none-elf
targets -
bluerepl
A ble client running in the terminal
-
ht32f5xxxx
Device support crates for HT32F5XXXX devices
-
vorago-peb1
Board Support Crate for the Vorago PEB1 development board
-
blue_hal
Embedded Hardware Abstraction Layer
-
lpc546xx-hal
Peripheral access API for LPC546xx series microcontrollers
-
signalo_traits
A collection of traits used in 'signalo' umbrella crate
-
nrf52810-hal
HAL for nRF52810 microcontrollers
-
block_device
BlockDevice trait
-
stm32f3-staging
Device support crates for STM32F3 devices
-
lpc11xx
Register mappings for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
ch32v1
Device support crates for CH32V1 devices
-
max116xx-10bit
Driver crate for the MAX116xx 10-bit ADC devices
-
stm32g4
Device support crates for STM32G4 devices
-
xtensa-lx-rt
Minimal startup/runtime for Xtensa LX CPUs
-
d3xs-protocol
Physical access control (protocol)
-
stm32f7
Device support crates for STM32F7 devices
-
stm32-usbd2
'usb-device' implementation for STM32 microcontrollers
-
atsams70n20b
Peripheral access API for the ATSAMS70N20B MCU from Microchip (generated using svd2rust 0.33.5)
-
hardware-registers
Generic, embedded-friendly hardware registers support, including traits and types for understanding I2C registers
-
tmag5170
A platform agnostic driver to interface with the TMAG5170-Q1 (3D hall sensor)
-
dummy-pin
Dummy implementations of the input/output pin embedded-hal traits
-
lpc546xx-pac
Device support crates for LPC546XX-PAC devices
-
riscv-target
RISC-V target string manipulation utilities
-
micropb-gen
Generate Rust module from Protobuf files
-
w5500-sntp
SNTP client for the Wiznet W5500 internet offload chip
-
drogue-ajour-protocol
A firmware update protocol designed for embedded devices
-
bme68x-rust
interacting with Bosch BME68x chips over I2C and SPI
-
embedded-nal-async
An Async Network Abstraction Layer (NAL) for Embedded Systems
-
pcf857x
Platform-agnostic Rust driver for the PCF8574, PCF8574A and PCF8575 I/O expanders
-
atsam4ls2a-pac
Peripheral access crate for the ATSAM4LS2A microcontroller
-
mik32-rt
Minimal runtime / startup for MIK32 MCUs, managed by the mik32-rs team
-
tfmicro
Rust bindings of TensorFlow Lite for Microcontrollers
-
bme280-multibus
BME280 driver with support for SPI and I2C
-
sx1509-eh
An embedded-hal focused driver for the SX1509 GPIO expander
-
da14586-pac
Peripheral Access Crate (PAC) for DA14586
-
mk20d7-hal
HAL for the MK20D7 family of microcontrollers
-
embedded-mogeefont
Pixel font for embedded-graphics
-
mwatch-kernel-stm32l4
A embedded 'Smart' watch
-
littlefs2-sys
Low-level bindings to littlefs
-
neotron-bmc-protocol
The SPI protocol supported by the Neotron BMC
-
embassy-boot-nrf
Bootloader lib for nRF chips
-
nuttx-embedded-hal
Rust Embedded HAL for Apache NuttX RTOS
-
esp-metadata
Metadata for Espressif devices
-
teensy4-fcb
FlexSPI Configuration Block (FCB) for the Teensy 4. Part of the teensy4-rs project
-
scoped-mutex-traits
An abstraction over closure-based mutexes
-
atsaml22j
Peripheral access API for ATSAML22J microcontrollers (generated by svd2rust)
-
ArmlabRadio
interfacing with CC1200 Radios
-
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
-
stm32l4x6
Memory map for STM32L4x6 microcontrollers
-
topq
A Timeout Priority Queue
-
p256-cortex-m4
Idiomatic, misuse-resistent bindings to P256-Cortex-M4
-
embassy-net-enc28j60
embassy-net driver for the ENC28J60 ethernet chip
-
coap-request
Interface to CoAP requests
-
std-embedded-nal-async
embedded-nal-async
traits for large devices that support the standard library -
phm-icd
The Interface Control Document (ICD) for Pretty HAL Machine
-
xgzp6897d
i2c Driver for the XGZP6807D differential pressure sensor
-
ltr-559
LITEON LTR-559 ligth and proximity sensor
-
cmim
Move your data to interrupt context
-
mips-mcu-alloc
A heap allocator for MIPS based microcontrollers
-
efm32wg-pac
Peripheral access API for EFM32WG MCU (generated using svd2rust)
-
atsaml21g17b
Device crate for the Microchip ATSAML21G17B, generated from its SVD file
-
wasefire-protocol-usb
Wasefire USB protocol between platform and host
-
emstr
Helpers for working with string types for embedded devices
-
drone-cortex-m
ARM® Cortex®-M platform crate for Drone, an Embedded Operating System
-
nrf52832-pac
Peripheral Access Crate for Nordic's nrf52832 microcontroller
-
opcua-console-logging
Logging to the console for OPC UA used by client and server
-
msp430fr2355
Peripheral access crate for MSP430FR2355 microcontroller
-
ch32v2
Device support crates for CH32V2 devices
-
atsamd11c
Peripheral access API for ATSAMD11C microcontrollers (generated using svd2rust)
-
nrf52833-pac
Peripheral Access Crate for Nordic's nrf52833 microcontroller
-
riscv-slic
RISC-V Software-Level Interrupt Controller
-
ina3221
Embedded driver for INA3221 triple-channel power monitor
-
xtensa-atomic-emulation-trap
An atomic emulation trap handler for non atomic Xtensa targets
-
ufmt-utils
μfmt
utilities -
nrfdfu
A flashing tool for the nRF bootloader
-
embedded-crc-macros
Macros implementing portable CRC calculation algorithms for use in no_std
-
chyyuu/user_lib
OS kernel labs based on Rust/C Lang & RISC-V 64/X86-32
-
arm-pl011-rs
PL011 UART driver
-
gd32e5
Device support crate for GD32E5 devices
-
wasefire-interpreter
Wasefire WebAssembly interpreter
-
ruspiro-uart
convinient access API to the Raspberry Pi 3 UART0 (PL011) and UART1 (miniUART) peripherals
-
ch32x0
Device support crates for CH32X0 devices
-
va108xx-embassy
Embassy-rs support for the Vorago VA108xx family of microcontrollers
-
avrox-display
Display drivers for the AVRoxide operating system
-
jtagdap
JTAG access to CMSIS-DAP compatible probes
-
no-std-async
Async synchronization primitives for #[no_std] rust
-
stm32f3-copterust
Device support crates for STM32F3 devices
-
atsamd51n
Peripheral access API for ATSAMD51N microcontrollers (generated using svd2rust)
-
bootkbd
Boot-protocol keyboard driver for usb-host
-
da14585-pac
Peripheral Access Crate (PAC) for DA14585
-
drone-stm32-map-periph-tim
STM32 peripheral mappings for Drone, an Embedded Operating System
-
sps30-i2c
Platform-agnostic Rust driver for the SPS30 particulate matter sensor
-
r3_kernel
The R3-OS original kernel
-
dht-hal-drv
HAL based driver for digital humidity and temperature sensors DHT11, DHT21, DHT22
-
tsic
Platform-agnostic access to TSIC sensors via embedded-hal
-
atsame70j21b
Peripheral access API for the ATSAME70J21B MCU from Microchip (generated using svd2rust 0.33.5)
-
zorio
Subset of standard library I/O ported to no_std
-
ruspiro-gpio
This crates provides a GPIO peripheral abstraction of the Raspberry Pi
-
nrf52840-dk-bsp
BSP for the nRF52840-DK
-
esp-ieee802154
Low-level IEEE 802.15.4 driver for the ESP32-C6 and ESP32-H2
-
mcp4725
Microchip MCP4725 DAC Driver for Rust Embedded HAL
-
atsam4ls2b-pac
Peripheral access crate for the ATSAM4LS2B microcontroller
-
edc2svd
Convert register description from the EDC format to the SVD format
-
lm75
Platform-agnostic Rust driver for the LM75 temperature sensor and thermal watchdog
-
peripherals
Microcontroller peripherals definition and ergonomic access
-
kolben
A collection of COBS
-
qingke-rt
Minimal runtime / startup for WCH's RISC-V MCUs, managed by the ch32-rs team
-
lpc550x
Register mappings for the NXP LPC550x/LPC55S0x family of Cortex-M33 microcontrollers
-
embassy-net-driver-channel
High-level channel-based driver for the
embassy-net
async TCP/IP network stack -
gd32f4
Device support crates for GD32F4 devices
-
nisty
NIST P256 signatures for Cortex-M4 microcontrollers
-
embedded-storage-inmemory
An in-memory implementation of embedded-storage
-
bern-arch
Bern RTOS hardware specific implementation
-
kll-core
KLL state-machine implementation focused on no_std embedded/bare-metal targets
-
usbd-ccid
usb-device driver for CCID
-
tm4c129x
Peripheral access API for TI TM4C129x microcontrollers
-
rdif-base
Driver Interface base definition
-
seeed-studio-relay-board
controlling the Seeed Raspberry Pi Relay Board
-
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
-
adxl345-eh-driver
Rust embedded-hal device driver for the ADXL345 Analog Devices Digital Accelerometer
-
r3_port_arm_m
Cortex-M port for the R3-OS original kernel
-
tm4c123x
Peripheral access API for TI TM4C123x microcontrollers
-
nvme-driver
nvme driver
-
emcell-macro
A macro crate for emcell
-
efm32tg-pac
Peripheral access API for EFM32TG MCU (generated using svd2rust)
-
msp430f249
Peripheral access API for MSP430F249 microcontroller
-
ovl-atsamx7x-hal
HAL and peripheral access API for ATSAME70 microcontrollers
-
lpc11xx-async-hal
Asynchronous HAL for the NXP LPC111x/LPC11Cxx/LPC11xxL/LPC11xxXL family of Cortex-M0 microcontrollers
-
ambiq-apollo4p-pac
Peripheral access API for Ambiq Apollo 4 Plus microcontrollers
-
stlog
Ultra lightweight logging framework for resource constrained devices
-
rza1
Peripheral access API for the Renesas RZ/A1 MPU family
-
lpc55s6x-hal
Hardware Abstraction Layer (HAL) for the NXP LPC55S6x ARM Cortex-33 microcontrollers
-
i2cdriver
Use Excamera I2CDriver and I2CMini devices from Rust, optionally via embeddded-hal traits
-
da14531
Peripheral access crate for the DA14531 microcontroller
-
kiibohd-usb
Kiibohd USB HID Interface
-
cortex-m-rtic
Real-Time Interrupt-driven Concurrency (RTIC): a concurrency framework for building real-time systems
-
atsame51n
Peripheral access API for ATSAME51N microcontrollers (generated using svd2rust)
-
percore
Safe per-CPU core mutable state on no_std platforms through exception masking
-
nrf52811-hal
HAL for nRF52811 microcontrollers
-
riscv-atomic-emulation-trap
An atomic emulation trap handler for non atomic RISC-V targets
-
nrf5340-app-hal
HAL for nRF5340 app SoC
-
arm-dcc
Debug Communication Channel (DCC) API
-
riscv-target-parser
Parser for RISC-V target specifications
-
noproto
no-std, no-alloc protocol buffers implementation for embedded systems
-
va416xx-embassy
Embassy-rs support for the Vorago VA416xx family of microcontrollers
-
neo_trinkey
Board Support crate for the Adafruit Neo Trinkey
-
wasefire-applet-api
Low-level Wasefire applet API
-
da14695-pac
Peripheral Access Crate (PAC) for DA14695
-
xuantie
Low level access to T-Head XuanTie RISC-V processors
-
embedded-trace
A Future tracing utility for embedded systems
-
kiibohd-hall-effect
Analysis crate for intepreting hall-effect keyboard switches (e.g. Silo Switches)
-
canadensis_pnp_client
Client library for Cyphal plug-and-play node ID allocation
-
atsam3x
Device support crates for ATSAM3X devices
-
embassy-net-esp-hosted
embassy-net driver for ESP-Hosted
-
imxrt1062-fcb-gen
Generate Firmware Configuration Block (FCB) for iMXRT1062 processors in Rust build scripts. This crate is unmaintained. Consider using imxrt-boot-gen…
-
atsame54n
Peripheral access API for ATSAME54N microcontrollers (generated using svd2rust)
-
tt21100
An embedded-hal driver for the TT21100 multi-touch touchscreen controller
-
microamp-tools
Build a μAMP application
-
erdnuss-comms
A small RS-485 comms protocol
-
ariel-os
An embedded library OS for the IoT
-
atsam4lc2a-pac
Peripheral access crate for the ATSAM4LC2A microcontroller
-
atsaml21g18b
Device crate for the Microchip ATSAML21G18B, generated from its SVD file
-
esp-riscv-rt
Minimal runtime / startup for RISC-V CPUs from Espressif
-
seven_segment
driver for seven segment displays
-
teensy3
Rust interface layer for the Teensy 3.1/3.2 microcontroller
-
nrf52810-pac
Peripheral Access Crate for Nordic's nrf52810 microcontroller
-
msp432p401r-pac
MSP432P401R Peripheral Access API (PAC)
-
atsams70j20b
Peripheral access API for the ATSAMS70J20B MCU from Microchip (generated using svd2rust 0.33.5)
-
embedded-sensors-hal-async
A HAL for various peripheral sensors (async)
-
bossa
Rust cxx wrapper around BOSSA SAM-BA library
-
efm32lg-pac
Peripheral access API for EFM32LG MCU (generated using svd2rust)
-
rp2040-monotonic
RTIC Monotonic implementation based on RP2040's Timer peripheral
-
stm32f3
Device support crates for STM32F3 devices
-
probe-rs-rtt
Host side implementation of the RTT (Real-Time Transfer) I/O protocol over probe-rs
-
nucleo-wl55jc-bsp
Board support package for the NUCLEO-WL55JC
-
efm32g-pac
Peripheral access API for EFM32G MCU (generated using svd2rust)
-
efm32gg-pac
Peripheral access API for EFM32GG MCU (generated using svd2rust)
-
defrag
safe and low overhead defragmenting memory manager for microcontrollers
-
lm3s6965
Interrupt bindings for the LM3S6965 microcontroller
-
atsam4lc2c-pac
Peripheral access crate for the ATSAM4LC2C microcontroller
-
ra0e1-pac
Peripheral Access Crate (PAC) for R7FAA0E1
-
ssd1331
I2C/SPI driver for the SSD1331 OLED display controller
-
xmc1100-hal
Hardware Abstraction Layer (HAL) for the XMC1100 series of ARM Cortex-M+ microcontroller
-
stm32l1xx-hal
Peripheral access API for STM32L1 series microcontrollers
-
bxcan-ng
STM32 bxCAN peripheral driver
-
da14699-pac
Peripheral Access Crate (PAC) for DA14699
-
swm341-pac
Peripheral Access Crate for Synwit's swm341 microcontroller
-
enc28j60
A platform agnostic driver to interface the ENC28J60 (Ethernet controller)
-
lpc13xx-pac
Device support crates for LPC13XX-PAC devices
-
cc13x2x7_cc26x2x7_pac
Peripheral Access Crate for TI's cc13x2x7/cc26x2x7 microcontroller family
-
air001-pac
Peripheral Access Crate for Air001 microcontroller
-
efm32tg11b-pac
Peripheral access API for EFM32TG11B MCU (generated using svd2rust)
-
oled_async
Driver for various OLED display controllers. e.g. SH110x SSD130X works with embedded-graphics
-
fancp
Types and methods for parsing/ creating Fan Control Protocol messages
-
gyuvl53l0x
driver for the VL53L0X (Time-of-Flight I2C laser-ranging module)
-
embedded-hal-error
core::error::Error for embedded-hal Errors
-
efm32hg-pac
Peripheral access API for EFM32HG MCU (generated using svd2rust)
-
hifive1
Board support crate for HiFive1 and LoFive boards
-
f3
Board Support Crate for the STM32F3DISCOVERY
-
clint
CLosure INTerrupt handlers
-
nrf-smartled
A Smart LED (WS2812) driver using hardware acceleration
-
feather_m0
Board Support crate for the Adafruit Feather M0
-
ws2812-timer-delay
Timer-based driver for ws2812 leds
-
cortex-r-rt
Run-time support for Arm Cortex-R
-
msp430fr247x
Peripheral access crate for TI MSP430FR247x microcontroller
-
defmt-logger
A
log
logger that can format defmt log frames -
gd32vf103xx-hal
HAL for GD32VF103 microcontrollers
-
kll-compiler
KLL (Keyboard Layout Language) Compiler - Rust Edition
-
ds1307
Platform-agnostic Rust driver for the DS1307 real-time clock
-
drogue-tls
TLS 1.3 client with no_std support and no allocator
-
rdif-intc
Driver Interface of interrupt controller
-
gd32vf103-pac
Peripheral access API for GD32VF103 chips
-
tmp006
Platform-agnostic Rust driver for the TMP006/TMP006B non-contact infrared (IR) thermopile temperature sensor
-
atsame70n21b
Peripheral access API for the ATSAME70N21B MCU from Microchip (generated using svd2rust 0.33.5)
-
imxrt1180evk-fcb
FlexSPI configuration block for NXP's IMXRT1180EVK
-
snowgoons4809-device
Register access crate for ATmega4809. DO NOT USE unless you have a good reason.
-
bitbang-hal
Implements embedded-hal traits by bitbanging
-
stm32l4-stm32hal
(Custom for stm32-hal) Device support crates for STM32L4 devices
-
mspm0l130x
Peripheral access crate for TI MSPM0L130X microcontroller
-
wio_lite_mg126
Board Support crate for the Wio Lite MG126
-
drone-nrf-map-pieces-4
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
efm32jg12b-pac
Peripheral access API for EFM32JG12B MCU (generated using svd2rust)
-
e310x-hal
HAL for the E310x family of microcontrollers
-
embassy-usb-driver
Driver trait for
embassy-usb
, an async USB device stack for embedded devices -
probe-run
Runs embedded programs just like native ones
-
da14691-pac
Peripheral Access Crate (PAC) for DA14691
-
lilos-list
Allocation-free intrusive doubly-linked wait queues for lilos
-
esp8266-hal
HAL for ESP8266 microcontrollers
-
r528-pac
Peripheral access API for Allwinner R528 SoC generated from unofficial SVD file
-
atsaml21j18b
Device crate for the Microchip ATSAML21J18B, generated from its SVD file
-
mcp49xx
Platform-agnostic Rust driver for the MCP49xx and MCP48xx digital-to-analog converters (DAC)
-
lilos-rwlock
A read-write / writer-preferred lock for use with lilos
-
hx1230
Driver for the HX1230 display
-
atsam4lc4a-pac
Peripheral access crate for the ATSAM4LC4A microcontroller
-
msp430fr5962
Peripheral access crate for MSP430FR5962 microcontroller
-
nrf-softdevice-s140
Low-level bindings for the Nordic nRF SoftDevice S140
-
drone-stm32-map-periph-exti
STM32 peripheral mappings for Drone, an Embedded Operating System
-
canadensis_crc
access to Cyphal software image CRCs
-
matrix_portal_m4
Board Support crate for the Matrix Portal M4
-
inverted-pin
Embedded-hal input/output pin trait implementations with inverted level logic
-
mutex-trait
Foundational mutex trait and helpers
-
mimxrt595s
Peripheral access crate (PAC) for NXP i.MX RT595S microcontrollers
-
hts221
Interface to ST Micro HTS221 humidity and temperature sensor
-
mma8x5x
Platform-agnostic Rust driver for the MMA8451, MMA8452, MMA8453, MMA8652 and MMA8653 tri-axis accelerators
-
riscv-pac
Low level access to RISC-V processors
-
rzcobs
Reverse-Zerocompressing-COBS encoding
-
vexriscv
Low level access to the VexRiscv processor
-
ch58x-hal
HAL for the CH583/CH582/CH581 RISC-V BLE microcotrollers from WCH
-
cc13x2_26x2_pac
Peripheral Access Crate for TI's cc13x2/cc26x2 microcontroller family
-
embassy-net-wiznet
embassy-net driver for WIZnet SPI Ethernet chips
-
ch57x
Device support crates for CH57X devices
-
metro_m4
Board Support crate for the Adafruit Metro M4
-
bern-conf-type
Bern RTOS configuration type
-
spark-ser7seg
An embedded-hal driver for the SparkFun Serial 7 Segment Display
-
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…
-
n32g4
Device support crate for N32G4 devices
-
nrf52805-hal
HAL for nRF52805 microcontrollers
-
ad5668
Rust Embedded HAL driver for Analog Devices AD5668 DAC
-
da14697-pac
Peripheral Access Crate (PAC) for DA14697
-
atsame70q20b
Peripheral access API for the ATSAME70Q20B MCU from Microchip (generated using svd2rust 0.33.5)
-
drone-stm32-map-periph-dma
STM32 peripheral mappings for Drone, an Embedded Operating System
-
harsark
Safe and lightweight real-time Kernel
-
nrf-usbd
USB driver for nRF microcontrollers
-
rdif-timer
Driver Interface of system timer
-
kiibohd-keyscanning
Kiibohd gpio keyscanning module for momentary push button switches (keyboards)
-
esp-wifi-sys
Bindings to Espressif's WiFi and Bluetooth low-level drivers
-
ra2a2-pac
Peripheral Access Crate (PAC) for R7FAA2A2
-
gemma_m0
Board Support crate for the Adafruit Gemma M0
-
k210-pac
Peripheral access API for K210 SoC
-
esp32c6-lp
Peripheral access crate for the ESP32-C6's LP coprocessor
-
atsam4ls2c-pac
Peripheral access crate for the ATSAM4LS2C microcontroller
-
nrf52811-pac
Peripheral Access Crate for Nordic's nrf52811 microcontroller
-
stm32f30x
Peripheral access API for STM32F30X microcontrollers
-
nrf-softdevice-s112
Low-level bindings for the Nordic nRF SoftDevice S112
-
stm32f2
Device support crates for STM32F2 devices
-
mlx9061x
Platform-agnostic Rust driver for the MLX90614 and MLX90615 non-contact infrared thermometers
-
stm32f0
Device support crates for STM32F0 devices
-
st7567s
Driver for the ST7567S LCD controller
-
drone-stm32-map-periph-adc
STM32 peripheral mappings for Drone, an Embedded Operating System
-
nrf52805-pac
Peripheral Access Crate for Nordic's nrf52805 microcontroller
-
rdif-power
Driver Interface of interrupt controller
-
efm32zg-pac
Peripheral access API for EFM32ZG MCU (generated using svd2rust)
-
ruspiro-interrupt
Providing a simple and convenient way to implement interrupt handler for Raspberry Pi interrupts
-
embedded-io-adapters
Adapters between the
embedded-io
traits and other I/O traits -
stm32wb-stm32hal
(Custom for stm32-hal) Device support crates for STM32WB devices
-
tca9539
(also PCA9539) 16-Bit I2C I/O Expander with I2C Interface
-
atsaml21j16b
Device crate for the Microchip ATSAML21J16B, generated from its SVD file
-
atsamd-usb-host
usb-host driver support for Atmel SAMD* microcontrollers
-
wio_terminal
Board support crate for the Seeed Studio Wio Terminal
-
tm4c-hal
Common bits of HAL for the TM4C123x/TM4C129x family of microcontrollers
-
esp32s2-ulp
Peripheral access crate for the ESP32-S2's RISC-V ULP coprocessor
-
ra2e2-pac
Peripheral Access Crate (PAC) for R7FAA2E2
-
drone-svd
CMSIS-SVD parser for Drone, an Embedded Operating System
-
cc13x4_cc26x4_pac
Peripheral Access Crate for TI's cc13x4/cc26x4 microcontroller family
-
esp32s3-ulp
Peripheral access crate for the ESP32-S3's RISC-V ULP coprocessor
-
ch59x
Device support crates for CH59X devices
-
embedded-update
Firmware updates for embedded devices supporting multiple update services
-
ruspiro-allocator
lightweight heap memory allocator for Raspberry Pi baremetal environments
-
atsame70j20b
Peripheral access API for the ATSAME70J20B MCU from Microchip (generated using svd2rust 0.33.5)
-
embassy-net-ppp
embassy-net driver for PPP over Serial
-
drone-stm32-map-periph-uart
STM32 peripheral mappings for Drone, an Embedded Operating System
-
async-stm32f1xx
Abstractions for asynchronous programming on the STM32F1xx family of microcontrollers
-
bern-conf
Bern RTOS default configuration
-
atsam4ls8a-pac
Peripheral access crate for the ATSAM4LS8A microcontroller
-
ch32v3
Device support crates for CH32V3 devices
-
stm32f1xx-hal-bxcan
HAL for the STM32F1xx family of microcontrollers
-
microbit-bsp
An embassy-based boards support package (BSP) for BBC Micro:bit v2
-
drone-nrf-map-pieces-11
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
kiibohd-hid-io
HID-IO protocol implementation for the C kiibohd firmware
-
pic32mx470
Peripheral access API for PIC32MX330/350/370/430/450/470 microcontrollers
-
da14680-pac
Peripheral Access Crate (PAC) for DA14680
-
rcobs
Reverse-COBS encoding
-
nrf-softdevice-s132
Low-level bindings for the Nordic nRF SoftDevice S132
-
cc2640r2_pac
Peripheral Access Crate for TI's cc2640r2 microcontroller family
-
stm32l1
Device support crates for STM32L1 devices
-
stm32-device-signature
Device electronic signature 'driver' for STM32 microcontrollers
-
canadensis_core
A Cyphal implementation: Common definitions
-
arduino_mkrvidor4000
Board Support crate for the Arduino MKR VIDOR 4000
-
ra2e3-pac
Peripheral Access Crate (PAC) for R7FAA2E3
-
feather_m4
Board Support crate for the Adafruit Feather M4
-
d1-mini
A Board Support Package (BSP) which provides a type-safe API for the WEMOS/LOLIN D1 mini
-
atsam4lc8a-pac
Peripheral access crate for the ATSAM4LC8A microcontroller
-
l298n
driver for the L298N (Dual H-Bridge Motor Controller module)
-
atsams70q21b
Peripheral access API for the ATSAMS70Q21B MCU from Microchip (generated using svd2rust 0.33.5)
-
da1470x-pac
Peripheral Access Crate (PAC) for DA1470X
-
mips-mcu
Low level access to MIPS MCU cores
-
kll-hid
USB HID enum mapping for kll-core
-
atsaml21g18a
Device crate for the Microchip ATSAML21G18A, generated from its SVD file
-
s32k118-pac
Device Support Crate for NXP S32K118 Devices
-
rk3399-pac
Peripheral Access Crate (PAC) for the RK3399 SoC from Rockchip
-
nrf-softdevice-s122
Low-level bindings for the Nordic nRF SoftDevice S122
-
arduino_nano33iot
Board Support crate for the Arduino Nano 33 IOT
-
efm32pg1b200-pac
Peripheral access API for EFM32PG1B200 MCU (generated using svd2rust)
-
is31fl3743b
Bare-metal no_std driver for the Lumissil IS31FL3743B
-
xtensa-lx
Low-level access to Xtensa LX processors and peripherals
-
cc13x0_pac
Peripheral Access Crate for TI's cc13x0 microcontroller
-
ra2a1-pac
Peripheral Access Crate (PAC) for R7FAA2A1
-
msp430f2619-pac
A peripheral access crate (PAC) for TI's MSP430F2619 mcu
-
lilos-semaphore
A counting semaphore for use with lilos
-
drone-nrf-map-pieces-8
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
kiibohd-hall-effect-keyscanning
Hall Effect keyscanning for strobed matrices
-
p1am_100
Board Support crate for the Facts Engineering P1AM-100
-
gd32c1
Device support crate for GD32C1 devices
-
atsam4lc2b-pac
Peripheral access crate for the ATSAM4LC2B microcontroller
-
ruspiro-i2c
Raspberry Pi - I²C bus interface implementation
-
efm32pg-pac
Peripheral access API for EFM32PG MCU (generated using svd2rust)
-
embassy-net-driver
Driver trait for the
embassy-net
async TCP/IP network stack -
stm32l5
Device support crates for STM32L5 devices
-
atsams70j21b
Peripheral access API for the ATSAMS70J21B MCU from Microchip (generated using svd2rust 0.33.5)
-
ch56x
Device support crates for CH56X devices
-
stm32wl
Device support crates for STM32WL devices
-
atsam4lc4c-pac
Peripheral access crate for the ATSAM4LC4C microcontroller
-
lilos-watch
Cheap sharing with change notification for lilos
-
ra4m1-pac
Peripheral Access Crate (PAC) for R7FAA4M1
-
efm32jg1b-pac
Peripheral access API for EFM32JG1B MCU (generated using svd2rust)
-
nrf-softdevice-s113
Low-level bindings for the Nordic nRF SoftDevice S113
-
embassy-boot-rp
Bootloader lib for RP2040 chips
-
efm32pg23-pac
Peripheral access API for EFM32PG23 MCU (generated using svd2rust)
-
si4703
Platform-agnostic Rust driver for the Si4703 and Si4702 FM radio turners (receivers)
-
drone-nrf-map-periph-uarte
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
esp32c3-hal
HAL for ESP32-C3 microcontrollers
-
atsam4ls4a-pac
Peripheral access crate for the ATSAM4LS4A microcontroller
-
stm32l0
Device support crates for STM32L0 devices
-
atsaml21e18b
Device crate for the Microchip ATSAML21E18B, generated from its SVD file
-
qt_py_m0
Board Support crate for the Adafruit QT Py
-
esp32c2-hal
HAL for ESP32-C2 microcontrollers
-
nrf52820-pac
Peripheral Access Crate for Nordic's nrf52820 microcontroller
-
efm32pg1b100-pac
Peripheral access API for EFM32PG1B100 MCU (generated using svd2rust)
-
s32k142w-pac
Device Support Crate for NXP S32K142W Devices
-
panic-itm
Log panic messages using the ITM (Instrumentation Trace Macrocell)
-
s32k144-pac
Device Support Crate for NXP S32K144 Devices
-
stm32wb
Device support crates for STM32WB devices
-
atsame70n19b
Peripheral access API for the ATSAME70N19B MCU from Microchip (generated using svd2rust 0.33.5)
-
edgebadge
Board Support crate for the Adafruit EdgeBadge
-
ra6m2-pac
Peripheral Access Crate (PAC) for R7FAA6M2
-
drone-stm32-map-periph-spi
STM32 peripheral mappings for Drone, an Embedded Operating System
-
esp8266
Peripheral access crate for the ESP8266
-
drone-stm32-map-periph-i2c
STM32 peripheral mappings for Drone, an Embedded Operating System
-
ch643
Device support crates for CH643 devices
-
drone-nrf-map-pieces-12
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
nrf52-hal-common
Common HAL for the nRF52 family of microcontrollers. More specific HAL crates also exist.
-
mm32f5
Peripheral access API for MM32F5270 and MM32F5280 microcontrollers
-
stm32mp1
Device support crates for STM32MP1 devices
-
samd21_mini
Board Support crate for the Sparkfun SAMD21 Mini Breakout
-
esp32s3-hal
HAL for ESP32-S3 microcontrollers
-
atsam4ls8b-pac
Peripheral access crate for the ATSAM4LS8B microcontroller
-
efm32pg22-pac
Peripheral access API for EFM32PG22 MCU (generated using svd2rust)
-
nrf-softdevice-mbr
Low-level bindings for the MBR included in all Nordic nRF SoftDevices
-
ra4t1-pac
Peripheral Access Crate (PAC) for R7FAA4T1
-
nrf9120-pac
Peripheral Access Crate for Nordic's nrf9120 microcontroller
-
ruspiro-cache
Raspberry Pi cache maintenance operation API
-
veml6030
Platform-agnostic Rust driver for the VEML6030 and VEML7700 high-accuracy ambient light sensors
-
gd32f3x0-pac
Peripheral access API for GD32F3x0 chips (generated using svd2rust)
-
atsams70q20b
Peripheral access API for the ATSAMS70Q20B MCU from Microchip (generated using svd2rust 0.33.5)
-
atsam4lc8c-pac
Peripheral access crate for the ATSAM4LC8C microcontroller
-
drone-nrf-map-pieces-6
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-config
Configuration for Drone, an Embedded Operating System
-
atsaml21e16b
Device crate for the Microchip ATSAML21E16B, generated from its SVD file
-
drone-nrf-map-pieces-7
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
ra6m1-pac
Peripheral Access Crate (PAC) for R7FAA6M1
-
atsam4lc8b-pac
Peripheral access crate for the ATSAM4LC8B microcontroller
-
ch32l1
Device support crates for CH32L1 devices
-
esp32c6-hal
HAL for ESP32-C6 microcontrollers
-
esp32s2-hal
HAL for ESP32-S2 microcontrollers
-
drone-nrf-map-pieces
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
atsame70j19b
Peripheral access API for the ATSAME70J19B MCU from Microchip (generated using svd2rust 0.33.5)
-
kxcj9
Platform-agnostic Rust driver for the KXCJ9 ultra-low-power tri-axis accelerometer
-
bl702-pac
Embedded Rust's Peripheral Access Crate for BL702/BL704/BL706 RISC-V BLE + Zigbee microcontroller
-
veml6040
Platform-agnostic Rust driver for the VEML6040 RGBW color light sensor
-
tm4c123x-hal
HAL for the TM4C123x family of microcontrollers
-
ruspiro-mmu
Functions to use and configure the MemoryManagementUnit (MMU) of the Raspberry Pi
-
ra2e1-pac
Peripheral Access Crate (PAC) for R7FAA2E1
-
max44009
Platform-agnostic Rust driver for the MAX44009 ambient light sensor
-
ovl-atsame70q21b
Peripheral access API for ATSAME70Q21B microcontrollers from Atmel/Microchip (generated using svd2rust)
-
esp32h2-hal
HAL for ESP32-H2 microcontrollers
-
s32k144w-pac
Device Support Crate for NXP S32K144W Devices
-
drone-nrf-map-pieces-1
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
trinket_m0
Board Support crate for the Adafruit Trinket M0
-
drone-stm32-map-pieces
STM32 peripheral mappings for Drone, an Embedded Operating System
-
drone-stm32-map-periph-rtc
STM32 peripheral mappings for Drone, an Embedded Operating System
-
s32k142-pac
Device Support Crate for NXP S32K142 Devices
-
atsaml21j17b
Device crate for the Microchip ATSAML21J17B, generated from its SVD file
-
atsams70n21b
Peripheral access API for the ATSAMS70N21B MCU from Microchip (generated using svd2rust 0.33.5)
-
stm32h5
Device support crates for STM32H5 devices
-
ra6t1-pac
Peripheral Access Crate (PAC) for R7FAA6T1
-
atsam4lc4b-pac
Peripheral access crate for the ATSAM4LC4B microcontroller
-
drone-stm32-map-pieces-5
STM32 peripheral mappings for Drone, an Embedded Operating System
-
itsybitsy_m4
Board Support crate for the Adafruit ItsyBitsy M4 Express
-
atsam4ls4b-pac
Peripheral access crate for the ATSAM4LS4B microcontroller
-
ra4w1-pac
Peripheral Access Crate (PAC) for R7FAA4W1
-
bl702-hal
HAL for the Bouffalo Lab BL702 microcontroller family
-
esp32p4
Peripheral access crate for the ESP32-P4
-
esp32-hal
HAL for ESP32 microcontrollers
-
atsamv71j20b
Peripheral access API for the ATSAMV71J20B MCU from Microchip (generated using svd2rust 0.33.5)
-
drone
CLI utility for Drone, an Embedded Operating System
-
atsam4ls8c-pac
Peripheral access crate for the ATSAM4LS8C microcontroller
-
drone-nrf-map-pieces-5
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
drone-nrf-map-pieces-2
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
atsam4e8c-pac
Peripheral access crate for ATSAM4E8C microcontrollers
-
grand_central_m4
Board Support crate for the Adafruit Grand Central M4 Express
-
drone-stm32-map-pieces-4
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsaml21j18a
Device crate for the Microchip ATSAML21J18A, generated from its SVD file
-
veml6075
Platform-agnostic Rust driver for the VEML6075 UVA and UVB light sensor
-
tcs3400
Platform-agnostic Rust driver for the TCS3400 RGB color light to digital converter with IR filter
-
ra6t3-pac
Peripheral Access Crate (PAC) for R7FAA6T3
-
atsaml21g16b
Device crate for the Microchip ATSAML21G16B, generated from its SVD file
-
atsam4e16c-pac
Peripheral access crate for ATSAM4E16C microcontrollers
-
embassy-time-queue-driver
Timer queue driver trait for embassy-time
-
atsamv71q19b
Peripheral access API for the ATSAMV71Q19B MCU from Microchip (generated using svd2rust 0.33.5)
-
atsam4e16e-pac
Peripheral access crate for ATSAM4E16E microcontrollers
-
sodaq_sara_aff
Board Support crate for the Sodaq SARA AFF
-
drone-ctypes
Platform-specific C types for Drone apps
-
ra2l1-pac
Peripheral Access Crate (PAC) for R7FAA2L1
-
drone-stm32-map-pieces-9
STM32 peripheral mappings for Drone, an Embedded Operating System
-
drone-stm32-map-pieces-11
STM32 peripheral mappings for Drone, an Embedded Operating System
-
atsam4ls4c-pac
Peripheral access crate for the ATSAM4LS4C microcontroller
-
drone-nrf-map-pieces-10
Nordic Semi nRFx peripheral mappings for Drone, an Embedded Operating System
-
s32k116-pac
Device Support Crate for NXP S32K116 Devices
-
atsamv71n19b
Peripheral access API for the ATSAMV71N19B MCU from Microchip (generated using svd2rust 0.33.5)
-
s32k148-pac
Device Support Crate for NXP S32K148 Devices
-
ra6m3-pac
Peripheral Access Crate (PAC) for R7FAA6M3
-
isl29125
Platform-agnostic Rust driver for the ISL29125 low-power digital RGB color light sensor with IR blocking filter
-
atsaml21e15b
Device crate for the Microchip ATSAML21E15B, generated from its SVD file
-
cortex-m-quickstart
A template for building applications for ARM Cortex-M microcontrollers
-
pyportal
Board Support crate for the Adafruit PyPortal
-
atsam4s16c-pac
Peripheral access crate for the ATSAM4S16C microcontroller
-
drone-stm32-map-pieces-7
STM32 peripheral mappings for Drone, an Embedded Operating System
-
tm4c129x-hal
HAL for the TM4C129x family of microcontrollers
-
ra6e2-pac
Peripheral Access Crate (PAC) for R7FAA6E2
-
serpente
Board Support crate for the Serpente board
-
atsamv70n20b
Peripheral access API for the ATSAMV70N20B MCU from Microchip (generated using svd2rust 0.33.5)
-
efm32pg12b500-pac
Peripheral access API for EFM32PG12B500 MCU (generated using svd2rust)
-
atsam4s16b-pac
Peripheral access crate for the ATSAM4S16B microcontroller
-
s32k146-pac
Device Support Crate for NXP S32K146 Devices
-
ra4e2-pac
Peripheral Access Crate (PAC) for R7FAA4E2
-
atsamd51j20a
Peripheral access API for ATSAMD51J20A microcontrollers (generated using svd2rust)