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-01-31 00:18:28 UTC
- JSON Representation
https://github.com/quard/microbit-breakout-game
simple Breakout like game on micro:bit v2 using codebloks
microbit microcontroller nordicsemi
Last synced: 16 Dec 2024
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/hamsadev/ps2_keyboard
A library for initializing and buffering the inputs of any number of ps2 keyboards on any type of hardware
avr microcontroller ps2 ps2-keyboard stm32
Last synced: 14 Dec 2024
https://github.com/gmostofabd/8051-push-button
🔗 This repository guides you to learn about digital input reading using an 8051 Microcontroller. The program is written in Assembly language and well-commented to ensure clarity. To read the digital input, two tactile push button switches are connected to I/O pins.
8051 assembly circuit debouncing digital download hex input mcu microcontroller programming proteus pull-down pull-up read schematic simulation switch
Last synced: 19 Jan 2025
https://github.com/scootpl/uprint
uPrint (microPrint) is a simple TinyGo library to print text on OLED display. Drivers implementing 'drivers.Displayer' are supported. Tested on Raspberry Pi Pico and ssd1306.
microcontroller oled oled-display-ssd1306 pico raspberry-pi tinygo
Last synced: 19 Dec 2024
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/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/adamniederer/s12cpuv2-mode
A major mode for S12CPUV2 assembly language
assembly embedded freescale microcontroller s12cpuv2
Last synced: 05 Dec 2024
https://github.com/gmostofabd/8051-7segment
📦 This repository demonstrates how to interface a single-digit Seven-Segment Display (SSD) with the 8051 microcontroller using assembly language. A common cathode SSD is utilized in this project, with all necessary files provided, including assembly code, Proteus simulation files, HEX files, and photos from testing. Later we included 2 digits exam
8051 assembly bcd-to-7-segment circuity common-anode-display common-cathode decoder file hex microcontroller programming proteus schematic seven-segments-display simulation ssd
Last synced: 19 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/gmostofabd/8051-lcd
📚 This repository demonstrates how to interface a 16x2 alphanumeric LCD with the 8051 Microcontrollers (AT89S52) using Assembly Language Programming. The project is designed to showcase a practical example of sending data from the 8051 microcontroller to an LCD and includes Proteus simulation files for testing, modify, debug and visualization.
4bit 8051 8bit assembly circuit code download experiment hex interfacing language lcd microcontroller mode programming proteus simulation
Last synced: 19 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/lost-hope/8-8-8-rgb-led-cube
cube led matrix microcontroller rgb
Last synced: 23 Jan 2025
https://github.com/isaacalves7/cpp
🅲➕➕ It's a repository of C/C++ programming language and his content.
arduino blueprint c c-language c-plus-plus cpp microcontroller microcontroller-programming unreal-engine
Last synced: 06 Dec 2024
https://github.com/sourceduty/raspberry_pi
🥧 Raspberry Pi (Rpi) single-board computers.
ai artificial-intelligence cyberpi development electrical electronic electronic-engineering electronics hardware microcontroller pi pi-ai pi-automation pi-board pi-hardware pi-project raspberry-pi rpi
Last synced: 10 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/emilienmendes/systemeembarque
Utilisation d'une librairie pour controler un microbit
bare-metal microbit microcontroller
Last synced: 06 Dec 2024
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/jmcph4/cpu2
The spiritual successor of my previous CPU simulator
architectural-simulation architecture cpu machine-code microcontroller microprocessor simulation
Last synced: 24 Dec 2024
https://github.com/nikolailehbrink/biometric-attendance-system
Microcontroller-based system for fingerprint verification.
fingerprint-authentication microcontroller study-project verification
Last synced: 06 Dec 2024
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/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/tyriis/esphome-config
ESPHome configuration for my smarthome
automation configuration esp32 esp8266 esphome microcontroller smarthome
Last synced: 14 Dec 2024
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/lucasfturos/tcc-controle-de-maquina
Projeto focado em demonstrar a comunicação serial entre computador e microcontrolador
c cpp microcontroller qt5 serialport
Last synced: 12 Dec 2024
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/nullobject/pbasm
An assembler for the PicoBlaze microcontroller.
assembler fpga haskell microcontroller picoblaze
Last synced: 28 Dec 2024
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: 17 Dec 2024
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/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/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/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/nateseymour/viper-rtos
RTOS for Cortex-M Profile Microcontrollers
arm cortex-m embedded embedded-cpp microcontroller rtos
Last synced: 11 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/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/piotrweppo/6_axis_arduino_robot_arm_pl
Hobbystyczny robot 6-osiowy oparty o serwonapędy
arduino electronics microcontroller robotics servo-motor
Last synced: 17 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/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/marcin-filipiak/pic16f87_binary_clock
Binary clock based on PIC16F87
binary-clock electronics gadget microcontroller pic16f
Last synced: 18 Dec 2024
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/hiperiondev/ladderlib
Library for execute ladder programs
ladder ladder-logic library microcontroller
Last synced: 21 Jan 2025
https://github.com/moritznelle/rx_passive_thermal_gct
esp32 espnow microcontroller platformio scientific-device vscode
Last synced: 18 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/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: 18 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: 05 Dec 2024
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/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/ibrahimelmokhtar/physicalcalculator
Physical calculator implementation using TivaC micro-controller
c college-project microcontroller tiva-c
Last synced: 01 Jan 2025
https://github.com/patsaoglou/stm32minidevboard
Mini Development Board featuring a STM32 MCU and designed using Altium Designer
altium development-board mcu microcontroller pcb-design stm32
Last synced: 27 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://gitlab.com/WiLED-Project/uencoder
A MicroPython library for reading from a rotary encoder
embedded encoder microcontroller microprocessor micropython rotary rotary encoder
Last synced: 18 Nov 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/darishsfit/parkbuddy
IOT based Smart Parking System using NodeMCU and Firebase Cloud Storage
arduino cpp esp8266 firebase firebase-realtime-database iot microcontroller nodemcu sensors
Last synced: 10 Oct 2024
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/milind-ranjan/automated-guitar-tuner
Automated Guitar Tuner: An Arduino-based project that uses a stepper motor and FFT analysis to automatically tune a guitar. The system captures and analyzes the guitar string’s frequency, adjusts the tuning peg, and ensures each string is perfectly in tune.
arduino arduino-uno audio-processing fastfouriertransform guitar-tuner microcontroller stepper-motor
Last synced: 10 Oct 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/vladak/fusebox
adafruit circuitpython electricity-consumption microcontroller mqtt sensors
Last synced: 19 Dec 2024
https://github.com/veerajkute/automatic-guitar-tuner
An automatic guitar tuner built using an Arduino microcontroller. This project leverages a microphone to capture the sound of a guitar string and uses a Fast Fourier Transform (FFT) algorithm to detect the frequency. The Arduino then controls a servo motor to adjust the tuning peg until the string reaches the desired pitch.
arduino fastfour fft microcontroller music signal-processing stepper-motor
Last synced: 10 Oct 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/qc20/haptic-game-for-the-blind
HapNav is an innovative, ESP32-based game designed to empower the visually impaired. By using joystick navigation, it enhances spatial awareness and provides inclusive gaming experiences. Join us in this project to make gaming accessible for all!
3d-printing accessibility arduino blind cad cpp esp32 game-development haptic-feedback haptics human-computer-interaction interaction-design iot joystick-control microcontroller prototyping remote sensors tactile tactile-feedback
Last synced: 08 Nov 2024
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/jubayer98/smart-street-lighting-system-pic-microcontroller-16f676
The project focuses on developing a smart street light system that activates lights as needed and turns them off when they are not required.
low-level-programming microcontroller
Last synced: 11 Jan 2025
https://github.com/smrenato/microcontroladores-esp32
Repositorios para as praticas da diciplina de Microcontroladores
c esp-idf esp32 esp8266 microcontroller
Last synced: 10 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/mkner/arduino-device-controller-design
arduino microcontroller design for devices and robots
7-segment-display actuators arduino microcontroller sensors ti-74hc595-shift-register
Last synced: 13 Jan 2025
https://github.com/ershubhambhagat/motor-control-using-esp8266
This project uses the ESP8266 microcontroller to create a Wi-Fi network and host a web page for controlling a water tank motor. The ESP8266 operates as a standalone access point, allowing you to connect to its network with your phone and access the control interface.
arduino-ide captive-portal dns-server electronics ershubhambhagat esp8266 iot iot-application microcontroller
Last synced: 26 Jan 2025
https://github.com/chdanielmueller/button-with-3-leds
Sample Code for a Teensy 4.1 with a Button with 3 LEDs attached
Last synced: 13 Jan 2025
https://github.com/chdanielmueller/14-segment-display
Sample Code for a Teensy 4.1 with a 4 character/digit 14 Segment Display attached
14segment display microcontroller teensy
Last synced: 13 Jan 2025
https://github.com/giansalex/bootloader-pic
Pic Microcontroller Bootloader serie 16F
microcontroller pic16f887 picc
Last synced: 20 Dec 2024
https://github.com/omerkel/microcontroller_aggregated_stuff
Hosting some microcontroller related stuff
arduino esp32 esp32-arduino microcontroller micropython raspberry-pi raspberry-pi-pico
Last synced: 28 Dec 2024
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/labatata101/oximeter-esp32-firmware
Firmware for an oximeter monitor using the ESP32 microcontroller and the MAX30100 sensor
c cpp esp32 max30100 microcontroller oximeter
Last synced: 20 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/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/labatata101/oximeter-monitor
Oximeter monitor project using the ESP32 microcontroller and the MAX30100 sensor
bot c cpp esp32 fastapi max30100 microcontroller oximeter python rest-api telegram-bot
Last synced: 20 Jan 2025
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/abdellatuf/18f452-microcontroller
list of pic18f452 programs with simulation
assembly bare-metal c18 compiler embedded hardware microchip microcontroller pic pic18f pic18f452 programming projects
Last synced: 20 Dec 2024
https://github.com/c-not-around/lc-meter
High-precision capacitance and inductance meter based on the generator method of LC measurement.
atmega8 atmel-studio avr-gcc high-precision lcd1602 microcontroller pcb-layout proteus-model
Last synced: 11 Jan 2025
https://github.com/ole1986/pic18f-morsecode
PIC example code to translate ASCII text into morse code blinking LED using serial connection (UART)
microchip-pic microcontroller morse-code pic pic18f
Last synced: 11 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/sshahryiar/atsamd21g18a-micropython-on-atmel-arm
My MicroPython projects with ATSAMD21G18A
adafrui arm atmel atsamd21 atsamd21g18a cortex-m0 featherm microchip microcontroller micropython samd21 samd21g18a
Last synced: 23 Dec 2024
https://github.com/f3riend/simpleesp8266-server
Simple Esp8266 web server led example with fake wifi
esp8266 esp8266-projects esp8266-webserver led-controller microcontroller micropython
Last synced: 10 Jan 2025
https://github.com/huangcongqing/microcontrollers-c
C framework for different microcontrollers用C语言写的单片机程序
Last synced: 15 Dec 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/rohankalbag/assembly
Microprocessors Lab - Spring Semester 2022 - Indian Institute of Technology Bombay
8051-assembly at89c5131a embedded-c keil-uvision5 microcontroller microprocess pt-51 uart
Last synced: 11 Jan 2025
https://github.com/aerphanas/microcontroller-programming
Learning Microcontroller programming
Last synced: 20 Dec 2024
https://github.com/xstupi00/Morse-Code-Encoder
Morse Code Encoder at development board FITkit3 with an external keyboard. The application was developed in MCUXpresso IDE v10.2.1.
arm c fitkit3 imp mcu mcuexpresso microcontroller morse-code nxp vut vut-fit
Last synced: 23 Oct 2024
https://github.com/macaron99/arduino-mega-lab
This repository contains various projects developed using the Arduino platform. Each project explores different aspects of microcontroller programming, sensor interfacing, and hardware control using Arduino boards.
Last synced: 19 Dec 2024