Ecosyste.ms: Awesome
An open API service indexing awesome lists of open source software.
Microcontroller
Microcontrollers are small computers on a single integrated circuit, containing a processor, memory, and input/output peripherals. They are widely used in embedded systems for performing specific control functions efficiently. Applications of microcontrollers include robotics, IoT, and home automation. Popular examples include Arduino, ESP32, and Raspberry Pi Pico.
- GitHub: https://github.com/topics/microcontroller
- Wikipedia: https://en.wikipedia.org/wiki/Microcontroller
- Related Topics: embedded-systems, robotics, arduino, iot, home-automation, esp32, raspberry-pi-pico,
- Aliases: mcu, microcontrollers, micro-controllers, micro-controller,
- Last updated: 2025-02-12 00:18:45 UTC
- JSON Representation
https://github.com/amruthapatil/nyu-justbreathe
This project implements a prototype of an embedded system that can determine if a person has stopped breathing for more than 10 seconds, triggering an alert. It is designed to address the need for real-time monitoring of infants to prevent Sudden Infant Death Syndrome (SIDS).
cpp embedded-systems microcontroller platformio
Last synced: 20 Jan 2025
https://github.com/gmostofabd/8051-analog
📈 This repository guides you through reading an analog value from a potentiometer using the 8051 Microcontroller. As our controller does not have internal ADC, we need to convert the analog voltage to its binary equivalent externally. Next, we will connect the binary port to our 8051 microcontroller digital input pins.
8051 ad0804 analog analogtodigital assembly bbargrapg binary circuit converter led microcontroller potentiometer programming proteus simulation
Last synced: 19 Jan 2025
https://github.com/mateomor/firefightercar
A firefighter car code for ESP32
car esp32 hardware microcontroller
Last synced: 20 Jan 2025
https://github.com/gmostofabd/8051-stepper-motor
🛠️ This repository demonstrates how to interface a stepper motor with the 8051 microcontroller using the ULN2003 driver to handle the extra current required to run the motor. The project includes complete assembly code, Proteus simulation files, and documentation, along with screenshots and photos from testing.
8051 assembly circuit download driver file hex language microcontroller motor programming proteus simulation steeper stepper-motor uln2003
Last synced: 19 Jan 2025
https://github.com/hiperiondev/ladderlib
Library for execute ladder programs
ladder ladder-logic library microcontroller
Last synced: 21 Jan 2025
https://github.com/thotypous/mikrostm-link
Link together gcc and mikroC projects for STM32
gcc linker microcontroller mikroc
Last synced: 23 Jan 2025
https://github.com/gmostofabd/8051-dc-motor
👨💻 This repository demonstrates how to interface a DC motor with the 8051 microcontroller using the L298 driver to handle the extra current required to run the motor. The project includes complete assembly code, Proteus simulation files, and documentation, along with screenshots and photos from testing.
8051 assembly circuit code dc description design download file hex microcontroller motor programming proteus schematics simulation
Last synced: 19 Jan 2025
https://github.com/jonpalmisc/avr_yaml
AVR architecture info in YAML format
atmel avr microcontroller yaml
Last synced: 19 Jan 2025
https://github.com/amid68/arduino-electronic-die
An Arduino-based electronic die project with two implementations: Arduino IDE and pure embedded C for demonstrating microcontroller programming.
7-segment-display arduino electronics embedded-c microcontroller
Last synced: 07 Jan 2025
https://github.com/kathleenwest/micromouse
This final report summarizes the final progress of the MicroMouse senior project team and clarifies the ultimate design solution by first discussing the problem definition, posed solution, and benefits of implementation. Secondly the as built specifications address the mechanical and electrical technical specifications which include drawings, diagrams, and schematics that illustrate the final constructed MicroMouse. Each design requirement is then addressed and verified by test results. Lastly, the final report includes a concluding cost analysis of the project. Overall, the MicroMouse meet most of the system design requirements and was under budget with a cost of only $394.60.
interactive-c maze-algorithms maze-generation-algorithms maze-solver microcontroller micromouse robotics schematics senior-design
Last synced: 23 Jan 2025
https://github.com/victhem/infrared-thermal-imager
A device that generates thremal images of the human body and sends to any http client connected to it
amg8833 cpp esp32 microcontroller
Last synced: 06 Feb 2025
https://github.com/s4b7r/at-ir-comm
Old first steps in AT µC development, playing with transmission via IR
Last synced: 31 Dec 2024
https://github.com/newir295/ros_pid_tunning
PID tunning for motors using ROS
encoder microcontroller motor motor-dr pid-control ros ros-noetic
Last synced: 03 Feb 2025
https://github.com/moritznelle/hsi-analysis
arduino arduino-ide fiji-macro image-analysis imagej-macro microcontroller
Last synced: 26 Jan 2025
https://github.com/hasibzunair/glass-finder
arduino device microcontroller sensor tinkercad
Last synced: 08 Jan 2025
https://github.com/andre-marcos-perez/sel0433_microprocessoraplications
Algorithms for the course Application of Microprocessors I - SEL | EESC | USP
8051 assembly c electrical-engineering intel microcontroller university-course
Last synced: 09 Feb 2025
https://github.com/jonathspirit/gp8b
G_Processor8Bits a homemade without any microcontroller 8bits processor
8bit 8bits 8bits-processor cern-ohl cern-open-hardware computer cpu custom hardware homemade kicad microcontroller processor retrocomputing
Last synced: 08 Jan 2025
https://github.com/jonathspirit/gtag
A small adaptation card for the silicon-labs JTAG Debug adapter
adaptation adaptation-card cern-ohl homemade kicad microcontroller silicon-labs simple
Last synced: 08 Jan 2025
https://github.com/hr-fahim/atmega328-microcontroller-code-implementation
The purpose of this project was to implement code for an ATmega328 microcontroller system in order to comprehend the fundamental principles of the relationship between software and hardware.
microcontroller operating-systems
Last synced: 14 Jan 2025
https://github.com/quard/microbit-breakout-game
simple Breakout like game on micro:bit v2 using codebloks
microbit microcontroller nordicsemi
Last synced: 08 Feb 2025
https://github.com/prinuvinod/mp-mc
These are programs for Microprocessor and Microcontroller. Language used is Assembly Language.
asm assembly-language microcontroller microprocessors
Last synced: 06 Jan 2025
https://github.com/vooon/docker-firmware-ota-arm
Docker image for building my firmwares by gitlab-ci
armv7 docker-image environment firmware gitlab-ci microcontroller
Last synced: 08 Jan 2025
https://github.com/marcin-filipiak/pic16f87_binary_clock
Binary clock based on PIC16F87
binary-clock electronics gadget microcontroller pic16f
Last synced: 10 Feb 2025
https://github.com/huangcongqing/microcontrollers-c
C framework for different microcontrollers用C语言写的单片机程序
Last synced: 08 Feb 2025
https://github.com/jwillikers/fan-controller-circuitpython
A simple program to set the speed of a fan using the RP2040 QT Py and the EMC2101 fan controller
circuitpython emc2101 fan microcontroller pipkin python qt-py rp2040
Last synced: 31 Dec 2024
https://github.com/int-brain-lab/tycmd-wrapper
A Python wrapper for tycmd
firmware firmware-tools microcontroller python teensy teensy-board
Last synced: 08 Nov 2024
https://github.com/gyeonghokim/8051_snake
Intel MCS-51 Arcade Console
8051 asm embedded-systems microcontroller snake-game
Last synced: 29 Dec 2024
https://github.com/lily-osp/micropython-on-esp8266
Here is an example of how you could write the instructions for burning MicroPython firmware to an ESP8266 microcontroller
esp8266 microcontroller micropython micropython-esp8266 python
Last synced: 20 Jan 2025
https://github.com/sarincr/introduction-to-edge-analytics
Edge analytics is an approach to data collection and analysis in which an automated analytical computation is performed on data at a sensor, network switch or other device instead of waiting for the data to be sent back to a centralised data store.
algorithm algorithms algorithms-and-data-structures arduino arduino-ide arduino-library arm artificial-intelligence avr data-science dataanalytics datastuctures deep-learning edge-ai edge-computing embedded-systems iot machine-learning microcontroller neural-network
Last synced: 21 Jan 2025
https://github.com/johassel/exo_ui
Exoskeleton UI (TU Berlin RISE SoSe 2023)
3d-printing exoskeleton microcontroller teensy ui-design
Last synced: 09 Jan 2025
https://github.com/mastashake08/shake-rp2350
Nuxt 3 Web app for interacting with the RP2350 microcontroller from Raspberry Pi includes a code editor
microcontroller micropython nuxt raspberry-pi
Last synced: 01 Feb 2025
https://github.com/neurarian/arduino-weatherstation-improved
My personal extension to the weatherstation plug and make kit project.
arduino arduino-uno-r4-wifi microcontroller weather-forecast weather-station
Last synced: 25 Jan 2025
https://github.com/olivier-boesch/circuitpython-au-lycee
Les microcontrôleurs et python au lycée : matériel, logiciels et TPs
circuitpython education lycee microcontroller python3
Last synced: 24 Jan 2025
https://github.com/lost-hope/8-8-8-rgb-led-cube
cube led matrix microcontroller rgb
Last synced: 23 Jan 2025
https://github.com/unkn0wnn4m3/microcontroladores
👨💻
arduino arduino-uno atmega328p atmel atmel-avr atmel-studio avr c clangd microcontroller
Last synced: 25 Dec 2024
https://github.com/qc20/tromino
Tromino is an engaging, pocket-sized interpretation of the classic Tetris game, designed for the Arduino Uno with an LCD shield. This project explores the intersection of physical computing, game design, and user interaction in constrained environments.
arduino arduino-uno cpp embedded-systems game-development hci interaction-design lcd-display lcd16x2 microcontroller physical-computing puzzle-game retro-gaming tetris tromino user-experience user-interface
Last synced: 31 Dec 2024
https://github.com/qc20/diy-arduino-controller
Explore our repository showcasing ATMega328 programming beyond Arduino. We offer diverse code examples to inspire enthusiasts. Our project presents a slim, versatile DIY Arduino board, prioritizing accessibility and cost-effectiveness for educational and practical use.
adaptable arduino atmega328p cpp diy-arduino fabrication human-computer-interaction interaction-design iot led-controller microcontroller portability prototyping rgb-led ux-research
Last synced: 31 Dec 2024
https://github.com/lily-osp/esp32-waveform-generator
This project implements a versatile waveform generator using an ESP32 microcontroller. It generates various types of waveforms with adjustable parameters such as frequency, amplitude, and phase. Additionally, it features sweep and burst modes for more complex signal generation.
arduino esp32 frequency microcontroller waveform
Last synced: 20 Jan 2025
https://github.com/frozen-burrito/practica2_pmym
Código de MSP430G2 para controlar un carrito RF.
bluetooth microcontroller msp430g2553 radio robot-car
Last synced: 10 Feb 2025
https://github.com/moritznelle/rx_passive_thermal_gct
esp32 espnow microcontroller platformio scientific-device vscode
Last synced: 18 Jan 2025
https://github.com/junxian428/intel8051_mcs-51
Learning Intel8051/ MCS-51 Microcontroller
Last synced: 21 Jan 2025
https://github.com/lnxpy/7segment
🔢 Seven Segment Schema on Atmega64
7seg 7segment atmega atmega16 atmega32 atmega64 atmel avr isis-professional microcontroller microprocessor visual
Last synced: 17 Jan 2025
https://github.com/et1975/stm32l4x5
(WIP) Peripheral access API for STM32L4x5 microcontrollers
arm cortex-m microcontroller no-std peripherals rust stm32 svd2rust
Last synced: 23 Dec 2024
https://github.com/ayeshathoi/cse-315-practice-codes
Proteus Simulation Practices
cpp embedded-systems hardware-designs microcontroller microprocessor proteus-8 simulation-modeling
Last synced: 02 Jan 2025
https://github.com/chayanforyou/studentprojects
electronics hardware microcontroller projects robotics
Last synced: 14 Jan 2025
https://github.com/henriquesebastiao/micro
Studies with microcontroller devices
arduino arduino-sketch arduino-uno microcontroller
Last synced: 17 Jan 2025
https://github.com/ljnath/esp32-micropython
Micropython programs running on ESP32 microcontroller
esp32 esp32-arduino esp32-wifi esp32-wroom led-controller microcontroller micropython micropython-esp32 oled-display oled-display-ssd1306 oled-ssd1306 python ssd1306 ssd1306-oled wifi-network wireless-network
Last synced: 10 Jan 2025
https://github.com/lnahrf/agns_receiver
ESP32 Firmware for the AGNS Pump (Autonomous Garden Node System)
api arduino cpp esp-now esp32 microcontroller microcontrollers platformio rest restapi rf
Last synced: 22 Nov 2024
https://github.com/hafizcode02/safety-box
Microcontroller Final Project - Safety Box
arduino microcontroller robotics-project
Last synced: 03 Feb 2025
https://github.com/hansang-lee/atmega328p
Technical University of Chemnitz, Summer-Semester, 2019
atmega328p bitwise-operations c-project embedded-c microcontroller minicom network-programming raspberry-pi-2 serial-communication tu-chemnitz uart-protocol
Last synced: 29 Dec 2024
https://github.com/davang/esp-davang
My esp-idf libraries
adc dac esp-idf esp-idf-component esp32 gpio i2c linux microcontroller pwm spi uart windows-10
Last synced: 22 Dec 2024
https://github.com/urfdvw/circuitpython-online-ide-2
The CircuitPython Online IDE is a browser-based IDE for CircuitPython supported microcontrollers. No installation needed. Handy and powerful.
circuitpython editor ide microcontroller plotting python repl
Last synced: 08 Feb 2025
https://github.com/armanghobadi/uwifi
uwifi is a MicroPython Wi-Fi management library for ESP32/ESP8266, supporting STA/AP modes, static IPs, network scanning, ping tests, and retry logic. It's ideal for IoT and embedded Wi-Fi applications.
esp32 esp8266 microcontroller micropython network wifi wifi-network
Last synced: 17 Jan 2025
https://github.com/armanghobadi/microjwt
MicroJWT is a lightweight JSON Web Token (JWT) library for MicroPython, using HMAC-SHA256 for token signing. It embeds user data like username and role, enabling secure authentication on microcontrollers like ESP8266 and ESP32.
esp32 esp8266 jwt jwt-auth jwt-authentication jwt-token microcontroller micropython
Last synced: 17 Jan 2025
https://github.com/tyriis/esphome-config
ESPHome configuration for my smarthome
automation configuration esp32 esp8266 esphome microcontroller smarthome
Last synced: 07 Feb 2025
https://github.com/carloscraveiro/pic_sevensegdisplaycounter
A project for learning purposes in C programming language for PIC18F that explores the following features: interrupts, timing, input and output ports (I/O), and peripherals (buttons, LEDs and 7-segment displays).
c microcontroller nix nix-flake pic18f pic18f4550 sdcc-compiler seven-segments-display simulation simulide
Last synced: 24 Dec 2024
https://github.com/flyer-dm/arduino_mini_projects
Мини-схемы для микроконтроллеров со скриптами на C++
arduino cpp microcontroller mini-projects physical-devices
Last synced: 25 Jan 2025
https://github.com/streamingtime/barmband
Barmband is a wearable wristband designed to gamify social interactions.
cpp esp32 golang microcontroller platformio
Last synced: 30 Jan 2025
https://github.com/epeios-q37/ucuq
For easy prototyping of projects based on Wi-Fi-equipped microcontrollers (RPi Pico (2) W, ESP32, ESP8266...).
esp32 esp8266 iot microcontroller micropython prototyping python raspberry-pi-pico remote-control wifi
Last synced: 26 Jan 2025
https://github.com/nishit0072e/vsd-mini
This Repository solely made for the Research Internship using VSDSquadron Mini RISC-V Development Board
ch32v003 codespaces microcontroller platformio risc-v virtualbox
Last synced: 24 Dec 2024
https://github.com/mcuw/samd21-blinky-example
Firmware for Atmel SAM D21 Pro with Zephyr and platformio
atmel blinky d21 firmware microchip microcontroller platformio samd21 vscode zephyr
Last synced: 21 Dec 2024
https://github.com/paulo9mv/esp8266_interruption_gpio
Toggle LEDs by external interruptions
c esp esp8266 external-interrupts gpio gpio-pins interrupts microcontroller
Last synced: 24 Dec 2024
https://github.com/riyasach189/esd-2024-project
STM32 Nucleo-G070RB based Micro Mouse that runs on Wall Follower algorithm
microcontroller micromouse-maze-solver stm32 stm32cubeide
Last synced: 10 Jan 2025
https://github.com/de-dh/webremote-mpy
WebRemote provides a simple web interface for recording and transmitting 433 MHz signals commonly used by remote controlled power plugs.
433mhz microcontroller micropython raspberry-pi-pico
Last synced: 25 Dec 2024
https://github.com/bytewizer/boards
Fez single board computers libraries built for GHI Electronics TinyCLR OS.
arduino csharp dependency-injection iot logging microcontroller nanoframeowork netmf sitcore tinyclr
Last synced: 05 Jan 2025
https://github.com/sadegh15khedry/atmega16-projects
AVR codes in C for atmega16 micro processor
atmega16 avr c frequency-measurement lm35 microcontroller motor rtc spi ultrasonic usart
Last synced: 10 Jan 2025
https://github.com/rddevitte/simplest-avr-projects
ATmega and ATtiny starter projects, as simple as they can be
arduino atmega328p atmel attiny85 avr avr-libc microcontroller
Last synced: 26 Dec 2024
https://github.com/craigsdennis/adafruit-microsimon
Game of Simon in MicroPython on adafruit Circuit Playground Express
adafruit circuit-playground game microcontroller micropython
Last synced: 28 Dec 2024
https://github.com/levyanjos/arduino_esp8266
A basic wifi blink with esp8266MOD (nodemcu)
arduino basic blink esp8266 microcontroller nodemcu
Last synced: 02 Jan 2025
https://github.com/pakequis/protoconn
A PROTOtype board with CONNectors for electronic test and development
arduino breadboard electronics esp32 kicad microcontroller pcb prototype raspberry-pi
Last synced: 12 Jan 2025
https://github.com/berru-g/make-play
Website
ableton arduino atmega328p microcontroller usb-midi
Last synced: 28 Nov 2024
https://github.com/dominhduy09/atmega32-miniproject
atmega32-miniproject | Student study to review for final exam
atmega atmega32 atmega32-miniproject atmega8 atmel atmel-studio micro microcontroller microcontroller-firmware microcontroller-programming microcontroller-simulation microcontrollers
Last synced: 26 Dec 2024
https://github.com/brianlesko/dualsense-car-control
Drive a modified RC car over wifi using a PS5 remote
c hardware microcontroller python robotics server tcp udp
Last synced: 26 Dec 2024
https://github.com/notyusheng/travel-sensor
Develop a portable, self-sustaining environmental monitoring device powered by ambient energy sources
3d-models autocad autocad-electrical electronics inventor iot microcontroller raspberry-pi sustainability telegram-bot
Last synced: 05 Jan 2025
https://github.com/craigsdennis/adafruit-zipit
Volume and Patience monitor for parents using Adafruit Circuit Board Express
makecode microcontroller noise-detection patience-monitor pxt typescript
Last synced: 28 Dec 2024
https://github.com/electrobug14/vegetable_detection
About An AI model has been implemented to detect potato, onion & tomato on a resource constrained hardware
ai esp32camera microcontroller oled-ssd1306 platformio tensorflow-lite
Last synced: 01 Feb 2025
https://github.com/newir295/n_turtlebot
Final Project For Advanced Robotics And Artificial Inteligence At faculty of Engineering - Cairo University
imu-sensor lidar-slam microcontroller platformio robotics robotics-algorithms robotics-control robotics-kinematics robotics-programming robotics-simulation ros ros-noetic rosserial-arduino
Last synced: 10 Feb 2025
https://github.com/atoomnetmarc/reset-timeout
Prevent microcontroller reset after power-on using an extra tiny microcontroller.
Last synced: 03 Feb 2025
https://github.com/m3y54m/autcup-2015-robot-at-factory
Source Code and Embedded Design of Our Factory Robot at AUTCup 2015 Competitions
atmega atmel control embedded microcontroller navigation pcb robot robotics
Last synced: 21 Jan 2025
https://github.com/m3y54m/pcb-usbtinyisp
USBTinyISP AVR Programmer SMD Version
altium avr diy microcontroller pcb programmer schematics smd usbtinyisp
Last synced: 21 Jan 2025
https://github.com/lemongrb/software_pwm_generator
This implementation is useful in case where dedicated PWM hardware is unavailable.
c18-compiler ccp microchip microcontroller pic pic18f pic18f452 programming pwm pwm-duty-cycle software
Last synced: 10 Jan 2025
https://github.com/lemongrb/thermospin
Temperature-Activated Motor Speed Regulation
c18 control-systems lcd lm35 microcontroller pic pic18f pic18f452 pwm sensor temperature
Last synced: 10 Jan 2025
https://github.com/m3y54m/my-old-avr-code
My old basic programs written for AVR microcontrollers
atmel-studio avr codevision microcontroller robotics
Last synced: 21 Jan 2025
https://github.com/ishivanshgoel/maze-solving-robot
Maze solving robot made for ROBO-CHALLENGE 2020(Team Bravo: Programming Department: Shivansh Goel, Anika Jagati, Koushiki Mukherjee, Yuvraj Singh
arduino cpp flask microcontroller python robotics
Last synced: 10 Jan 2025
https://github.com/kemfic/dotkb
custom keyboard
arduino cpp design hardware keyboard microcontroller pcb qmk
Last synced: 10 Jan 2025
https://github.com/a-bdellatif/software_pwm_generator
This implementation is useful in case where dedicated PWM hardware is unavailable.
c18-compiler ccp microchip microcontroller pic pic18f pic18f452 programming pwm pwm-duty-cycle software
Last synced: 03 Feb 2025
https://github.com/ortanav2/integrated-circuit-emulator
Texas Instruments Intergrated Circuit Based Computer. ESP8266 Controller Code / Assembly Code / IC-Emulator
assembly-language controller datasheet emulator esp8266 integrated-circuits logic-gates microcontroller
Last synced: 10 Feb 2025
https://github.com/armanghobadi/esplog
esplog is a lightweight MicroPython logging system with support for severity levels, console and file outputs, log rotation, and color-coded or JSON logs. It’s optimized for resource-constrained microcontrollers.
esp32 esp8266 logger microcontroller micropython
Last synced: 21 Jan 2025
https://github.com/a-bdellatif/thermospin
Temperature-Activated Motor Speed Regulation
c18 control-systems lcd lm35 microcontroller pic pic18f pic18f452 pwm sensor temperature
Last synced: 03 Feb 2025
https://github.com/epeios-q37/ucuq-python
For easy prototyping of projects based on Wi-Fi-equipped microcontrollers (RPi Pico (2) W, ESP32, ESP8266...).
esp32 esp8266 iot microcontroller micropython prototyping python raspberry-pi-pico remote-control wifi
Last synced: 21 Jan 2025
https://github.com/moritznelle/archery_clock_rx
This code is meant for a recivingunit in the archery clock network
archery-clock esp32 microcontroller platformio vscode
Last synced: 18 Jan 2025
https://github.com/amirhoseinmasoumi/cubesat-obc
CubeSat OBC with ARM Cortex-M4 MCU.
altium altium-designer arm arm-cortex-m4 cubesat cubesatellite microcontroller obc pcb pcb-design stm32
Last synced: 04 Jan 2025
https://github.com/eslam-abdo/mia_pcb_portfolio
This portfolio showcases the PCB designs created by the M.I.A technical team from Alexandria University. The team has participated in various robotics competitions such as MATEROV, Robocon, and Minesweeper. I have contributed to the team's designs as a member of the ABU Robocon team.
circuit circuit-design eagle eagle-cad eagle-pcb electronics embedded embedded-hardware embedded-systems fusion360 hardware hardware-designs microcontroller pcb pcb-design pcb-footprints pcb-layout robocon robocon-2019 robotics
Last synced: 18 Jan 2025
https://gitlab.com/WiLED-Project/upwmcontroller
A MicroPython library for controlling PWM outputs in an asyncio loop, with features including fading and blinking
PWM async asyncio embedded fade led microcontroller microprocessor micropython uasyncio
Last synced: 18 Nov 2024
https://github.com/ilyachichkov/freeos_uart_transactions
Transactions system for sending data by UART and using FreeOS
c freertos low-level microcontroller uart
Last synced: 04 Jan 2025
https://github.com/smrenato/microcontroladores-esp32
Repositorios para as praticas da diciplina de Microcontroladores
c esp-idf esp32 esp8266 microcontroller
Last synced: 04 Feb 2025