Showing content from https://github.com/rust-embedded/awesome-embedded-rust below:
rust-embedded/awesome-embedded-rust: Curated list of resources for Embedded and Low-level development in the Rust programming language
This is a curated list of resources related to embedded and low-level programming in the Rust programming language, including a selection of useful crates.
This project is developed and maintained by the Resources team.
Don't see something you want or need here? Add it to the Not Yet Awesome Embedded Rust list!
In 2018, the Rust community created an embedded working group to help drive adoption in the Rust ecosystem.
- Embedded WG, including newsletters with progress updates.
Books, blogs, and training materials Free and public materials
These materials are available publicly, typically under permissive licenses.
Paid and commercially available materials
These materials are available for purchase. They have been reviewed for relevancy, but are not specifically endorsed or reviewed for accuracy or quality by the Embedded Working Group.
- Simplified Embedded Rust: Standard Library Edition - This book provides a quick path to start learning embedded Rust with minimal setup. Book is based on ESP devices and the Wokwi Simulator. This edition uses the standard library development approach which is based on the ESP-IDF framework.
- Simplified Embedded Rust: Core Library Edition - This book provides a quick path to start learning embedded Rust with minimal setup. Book is based on ESP devices and the Wokwi Simulator. This edition uses the core library development approach for bare metal development.
- xargo Rust package manager with support for non-default std libraries — build Rust runtime for your embedded system.
- xargo is great, but since it's in maintenance mode, cargo-xbuild is catching up as its intended replacement.
- svd2rust Generate Rust structs with register mappings from SVD files.
- edc2svd Generate SVD files for PIC32 devices from EDC files. -
- embedded-hal-mock Mock implementation of
embedded-hal
traits for testing without accessing real hardware. -
- bindgen Automatically generates Rust FFI bindings to C and C++ libraries. -
- cortex-m semihosting Semihosting for ARM Cortex-M processors
- bobbin-cli A Rust command line tool to simplify embedded development and deployment.
- ferros A Rust-based userland which also adds compile-time assurances to seL4 development.
- cargo-flash A small cargo subcommand to download your binary to your target chip. -
- cargo-embed A superset of cargo-flash with additional useful features like configuration file support, an RTT terminal, or a GDB server. -
- cargo-hf2 A small cargo subcommand to download cargo builds to Microsoft UF2 bootloaders via HID USB . -
- cargo-bloat Find out what takes most of the space in your executable.
- cargo-call-stack Static, whole program stack usage analyzer.
- cargo-dfu Cargo extension for flashing embedded rust programs via DFU.
- espflash Serial flasher utility for Espressif SoCs and modules. -
- espup Tool for installing and maintaining Espressif Rust ecosystem. -
- uf2 Converts binary files to Microsoft's UF2 format for copying over to mass storage device uf2 bootloaders -
- probe-rs: a modern, embedded debugging toolkit, written in Rust
- Knurling Tools are developed by Ferrous Systems to ease the development process for building, debugging, and testing embedded Rust systems. These tools include:
- defmt: a highly efficient logging framework that targets resource-constrained devices, like microcontrollers.
- derive-mmio: Creating MMIO-friendly APIs for embedded peripherals.
- flip-link, a linker wrapper that provides stack overflow protection without an MMU by flipping the standard memory layout of ARM Cortex-M programs
- app-template, a
cargo-generate
powered project template for quickly setting up new projects using the Knurling Tools.
- defmt-test, an embedded test harness that lets you write and run unit tests as if you were using the built-in
#[test]
attribute, but will run on an embedded target
- embedded-hal-compat, a compatibility layer to provide interoperability between
v0.2.x
and v1.x.x
hal implementations and drivers
- Embassy start is a GitHub repo template for setting up async embedded Rust projects that use Embassy. This particular template targets nRF hardware and networking using the Uarte for the purposes of illustration only.
- svd-generator CLI tool to parse flattened device tree files, and create a SVD file. -
- rumbac is a simple CLI flasher for Arduino Nano 33 BLE Rev2 / Sense Rev2 boards, using the SAM-BA protocol to talk with the Arduino-provided bootloader, porting just enough of the
bossac
tool to Rust
- commitment-issues Compile git metadata into your binary.
Real-time Operating System (RTOS)
- Drone OS An Embedded Operating System for writing real-time applications in Rust.
- FreeRTOS.rs Rust interface for the FreeRTOS API
- FreeRTOS-rust Rust interface for FreeRTOS with Rust entry point and build support crate.
- RIOT-OS directly supports applications written in Rust, both in terms of build system integration and by having safe and idiomatic wrappers.
- Tock An embedded operating system designed for running multiple concurrent, mutually distrustful applications on low-memory and low-power microcontrollers
- Hubris A real-time operating system built by Oxide Computer to run the Service Controller processor in the mainboards of their rack-mount servers.
- Zephyr An embedded RTOS, written in C, with support for writing applications in Rust.
- Ariel OS A modular operating system written in Rust, providing multicore preemptive scheduling and application portability on top of Embassy.
- RTIC v1.0 Real-Time Interrupt-driven Concurrency — A concurrency framework for building real-time systems:
Basic runtimes for CPUs & MCUs which are needed to run software on them.
Register definition for microcontroller families. Usually generated using svd2rust
. -
Peripheral Access Crates were also called Device Crates.
NOTE You may be able to find even more peripheral access crates by searching for the svd2rust
keyword on crates.io!
efm32pg12-pac
- Peripheral access API for Silicon Labs EFM32PG12 microcontrollers -
The efm32-rs
project has peripheral access APIs for most EFM32 microcontrollers (generated using svd2rust):
The stm32-rs
project has peripheral access APIs for most STM32 microcontrollers (generated using svd2rust):
tm4c123x
Peripheral access API for TM4C123x microcontrollers (generated using svd2rust)
tm4c129x
Peripheral access API for TM4C129x microcontrollers (generated using svd2rust)
mspm0-metapac
- PAC for all MSPM0 (and MSPS003) microcontrollers. (generated using chiptool)
msp430g2553
Peripheral access API for MSP430G2553 microcontrollers (generated using svd2rust)
msp430fr2355
Peripheral access API for MSP430FR2355 microcontrollers (generated using svd2rust)
msp430fr6972
-
ambiq-apollo1-pac
Peripheral access API for Ambiq Apollo 1 microcontrollers (generated using svd2rust)
ambiq-apollo2-pac
Peripheral access API for Ambiq Apollo 2 microcontrollers (generated using svd2rust)
ambiq-apollo3-pac
Peripheral access API for Ambiq Apollo 3 microcontrollers (generated using svd2rust)
ambiq-apollo3p-pac
Peripheral access API for Ambiq Apollo 3 Plus microcontrollers (generated using svd2rust)
Peripheral access crates for the different XMC4xxx families of microcontrollers
w7500x-pac
Peripheral Access Crate for Wiznet's W7500x microcontrollers (generated using svd2rust) -
HAL implementation crates
Implementations of embedded-hal
for microcontroller families and systems running some OS. -
NOTE You may be able to find even more HAL implementation crates by searching for the embedded-hal-impl
and embedded-hal
keywords on crates.io!
Also check the list of NXP board support crates!
Also check the list of STMicroelectronics board support crates!
msp430fr2x5x-hal
- HAL implementation for the MSP430FR2x5x family of microcontrollers
esp-idf-hal
- An embedded-hal implementation for Rust on ESP32 microcontrollers and ESP-IDF
esp-hal
- A
no_std
Hardware Abstraction Layers for ESP32 microcontrollers
tomu-hal
- HAL implementation targeted for Tomu USB board with EFM32HG309F64 ARMv6-M core. Has support to configure tomu bootloader directly from an application via the
toboot_config
macro.
da14531-hal
HAL crate for DA14531 Ultra-Low Power BT 5.1 System-on-Chip -
Architecture support crates
Crates tailored for general CPU architectures.
riscv
Low-level access to RISC-V processors -
Crates tailored for specific boards.
For unlisted Pimoroni microcontroller boards, check this up-to-date list.
rp-pico
- Board Support Crate for the RP2040-based Raspberry Pi Pico.
The same repository includes support for numerous other development boards which use Raspberry Pi microcontrollers. A full list can be found in the repository documentation.
prussia
- SDK for the PlayStation 2.
teensy4-rs
Board Support crate for the [Teensy 4.0]
monotron
- A 1980s home-computer style application for the Texas Instruments Stellaris Launchpad. PS/2 keyboard input, text output on a bit-bashed 800x600 VGA signal. Uses menu, vga-framebuffer and pc-keyboard.
stellaris-launchpad
- For the Texas Instruments Stellaris Launchpad and Tiva-C Launchpad
tm4c129-launchpad
- For the Texas Instruments TM4C129-XL Launchpad board
betafpv-f3
- For the BetaFPV F3 drone flight controller
Component abstraction crates
The following crates provide HAL-like abstractions for subcomponents of embedded devices that go beyond what is available in embedded-hal
:
You can also find many of these drivers on drive-rs; please consider adding your driver there (in the GitHub repo) while we work to port everything across.
Platform agnostic crates to interface external components. These crates use the embedded-hal
interface to support all the devices and systems that implement the embedded-hal
traits.
The list below contains drivers that have achieved the "released" status. To add a driver to this list, please ensure that your driver has a short blog post, article, or sufficiently explanatory README showing an example of its use. Ideally, this post would demonstrate using the device in a small project so that a Rust and/or embedded newcomer can also understand it. Otherwise, please add it to the WIP section below.
- AD983x - SPI - AD9833/AD9837 waveform generators / DDS - Intro blog post -
- adafruit-alphanum4 - I2C - Driver for Adafruit 14-segment LED Alphanumeric Backpack based on the ht16k33 chip -
- adafruit-seesaw - I2C - Driver for devices running the Adafruit Seesaw firmware -
- ADE791x - SPI - ADE7912/ADE7913 3-Channel, Isolated, Sigma-Delta ADC - github -
- ADS1x1x - I2C - 12/16-bit ADCs like ADS1013, ADS1015, ADS1115, etc. - Intro blog post -
- ADXL313 - SPI - 3-axis accelerometer -
- ADXL343 - I2C - 3-axis accelerometer -
- ADXL355 - SPI - 3-axis accelerometer - Intro blog post -
- AEM10900 - I2C - Energy Harvester - github -
- AFE4404 - I2C - Pulse oximeter -
- AHT20 - I2C - Humidity and temperature sensor - github -
- AHT20-driver - I2C - Humidity and temperature sensor - Intro blog post - github -
- AnyLeaf - I2C - pH sensor module - github -
- AT86RF212 - SPI - Low power IEEE 802.15.4-2011 ISM RF Transceiver - Intro blog post -
- BlueNRG - SPI - driver for BlueNRG-MS Bluetooth module - Intro post
- BMA400 - I2C/SPI - Bosch 12-bit 3-axis accelerometer - github
- BNO055 - I2C - Bosch Sensortec BNO055 9-axis IMU driver - Intro post
- CD74HC4067 - GPIO - 16-channel digital and analog multiplexer - Intro blog post - github -
- dht-sensor - 1-Wire - DHT11/DHT22 temperature/humidity sensor driver - github -
- embedded-dht-rs - 1-Wire, I2C - DHT11/DHT20/DHT22 temperature/humidity sensor driver - github -
- DRV8825 - DRV8825 Stepper Motor Driver (based on Stepper) - Intro blog post -
- DS1307 - I2C - Real-time clock driver - Intro blog post -
- ebyte-e32 - SERIAL - Ebyte E32 LoRa module driver - Intro blog post -
- EEPROM24x - I2C - 24x series serial EEPROM driver - Intro blog post -
- embedded-ccs811 - I2C - Gas and VOC sensor driver for monitoring indoor air quality - Intro blog post -
- embedded-sdmmc - SPI - SD/MMC Card Driver with MS-DOS Partition and FAT16/FAT32 support - Intro post
- ENC28J60 - SPI - Ethernet controller - Intro blog post -
- FH101RF - SPI - Wake-Up Radio - github -
- FUSB302B - I2C - Programmable USB Type‐C Controller with USB Power Delivery - github
- HC-12 - SERIAL - Wireless serial transceiver module - Intro blog post - github -
- HTS221 - I2C - Humidity and temperature sensor - Intro blog post -
- IS31FL3728 - I2C - LED dot matrix display mode (8×8, 5x11, 6x10,7x9) - github -
- IIS2MDC - I2C - ST's High accuracy, ultra-low-power, 3-axis digital output magnetometer -
- ISM330DHCX - I2C - ST's IMU with 3D accelerometer, 3D gyroscope, ML core and more -
- keypad - GPIO - Keypad matrix circuits - Intro post -
- KXCJ9 - I2C - KXCJ9/KXCJB 3-axis accelerometers - Intro blog post -
- L3GD20 - SPI - Gyroscope - Intro blog post -
- lcd_parallel_bus - GPIO - Async and blocking driver for LCDs based on HD44780 parallel bus -
- LSM303DLHC - I2C - Accelerometer + compass (magnetometer) - Intro blog post -
- MAX6675 - SPI - A driver for the MAX6675 digital thermocouple converter - Intro blog post -
- MAX6955 - I2C - Driver for Alphanumeric LED display driver - Intro blog post -
- MAX116xx-10bit - SPI - Driver for the MAX11619-MAX11621, MAX11624 and MAX11625 10-bit ADCs - Intro blog post -
- MCP25LCXX - SPI - Driver for Microchip's 25LC series of EEPROMs -
- MCP3008 - SPI - 8 channel 10-bit ADC - Intro blog post -
- MCP3425 - I2C - 16-bit ADC - Intro blog post -
- MCP794xx - I2C - Real-time clock / calendar driver - Intro blog post -
- MMA7660FC - I2C - 3-axis accelerometer - Intro blog post
- OPT300x - I2C - Ambient light sensor family driver - Intro blog post -
- PAC194X - I2C - Single/multi channel power monitor - Intro blog post -
- port-expander - I2C - Driver for I2C port expanders (supports
PCA95xx
, PCF85xx
) - Intro blog post -
- pwm-pca9685 - I2C - 16-channel, 12-bit PWM/Servo/LED controller - Intro blog post -
- rainbow-hat-rs - I2C/SPI/GPIO - Pimoroni Rainbow HAT driver for Raspberry Pi - github -
- rotary-encoder-hal - GPIO - A rotary encoder driver using
embedded-hal
- Intro blog post -
- sega-controller - GPIO - Sega controller input - github -
- SGP30 - I2C - Gas sensor - Intro blog post -
- SH1106 - I2C - Monochrome OLED display controller - Intro post
- shared-bus - I2C - utility driver for sharing a bus between multiple devices - Intro post
- shift-register-driver - GPIO - Shift register - Intro blog post -
- Si4703 - I2C - FM radio turner (receiver) driver - Intro blog post -
- SRAM23x - SPI - Microchip 23x series serial SRAM/NVSRAM driver - Intro blog post -
- SSD1306 - I2C/SPI - OLED display controller - Intro blog post -
- SSD1309 - I2C/SPI - OLED display controller - Intro blog post -
- STSPIN220 - STSPIN220 Stepper Motor Driver (based on Stepper) - Intro blog post -
- Sx127x - SPI - Long Range Low Power Sub GHz (Gfsk, LoRa) RF Transceiver - Intro blog post -
- Sx128x - SPI - Long range, low power 2.4 GHz (Gfsk, Flrc, LoRa) RF Transceiver - Intro blog post -
- TC72 - SPI - Microchip TC72 temperature sensor -
- TCN75A - I2C - Microchip TCN75A temperature sensor -
- TMP006 - I2C - Contact-less infrared (IR) thermopile temperature sensor driver - Intro post
- TMP1x2 - I2C - TMP102 and TMP112x temperature sensor driver - Intro blog post
- TSIC - GPIO - TSIC 306 temperature sensor driver - Intro blog post
- TSL256X - I2C - Light Intensity Sensor - Intro blog post -
- VEML6030/VEML7700 - I2C - Ambient light sensors - Intro blog post -
- VEML6075 - I2C - UVA and UVB light sensor - Intro blog post -
- usbd-serial - USB CDC-ACM class (serial) implementation - github -
- usbd-hid - USB HID class implementation - github -
- usbd-hid-device - USB HID class implementation without
unsafe
- github -
- usbd-human-interface-device - Batteries included embedded USB HID library for
usb-device
. Includes concrete Keyboard (boot and NKRO), Mouse and Consumer Control implementations as well as support for building your own HID classes - github -
- usbd-midi - USB MIDI class implementation - github -
- usbd-webusb - USB webUSB class implementation - github -
- SHTCx - I2C - Temperature / humidity sensors - github -
- ST7789 - SPI - An embedded-graphics compatible driver for the popular lcd family from Sitronix used in the PineTime watch - github -
- DW1000 - SPI - Radio transceiver (IEEE 802.15.4 and position tracking) - Article -
- Adafruit-7segment - I2C - Driver for Adafruit 7-segment LED Numeric Backpack based on the ht16k33 chip - github -
- ST7565 - SPI - An embedded-graphics compatible driver for LCD displays based on the ST7565 chip - github -
- tb6612fng - A
no_std
driver for the TB6612FNG motor driver -
- vl53l1x-uld - I2C - A pure-rust driver for the ST VL53L1X -
- i2c-multiplexer - I2C - An I2C Multiplexer library that supports the PCA9546 and TCA9546A chips - github -
- SHT31-rs - I2C - Fully supported SHT temperature / humidity sensors - github -
NOTE You may be able to find even more driver crates by searching for the embedded-hal-driver
keyword on crates.io!
Work in progress drivers. Help the authors make these crates awesome!
- AD9850 - Embedded driver for the AD9850 DDS synthesizer chip -
- AFE4400 - SPI - Pulse oximeter
- APDS9960 - I2C - Proximity, ambient light, RGB, and gesture sensor -
- AS5048A - SPI - AMS AS5048A Magnetic Rotary Encoder
- AXP209 - I2C - Power management unit
- ad57xx - SPI - Quad and dual channel DAC -
- BH1750 - I2C - ambient light sensor (lux meter)
- BME280 - A rust device driver for the Bosch BME280 temperature, humidity, and atmospheric pressure sensor and the Bosch BMP280 temperature and atmospheric pressure sensor.
- bme680 - I2C - Temperature / humidity / gas / pressure sensor -
- BMI160 - I2C / SPI - Inertial Measurement Unit -
- BMP280 - A platform agnostic driver to interface with the BMP280 pressure sensor
- CC1101 - SPI - Sub-1GHz RF Transceiver -
- DS3231 - I2C - real-time clock
- DS3234 - SPI - Real-time clock
- DS323x - I2C/SPI - Real-time clocks (RTC): DS3231, DS3232 and DS3234 -
- epd-waveshare - SPI - driver for E-Paper Modules from Waveshare
- embedded-morse - Output morse messages -
- embedded-nrf24l01 - SPI+GPIO - 2.4 GHz radio
- Ft6x36 - I2C - Rust driver for focal tech touch screen FT6236, FT6336 -
- grove-matrix-led-my9221-rs - I2C - Rust driver for Grove RGB Matrix Led with my-9221 Driver -
- GridEYE - I2C - Rust driver for Grid-EYE / Panasonic AMG88(33) -
- HC-SR04 - DIO - Ultrasound sensor
- HD44780-driver - GPIO - LCD controller -
- HD44780 - Parallel port - LCD controller
- HM11 - USART - HM-11 bluetooth module AT configuration crate -
- HRS3300 - I2C - Heart rate sensor / monitor used in the PineTime smartwatch, for example. -
- HDC20xx - I2C - Temperature and humidity sensor compatible with HDC2080, HDC2021 and HDC2010. -
- hub75 - A driver for rgb led matrices with the hub75 interface -
- hzgrow-r502 - UART capacitive fingerprint reader -
- iAQ-Core - I2C - iAQ-Core-C/iAQ-Core-P Gas and VOC sensor driver for monitoring indoor air quality.
- ILI9341 - SPI - TFT LCD display
- INA260 - I2C - power monitor -
- ISL29125 - I2C - RGB Color Light Sensor with IR Blocking Filter -
- IST7920 - SPI monochrome LCD display -
- LM75 - I2C - Temperature sensor and thermal watchdog (also compatible with LM75A, LM75B, LM75C, AT30TS75A, DS1775, DS75, DS7505, G751, MAX7500/1/2/3/4, MAX6625, MCP9800/1/2/3, STDS75, TCN75, PCT2075) -
- lp586x - I2C/SPI - LED matrix driver
- LS010B7DH01 - SPI - Memory LCD
- LSM303AGR - I2C/SPI - 3D accelerometer + 3D magnetometer. (Used in e.g. micro:bit boards)
- LSM303C - A platform agnostic driver to interface with the LSM303C (accelerometer + compass)
- LSM9DS1 - I2C/SPI - 9-axis motion sensor module
- ltr-559 - I2C - Ambient Light Sensor and Proximity sensor
- lvgl - no_std LittleVGL port -
- M95320 - SPI - STMicroelectronics Serial flash EEPROM -
- MAG3110 - I2C - Magnetometer
- MAX17048/9 - I2C - LiPo Fuel gauge, battery monitoring IC -
- MAX170xx - I2C - LiPo Fuel gauge, battery monitoring ICs compatible with MAX17043/4, MAX17048/9, MAX17058/9. -
- MAX3010x - I2C - Pulse oximeter and heart-rate sensor. ATM Compatible with MAX30102. -
- MAX31855 - SPI - Thermocouple digital converter -
- MAX31865 - SPI - RTD to Digital converter -
- MAX44009 - I2C - Ambient light sensor -
- MAX7219 - SPI - LED display driver -
- MCP4725 - I2C - 12-bit DAC -
- MCP49xx - SPI - 8/10/12-bit DACs like MCP4921, MCP4922, MCP4801, etc. -
- MCP9808 - I2C - Temperature sensor -
- MCP4x - SPI - Digital potentiometers (digipot) like MCP41010, MCP41050, MCP41100, MCP42010, MCP42050 and MCP42100, etc. -
- MFRC522 - SPI - RFID tag reader/writer
- midi-port - UART - MIDI input -
- MLX9061x - I2C - MLX90614/MLX90615 Contact-less infrared (IR) temperature sensor driver. -
- MMA8x5x - I2C - Tri-axis accelerometers like MMA8451Q, MMA8452Q, MMA8453Q, MMA8652FC and MMA8653FC. -
- motor-driver - Motor drivers: L298N, TB6612FNG, etc.
- MPU6050 - I2C - no_std driver for the MPU6050
- MPU9250 - no_std driver for the MPU9250 (and other MPU* devices) & onboard AK8963 (accelerometer + gyroscope + magnetometer IMU)
- MS5637 - no_std I2C driver for the MS5637 temperature and pressure sensor
- NRF24L01 - SPI - 2.4 GHz wireless communication
- OneWire - 1wire - OneWire protocol implementation with drivers for devices such as DS18B20 -
- PCD8544 - SPI - 48x84 pixels matrix LCD controller
- PCD8544_rich - SPI - Rich driver for 48x84 pixels matrix LCD controller -
- PCF857x - I2C - I/O expanders: PCF8574, PCF8574A, PCF8575
- radio-at86rf212 - SPI - Sub GHz 802.15.4 radio transceiver
- RFM69 - SPI - ISM radio transceiver
- RN2xx3 - Serial - A driver for the RN2483 / RN2903 LoRaWAN modems by Microchip
- SCD30 - I2C - CO₂ sensor -
- SHT2x - I2C - temperature / humidity sensors
- SHT3x - I2C - Temperature / humidity sensors
- SI5351 - I2C - clock generator
- SI7021 - I2C - Humidity and temperature sensor
- SPL06-007 - I2C - Pressure and temperature sensor -
- spi-memory - SPI - A generic driver for various SPI Flash and EEPROM chips -
- SSD1320 - SPI - Graphical OLED display controller -
- SSD1322 - SPI - Graphical OLED display controller -
- SSD1322_rs - SPI - Async graphics driver for SSD1322 screen -
- SSD1351 - SPI - 16bit colour OLED display driver -
- SSD1675 - SPI - Tri-color ePaper display controller -
- st7032i - I2C - Dot Matrix LCD Controller driver (Sitronix ST7032i or similar). -
- ST7735-lcd - SPI - An embedded-graphics compatible driver for the popular lcd family from Sitronix
- ST7920 - SPI - LCD displays using the ST7920 controller
- stm32-eth - MCU - Ethernet
- SX1278 - SPI - Long range (LoRa) transceiver
- SX1509 - I2C - IO Expander / Keypad driver
- TCS3472 - I2C - RGB color light sensor -
- TPA2016D2 - I2C - A driver for interfacing with the Texas Instruments TPA2016D2 Class-D amplifier -
- VEML6040 - I2C - RGBW color light sensor -
- VEML6070 - I2C - UVA light sensor -
- VEML7700 - I2C - Ambient light sensors -
- vesc-comm - A driver for communicating with VESC-compatible electronic speed controllers
- VL53L0X - A platform agnostic driver to interface with the vl53l0x (time-of-flight sensor)
- w5500 - SPI - Ethernet Module with hardwired protocols : TCP, UDP, ICMP, IPv4, ARP, IGMP, PPPoE -
- xCA9548A - I2C - I2C switches/multiplexers: TCA9548A, PCA9548A -
- ublox-cellular-rs - Serial - Cellular driver for the full Ublox cellular serial based family
- atwinc1500-rs - SPI - A host driver for the Atwinc1500 network controller
- HX711 - GPIO - An interrupt-based driver for the HX711 Load Cell Amplifier IC. no-std.
- tmag5273 - Cross-platform no_std compatible i2c library for 3-axis Hall Effect sensor.
- paa5100je-pwm3901 - Cross platform no-std compatible spi async library for an Optical Flow Sensor.
#![no_std]
crates designed to run on resource-constrained devices.
- adskalman: Kalman filter and Rauch-Tung-Striebel smoothing implementation.
- arbitrary-int: This crate implements arbitrary numbers for Rust. Once included, you can use types like
u5
or u120
- atomic: Generic Atomic wrapper type.
- bbqueue: A SPSC, statically allocatable queue based on BipBuffers suitable for DMA transfers -
- bitmatch: A crate that allows you to match, bind, and pack the individual bits of integers. -
- biquad: A library for creating second-order IIR filters for signal processing based on Biquads, where both a Direct Form 1 (DF1) and Direct Form 2 Transposed (DF2T) implementation is available.
- bit_field: manipulating bitfields and bitarrays -
- bitbybit: macros that create bit fields and bit enums, which are useful in bit packing code (e.g. in drivers or networking code)
- bitfield-struct: Procedural macro for bitfields that allows specifying bitfields as structs
- bluetooth-hci: device-independent Bluetooth Host-Controller Interface implementation.
- bounded-registers A high-assurance memory-mapped register code generation and interaction library.
bounded-registers
provides a Tock-like API for MMIO registers with the addition of type-based bounds checking. -
- cam-geom: Geometric models of cameras for photogrammetry.
- combine: parser combinator library -
- console-traits: Describes a basic text console. Used by menu and implemented by vga-framebuffer.
cmim
, or Cortex-M Interrupt Move: A crate for Cortex-M devices to move data to interrupt context, without needing a critical section to access the data within an interrupt, and to remove the need for the "mutex dance" -
cmsis-dsp-sys
: Rust FFI bindings to the Arm CMSIS_5 math library -
- dcmimu: An algorithm for fusing low-cost triaxial MEMS gyroscope and accelerometer measurements
- debouncr: A simple no-std input debouncer to detect rising/falling edges with minimal RAM requirements.
- device-driver: A toolkit to write better device drivers, faster.
- drogue-device: A distribution of tools and examples for building embedded applications in Rust.
- dummy-pin: Dummy implementations of the input/output pin traits.
- crossbus: A Platform-Less, Runtime-Less Actor Computing Model.
- ector: An async actor framework for embedded, based on embassy.
- embassy: A set of embedded async tools to make async/await a first-class option for embedded development
- embedded-cli: CLI library with autocompletion, subcommands, options, help and history support.
- embedded-crc-macros: Macros implementing portable CRC algorithms and build-time lookup table generation.
- embedded-update: Pluggable firmware update protocol for embedded devices.
- embedded-tls: A TLS 1.3 implementation that runs in a no-std environment.
- embedded-websocket: A lightweight server and client websocket library for embedded systems.
- endian_codec: (En/De)code rust types as packed bytes with specific order (endian). Supports derive. -
- ethercrab: A Rust implementation of the EtherCAT industrial automation protocol -
- fixed-fft: Fixed-point Fast Fourier Transform -
- gcode: A gcode parser for no-std applications -
- gdbstub: zero-allocation, pure Rust implementation of the GDB Remote Serial Protocol -
- heapless: provides
Vec
, String
, LinearMap
, RingBuffer
backed by fixed-size buffers -
- idsp: integer DSP algorithms (trigonometry, filtering, PLL...) tuned for precision and speed -
- ieee802154: Partial implementation of the IEEE 802.15.4 standard -
- infrared: infrared remote control library for embedded rust -
- intrusive-collections: intrusive (non-allocating) singly/doubly linked lists and red-black trees -
- inverted-pin: Implementations of the input/output pin traits with inverted logic.
- irq: utilities for writing interrupt handlers (allows moving data into interrupts, and sharing data between them) -
- lakers: Microcontroller-optimized EDHOC implementation, with bindings for C and Python -
- lorawan-encoding: A LoRaWAN packet codec.
- lorawan-device: A LoRaWAN MAC implementation supporting both event-driven and async mode.
- managed: provides
ManagedSlice
, ManagedMap
backed by either their std counterparts or fixed-size buffers for #![no_std]
. -
- menu: A basic command-line interface library. Has nested menus and basic help functionality.
- micropb: Rust Protobuf library targetting embedded systems and no_std environments without an allocator. -
- mqtt-sn: Implementation of the MQTT-SN protocol -
- microfft: Embedded-friendly (
no_std
, no-alloc
) fast fourier transforms -
- micromath: Embedded Rust math library featuring fast, safe floating point approximations for common arithmetic operations, 2D and 3D vector types, and statistical analysis -
- miniconf: Lookup/enumerate/serialize/deserialize nodes in trees of heterogeneous structs/arrays by path/key -
- minimq: A minimal MQTT5 client designed for no_std platforms -
- moonboot: OTA Bootloader Construction Framework for Rust no_std environments, especially embedded devices without an OS
- nalgebra: general-purpose and low-dimensional linear algebra library -
- nom: parser combinator framework -
- null-terminated: generic null-terminated arrays -
- num-format: Crate for producing string representations of numbers, formatted according to international standards, e.g. "1,000,000" for US English -
- pc-keyboard: A PS/2 keyboard protocol driver. Transport (bit-banging or SPI) agnostic, but can convert Set 2 Scancodes into Unicode.
- qei : A qei wrapper that allows you to extend your qei timers from a 16-bit integer to a 64-bit integer. -
- qemu-exit: Quit a running QEMU session with user-defined exit code. Useful for unit or integration tests using QEMU. -
- RampMaker: Stepper Motor Acceleration Ramp Generator -
- register-rs: Unified interface for MMIO and CPU registers. Provides type-safe bitfield manipulation.
register-rs
is Tock registers with added support for CPU register definitions using the same API as for the MMIO registers. This enables homogeneous interfaces to registers of all kinds. -
- scapegoat: Safe, stack-only alternative to
BTreeSet
and BTreeMap
. -
- scroll: extensible and endian-aware Read/Write traits for generic containers -
- sized-dst: Owned container for dynamically-sized types (such as trait objects) backed by stack memory. -
- Slint: Declarative GUI framework that works on microcontrollers.
- smbus-pec: Minimal portable System Management Bus Packet Error Code calculation algorithm.
- smoltcp: a small TCP/IP stack that runs without
alloc
.
- sntpc: Rust SNTP client to get a timestamp from NTP servers. -
- static-bytes: Help work with buffers without dynamic allocation. Implement traits from bytes crate.
- Stepper: Universal Stepper Motor Interface -
- tinybmp: No-std, no-alloc BMP parser for embedded systems. Introductory blog post -
- vga-framebuffer: A VGA signal generator and font renderer for VGA-less microcontrollers. Used by Monotron to generate 48 by 36 character display using 3 SPI peripherals and a timer.
- usb-pd: USB-PD library, supports using the FUSB302B as a Sink driver, with Source functionality planned.
- wyhash: A fast, simple and portable hashing algorithm and random number generator. -
- adafruit-bluefruit-protocol: A
no_std
parser for the Adafruit Bluefruit LE Connect controller protocol. -
- wtx: Among other things, provides implementations to interact with HTTP, WebSockets and Databases.
Work in progress crates. Help the authors make these crates awesome!
There are many ways to handle panics in embedded devices, these crates provide helpful variants.
dont_panic
+ dont_panic_slice
: panic!()-like macro that causes linking error instead of panicking. May be used to statically ensure some code won't panic. +
no-panic
: Attribute macro to require that the compiler prove a function can't ever panic.
panic-abort
: Causes an abort on panics (nightly-only)
panic-halt
: Halts the processor on panics
panic-itm
: Prints the panic through the chip's ITM to a debugger attached to the SWO pin (Cortex-M with ITM only)
panic-never
: This crate guarantees that your application is free of panicking branches.
panic-persist
: A panic handler crate inspired by panic-ramdump
that logs panic messages to a region of RAM defined by the user, allowing for discovery of panic messages post-mortem using normal program control flow. -
panic-probe
: A panic handler that exits probe-run
with an error code.
panic-ramdump
: Writes the panic message into the beginning of RAM and enters an infinite loop; the message can be extracted by attaching a debugger (Cortex-M only)
panic-rtt
: Set the panicking behavior to log to a JLINK debugger and loop.
panic-rtt-target
: Logs panic messages over RTT. Uses rtt-target
.
panic-semihosting
: Prints the panic message via semihosting to an attached debugger (Cortex-M only)
rp2040-panic-usb-boot
: Save panic message in XIP RAM and reboot RP2040 to USB mode
- rmk: Mechanical keyboard firmware for stm32/rp2040, supports vial/dynamic keymap/eeprom, written in Rust
- anne-key: Alternate keyboard firmware for the Obins ANNE Pro
- μLA: Micro Logic Analyzer for RP2040
- air-gradient-pro-rs: Bootloader, firmware, and CLI tools for the AirGradient PRO
- Stabilizer: Firmware for a DSP tool used in quantum physics experimentation, includes telemetry via MQTT and run-time configuration
- Booster: Firmware for an RF power amplifier, including telemetry via MQTT and run-time configuration
- Thermostat EEM: Firmware for a multi-channel temperature controller used in physics experiments
- Card/IO ECG: Firmware for a business-card-sized ECG device with Wifi connectivity
- BillMock: Firmware for credit card terminal add-on hardware to install on Korean arcade machines
- LuLuu: Firmware for a custom RP2040-based display controller that streams animated images from a microSD card to a small LCD display.
- prinThor: 3DPrinter/CNC/Engraver firmware framework powered by rust embassy for stm32 families and rp2040.
Old books, blogs, and training materials
These materials may be outdated and reflect earlier practices, but they might still be helpful for reference.
This list is licensed under
Contribution to this crate is organized under the terms of the Rust Code of Conduct, the maintainer of this crate, the Resources team, promises to intervene to uphold that code of conduct.
RetroSearch is an open source project built by @garambo
| Open a GitHub Issue
Search and Browse the WWW like it's 1997 | Search results from DuckDuckGo
HTML:
3.2
| Encoding:
UTF-8
| Version:
0.7.4