An open API service providing repository metadata for many open source software ecosystems.

GitHub topics: ultrasonic-sensor

shaya-lr/AI-powered-Waste-sorting-System

An AI and IoT-based system that automates waste segregation and real-time bin monitoring for smarter waste management.

Size: 2.93 KB - Last synced at: about 6 hours ago - Pushed at: about 7 hours ago - Stars: 0 - Forks: 0

ShivtejG236/arduino-projects

🛠️ A curated collection of beginner-to-intermediate Arduino projects demonstrating sensor-based automation, motor control, and microcontroller programming.

Language: C++ - Size: 0 Bytes - Last synced at: 1 day ago - Pushed at: 1 day ago - Stars: 0 - Forks: 0

mijay6/Automatic-Water-Dispenser-with-Arduino

An automatic water dispenser using Arduino that provides efficient and precise water dispensing into containers. The system eliminates manual pouring and prevents overflow, ensuring economical water usage. Developed as an academic project at Politehnica University of Timișoara.

Language: C++ - Size: 127 MB - Last synced at: 4 days ago - Pushed at: 5 days ago - Stars: 0 - Forks: 0

joemathew2004/Smart-Vision-Guide Fork of Jokku-gamma/Blind-AI

Assistive technology framework leveraging YOLO v8 for real-time object detection, ultrasonic sensors for distance, a mobile app for turn-by-turn navigation, and a voice chatbot for intuitive interaction. Implemented on Raspberry Pi, this project aims to provide real-time and personalized support for visually impaired individuals' mobility & safety.

Language: Python - Size: 603 KB - Last synced at: 6 days ago - Pushed at: 6 days ago - Stars: 0 - Forks: 0

F1uxWave/Obstacle-Avoiding-Robot

This Arduino code utilizes an ultrasonic sensor to measure distances. When an object is detected within a fix distance , the connected motors trigger a sequence: move backward, turn right, turn left, then move forward. Motor control is achieved using the AFMotor library, and the distance calculation is based on the sensor's pulse duration.

Language: C++ - Size: 3.83 MB - Last synced at: 9 days ago - Pushed at: 9 days ago - Stars: 2 - Forks: 1

omgirkar/GuideX

An assistive walking stick prototype designed for visually impaired individuals. This smart stick uses ultrasonic sensors to detect obstacles and alerts the user with a buzzer. It's compact, efficient, and cost-effective — made as part of a science/tech exhibition project.

Language: C++ - Size: 140 KB - Last synced at: 8 days ago - Pushed at: 9 days ago - Stars: 0 - Forks: 0

Akshint0407/Automatic-Fire-Fighting-Robot

Introducing the Firefighting Robot – a smart solution for fire detection and suppression. It autonomously detects flames, navigates obstacles, and activates a water pump for effective fire control. Ideal for enhancing safety in hazardous environments.

Language: C++ - Size: 94.7 KB - Last synced at: 10 days ago - Pushed at: 10 days ago - Stars: 2 - Forks: 0

tdk-invn-oss/ultrasonic.soniclib

Driver repo for TDK InvenSense consumer ultrasonic sensors

Language: C - Size: 2.83 MB - Last synced at: 10 days ago - Pushed at: 10 days ago - Stars: 16 - Forks: 0

PrathuashaKB/Short-Range-Ultrasonic-Radar

Technical project, a simple radar using the ultrasonic sensor, this radar works by measuring a range from 3cm to 40 cm as non-contact distance, with angle range between 15˚ and 165˚.

Size: 2.26 MB - Last synced at: 13 days ago - Pushed at: 13 days ago - Stars: 0 - Forks: 0

SickLuca/ArduinoAlarmControlUnit

This repository contains code and diagrams for running an alarm control unit on Wokwi simulator.

Language: C++ - Size: 8.79 KB - Last synced at: 8 days ago - Pushed at: 15 days ago - Stars: 0 - Forks: 0

UtpalKuma-r/Automatic-Emergency-Braking

This project simulates a basic Automatic Emergency Braking (AEB) system using Tinkercad, demonstrating how an ultrasonic sensor can detect obstacles and automatically stop a vehicle (DC motor) to prevent collision.

Language: C++ - Size: 85 KB - Last synced at: 11 days ago - Pushed at: 16 days ago - Stars: 0 - Forks: 0

shwetanshutech/gesture-Control

Gesture✋ Control Laptop using 𝐀𝐫𝐝𝐮𝐢𝐧𝐨 𝐚𝐧𝐝 𝐏𝐲𝐭𝐡𝐨𝐧 .Video media player controller by taking hand gestures of the user

Language: C++ - Size: 1.56 MB - Last synced at: 16 days ago - Pushed at: 16 days ago - Stars: 0 - Forks: 0

rolandort/water-tank

Water tank monitoring with ESP32-C6 and an ultrasonic distance sensor.

Language: Shell - Size: 485 KB - Last synced at: 25 days ago - Pushed at: 25 days ago - Stars: 5 - Forks: 2

ArminJo/Arduino-RobotCar

Enables autonomous driving of a 2 or 4 wheel car with an Arduino and a Adafruit Motor Shield V2. To avoid obstacles a HC-SR04 Ultrasonic sensor mounted on a SG90 Servo continuously scans the area. Manual control is by a GUI implemented with a Bluetooth HC-05 Module and the BlueDisplay library.

Language: C++ - Size: 29.8 MB - Last synced at: 18 days ago - Pushed at: 26 days ago - Stars: 18 - Forks: 6

vladysor/SensEdu-Library

SensEdu Projects Development Framework

Language: C - Size: 44.9 KB - Last synced at: 27 days ago - Pushed at: 27 days ago - Stars: 1 - Forks: 0

ThisTrick/UltrasonicTesting

Ultrasonic testing (UT) is a family of non-destructive testing techniques based on the propagation of ultrasonic waves in the object or material tested.

Language: C# - Size: 6.2 MB - Last synced at: 28 days ago - Pushed at: 28 days ago - Stars: 10 - Forks: 2

bosch-engineering/off_highway_sensor_drivers

This project provides ROS drivers for Bosch Off-Highway sensor systems. (Radar Off-Highway Premium, Radar OHW, General Purpose Radar Off-Highway (GPR), Ultrasonic Sensor System OHW Entry & Premium)

Language: C++ - Size: 355 KB - Last synced at: 28 days ago - Pushed at: 28 days ago - Stars: 57 - Forks: 17

matesoft2033/EchoSense

EchoSense is an Arduino-based distance alert system using an HC-SR04 ultrasonic sensor. It displays distance on an LCD screen with a bar graph and activates a buzzer when an object is too close. A button allows manual buzzer control. 🚀

Language: C++ - Size: 168 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

cybernethica-cordis/STM32-HCSR04-HAL

HAL-based driver for the HC-SR04 ultrasonic sensor, implemented on an STM32F446RE Nucleo board. Key features include temperature-compensated distance calculation, pulse width validation with hardware timeouts, multi-sample averaging, and diagnostic output via UART. The driver is designed for easy integration into embedded systems

Language: C - Size: 12.1 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

MrTBK/Arduino-Obstacle-Detector-Car-with-Two-Sensors

The Arduino Car Obstacle Avoidance project creates a car that autonomously navigates while avoiding obstacles. It uses an Arduino Uno, motors, an H-bridge moduleand 2 ultrasonic sensor.

Language: C++ - Size: 2.93 KB - Last synced at: 24 days ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 0

maritime-labs/calypso-anemometer

Python driver for the Calypso Instruments Ultrasonic Portable Solar wind meter (UP10)

Language: Python - Size: 163 KB - Last synced at: 18 days ago - Pushed at: about 2 years ago - Stars: 16 - Forks: 2

nopnop2002/esp-idf-ultrasonic

Ultrasonic distance sensor for ESP-IDF

Language: C - Size: 129 KB - Last synced at: 18 days ago - Pushed at: 7 months ago - Stars: 13 - Forks: 7

VicTheM/ultrasound-imaging

A device that uses the principle of phased arrays to generate 2.5D images of the the enviroment

Language: HTML - Size: 8.79 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

AkhilRai28/PCB-Designing

This repository contains detailed documentation and code for designing and developing a microcontroller-based Printed Circuit Board (PCB). The project focuses on creating a versatile and efficient platform for various embedded system applications, ensuring optimal performance, power efficiency, and ease of integration.

Language: C++ - Size: 10.7 KB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 4 - Forks: 0

oceanthunder/ATmega328

A collection of my hobby projects.

Language: C++ - Size: 102 MB - Last synced at: 19 days ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

1010Technologies/pxt-makerbit

The MakerBit connects to a wide variety of components.

Language: Makefile - Size: 2.82 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 3 - Forks: 2

DawnGuardian/PGA460-ESP32_Library

Library for controlling PGA460 series of chips using ESP32 (or any Arduino framework board)

Language: C++ - Size: 35.2 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 2 - Forks: 1

marcoradocchia/hc-sr04

Raspberry Pi Rust driver for the HC-SR04 ultrasonic distance sensor.

Language: Rust - Size: 32.2 KB - Last synced at: 20 days ago - Pushed at: 10 months ago - Stars: 7 - Forks: 3

TahirZia-1/Water-Tank-Automation

A Water Tank Automation system using Arduino UNO, Multiple Sensors, Water Pumps & Relays (Implementation on Arduino IDE).

Language: C++ - Size: 86.9 KB - Last synced at: about 1 month ago - Pushed at: about 2 months ago - Stars: 1 - Forks: 0

Muatasim-Aswad/parking-guidance-system

Parking Guidance System Prototype

Language: C++ - Size: 6.5 MB - Last synced at: about 1 month ago - Pushed at: 9 months ago - Stars: 1 - Forks: 0

emansarahafi/MoniCropHardware

A crop monitoring system made using a Raspberry Pi 4B, a 7-in-1 NPK sensor, an ultrasonic sensor, and an ESP32 Wi-Fi module.

Language: Python - Size: 10.7 KB - Last synced at: 8 days ago - Pushed at: over 1 year ago - Stars: 18 - Forks: 2

Gabrielrmg/EMBARCATECH

BR SmartGuia: Carrinho assistivo para pessoas cegas que detecta obstáculos em tempo real, emitindo alertas sonoros e visuais para maior segurança e autonomia.

Language: HTML - Size: 9 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 0 - Forks: 0

WassimHedfi/Smart-Glasses-for-Visually-Impaired

This project is a wearable navigation aid that combines computer vision, edge inference, and obstacle detection. The system provides audio feedback to assist visually impaired individuals in navigating their surroundings.

Language: C++ - Size: 11.7 KB - Last synced at: about 2 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

Mysterious-Cart/Water-Level

Using ultrasonic sensor to measure liquid level and volume inside a set size container.

Language: Processing - Size: 2.93 KB - Last synced at: about 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

m-gracia/esp32-bike-computer-back

Companion for esp32-bike-computer-main using BLE communication

Language: C++ - Size: 3.09 MB - Last synced at: 2 months ago - Pushed at: 12 months ago - Stars: 0 - Forks: 0

matesoft2033/Signal-Detection-LCD

An Arduino project using Adafruit LCD to display system status based on signal input.

Language: C++ - Size: 116 KB - Last synced at: about 2 months ago - Pushed at: 2 months ago - Stars: 1 - Forks: 0

haabiba-alaa/IoT-Door-Security-Alarm

A cloud-based security system that detects intrusions, sends email alerts, and can be controlled remotely via a mobile app. 🚀

Language: C++ - Size: 2.93 KB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

Sonobotics/VitesseAPI

High-performance interface designed to integrate and control the Sonobotics SONUS Vitesse data acquisition system through Python.

Language: Python - Size: 3.63 MB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 0 - Forks: 0

berksudan/Autonomous-Robot

TÜBİTAK 2209/A Research Project, including autonomous logistic robot car which can be monitored by mobile app.

Language: Java - Size: 16.4 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

roycuadra/IoT-based-flood-detection-system

The IoT based flood detection with Blynk Integration code allows you to monitor distance measurements of water using an ultrasonic sensor connected to an ESP8266 microcontroller.

Language: C++ - Size: 9.77 KB - Last synced at: about 1 month ago - Pushed at: 9 months ago - Stars: 2 - Forks: 0

EhabMagdyy/UltrasonicSensor-STM32

Ultrasonic sensor HC-SR04 with STM32 using Timer input capture.

Language: C - Size: 11.7 KB - Last synced at: 16 days ago - Pushed at: 3 months ago - Stars: 1 - Forks: 0

nayasinghania/chairsense 📦

This repository contains Arduino code files for chairSense

Language: C++ - Size: 51.8 KB - Last synced at: 3 days ago - Pushed at: almost 3 years ago - Stars: 0 - Forks: 0

coding-lemur/bed-room-clock

a bed-room clock firmware for ESP32

Language: C++ - Size: 4.22 MB - Last synced at: 8 days ago - Pushed at: 3 months ago - Stars: 2 - Forks: 0

ahmad-imran-dev/quadruped_robot

Quadruped Robot - Helping robotic passionates to dive into a new world.

Language: C++ - Size: 22.3 MB - Last synced at: 2 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

emmittjames/GarbageTime

Project that allows users to view how full trash cans are

Language: C - Size: 2.92 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

Yasir-Arafah/Mr.-Unstoppable

Combining the power of obstacle avoidance capability and collecting dirt, "Mr. Unstoppable" is a smart vacuum cleaner robot created with Arduino. Mr. Unstoppable can make his way either by pushing through or pushing in dirt debris into his cute belly! Just remember, don't push his limits, as it might make him really upset!

Language: C++ - Size: 11.3 MB - Last synced at: 19 days ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

WKevincroos/Morpheus

Um braço robótico orientado por um sensor ultrassônico alimentado por um Arduino Uno.

Language: C++ - Size: 3.91 KB - Last synced at: 24 days ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

AskitEndo/ESP32-Arduino-IoT-Labs

Explore a collection of 12 hands-on IoT projects using Arduino and ESP32. Learn sensor integration, distance measurement, collision detection, and environmental monitoring with practical examples and code.

Language: C++ - Size: 9.66 MB - Last synced at: about 1 month ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

Munn15/ecosprinkle

EcoSprinkle adalah aplikasi IoT untuk Sistem Irigasi Pertanian Otomatis Dengan Springkle

Language: C++ - Size: 409 KB - Last synced at: about 1 month ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

Munn15/tongkat-ultrasonic

Program IoT menggunakan sensor ultrasonic untuk membantu tunanetra berjalan

Language: C++ - Size: 5.86 KB - Last synced at: 23 days ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

roeytamano/RoboCave

RoboCave is a school project that involves a robotic vehicle equipped with sensors to measure air quality, distance, and other environmental parameters. The vehicle can be controlled remotely via a web interface, allowing it to move forward, backward, turn, and stop.

Language: Python - Size: 18.6 KB - Last synced at: 22 days ago - Pushed at: 3 months ago - Stars: 1 - Forks: 0

ashithapallath/4-Alpha-EmptyBin Fork of athiramohandas12/Make_A_Ton6.0

The 4 Alpha: EmptyBin is a smart waste management solution developed as part of the Make-A-Ton 6.0 Hackathon at CUSAT.

Language: JavaScript - Size: 24.8 MB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

faanid/robot-obstacle_avoidance

The Obstacle Avoidance _ Ein Arduino-basierter autonomer Roboter, der Hindernissen ausweicht und sich selbst am Fallen hindert.🤖

Language: C++ - Size: 2.93 KB - Last synced at: about 2 months ago - Pushed at: over 2 years ago - Stars: 3 - Forks: 0

Chmatulo/Ultrasonic-Ranger-Sonar

Ultrasonic Ranger Sonar

Language: Python - Size: 205 KB - Last synced at: 26 days ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

Kunal70616c/IoT-Enabled-Smart-Bin

An IoT-enabled smart dustbin with waste segregation capabilities. It monitors fill levels, sends email alerts when full, and promotes efficient waste management.

Language: C++ - Size: 0 Bytes - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 1 - Forks: 0

itsrohan2003/ParkHub

To automate the parking allocation for the university, it uses Geofencing, ultrasonic sensors and MQTT wireless protocol. we integrated our IoT network, a free maps service api to our website server to provide a feasible and cost effective solution to address the problem.

Language: HTML - Size: 9.63 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

PrateekRajSrivastav/Coopelia-Based-Adaptive-Headlight-

This project demonstrates an autonomous headlight rotator using sensors to detect obstacles and adapt the light direction accordingly. The system can navigate through an environment and ensure maximum visibility in the required direction, making it ideal for robotics and vehicle applications.

Size: 1.97 MB - Last synced at: about 2 months ago - Pushed at: 4 months ago - Stars: 0 - Forks: 0

tdk-invn-oss/ultrasonic.arduino.ICUX0201

Arduino Driver for TDK InvenSense consumer ultrasonic sensor family ICUX0201

Language: C - Size: 3.8 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 3 - Forks: 3

Awais-Asghar/Obstacle-Avoiding-Robot-using-Ultrasonic-Sensor

An obstacle-avoiding robot using an ultrasonic sensor and motor control, programmed with Arduino to autonomously navigate and avoid obstacles by stopping, reversing, and turning.

Size: 3.91 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 1 - Forks: 0

d03n3rfr1tz3/HC-SR04

Library for measuring distance with the HC-SR04 UltraSonic Sensor, by utilizing temperature correction and multiple echo pins in parallel.

Language: C++ - Size: 845 KB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 41 - Forks: 7

SombitPramanik/UL_Sensor_HC_SR04

A lite weight Driver written in Micro python that helps quickly use the HC-SR204 sensor to use in Projects

Language: Python - Size: 0 Bytes - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

imvickykumar999/Ideationology-Lab

Learn Python at IDEATIONOLOGY Lab

Language: Jupyter Notebook - Size: 290 MB - Last synced at: 19 days ago - Pushed at: 5 months ago - Stars: 9 - Forks: 9

Mehrabkhavari/Smart-Parking-Assistant

This project helps you build a smart parking assistant using an Arduino board, an ultrasonic sensor, LEDs, and a buzzer. The system guides you into a parking space by providing visual and auditory cues based on your distance from obstacles.

Language: C++ - Size: 12.7 KB - Last synced at: about 1 month ago - Pushed at: 5 months ago - Stars: 1 - Forks: 0

VoltCode123/ParkLight-Navigator

Welcome to the Free Parking Space Navigator project! This project aims to create a simple and efficient system to detect and indicate available parking spaces using an Arduino, LED indicators, and ultrasonic sensors.

Language: C++ - Size: 46.9 KB - Last synced at: 2 months ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

methylDragon/ros-indoor-gps-fusion

Implementation of sensor fusion with the Marvelmind Indoor GPS ultrasonic beacons! (With custom message adapters and the Linorobot stack!)

Language: C++ - Size: 281 KB - Last synced at: 12 days ago - Pushed at: over 6 years ago - Stars: 32 - Forks: 12

The-Robo-Hobo/Robo-Hobo-Public

Home Defense Rover's source code

Language: Python - Size: 55.7 KB - Last synced at: about 1 month ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

FarzadAziziZade/Automatic-Filling-Machine

Automatic Filling Machine

Language: C++ - Size: 9.77 MB - Last synced at: 2 months ago - Pushed at: almost 4 years ago - Stars: 3 - Forks: 0

rewind2b4/AutonomousRCCar

An autonomous vehicle. I am exploring the ways that autonomous vehicles can traverse rough terrain.

Language: Python - Size: 104 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 0 - Forks: 0

nordmoen/hc-sr04

Rust embedded-hal sensor crate for HC-SR04

Language: Rust - Size: 12.7 KB - Last synced at: 13 days ago - Pushed at: over 6 years ago - Stars: 17 - Forks: 6

farooqueesamiya/EDITH-Human-Following-Robot

In this repository, we will design and develop a human-following robot using Arduino Uno, Ultrasonic, and Infrared sensors, following a tutorial from DIY Builder on YouTube.

Language: C++ - Size: 1.95 MB - Last synced at: about 1 month ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

izmanaveed/Range-Finder-Radar-System-Using-Ultrasonic-Sensor

Range Finder Radar System Using Ultrasonic Sensor EMI Project (2018)

Size: 24.4 KB - Last synced at: 4 months ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

loganwedwards/garage-parking-assistant

A visual assistant for preventing car bumper collisions

Language: C++ - Size: 612 KB - Last synced at: 3 days ago - Pushed at: over 6 years ago - Stars: 1 - Forks: 0

AbdAlazezAhmed/Arduinoa-Lift-Elevator

Arduino controlled lift

Language: C++ - Size: 58.6 KB - Last synced at: 11 days ago - Pushed at: over 6 years ago - Stars: 6 - Forks: 4

alexminator/ALT_nano

Water Monitoring System

Language: C - Size: 805 KB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 7 - Forks: 1

carlobrok/ebc

extremely boring car - autonomous racing car project

Language: C++ - Size: 165 KB - Last synced at: 6 months ago - Pushed at: over 4 years ago - Stars: 1 - Forks: 0

aaroncanillas/2wd-mobile-robot-obstacle-detection

Two wheel drive (2WD) mobile robot for navigating wall obstacle mazes

Language: C++ - Size: 13.6 MB - Last synced at: about 2 months ago - Pushed at: 6 months ago - Stars: 0 - Forks: 0

dpm76/irbg

Code and examples used for meetings and workshops of the "IoT and Robotics Build Group" of Freiburg

Language: Python - Size: 54.7 KB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 0 - Forks: 1

manishmeganathan/smartwalkingcane

An Arduino project to build a smart walking cane for the blind using ultrasonic sensors and haptic vibration generators

Language: C++ - Size: 438 KB - Last synced at: 24 days ago - Pushed at: almost 4 years ago - Stars: 0 - Forks: 0

methylDragon/marvelmind-indoor-gps-tutorial

A tutorial for setting up and interfacing with Marvelmind Indoor 'GPS' ultrasonic beacons!

Language: Python - Size: 31.7 MB - Last synced at: 12 days ago - Pushed at: over 6 years ago - Stars: 46 - Forks: 10

gavinlyonsrepo/pic_16F18313_projects

Projects for the Microchip PIC 16F18313 Microcontroller ( 8-bit, 8-pin).

Language: C - Size: 405 KB - Last synced at: 16 days ago - Pushed at: almost 2 years ago - Stars: 4 - Forks: 3

kramikkk/arduino-smart-face-shield

Smart Face Shield: An Arduino Based Infrared for Temperature Scanning and Monitoring

Language: C++ - Size: 32 MB - Last synced at: 3 months ago - Pushed at: 7 months ago - Stars: 0 - Forks: 0

SanjinKurelic/ArduinoPlayground

Some examples written in C++, that use DC motors (L298N), IR and ultrasonic sensors for solving some tasks with Arduino Mega 2560.

Language: C++ - Size: 96.7 MB - Last synced at: 2 months ago - Pushed at: about 3 years ago - Stars: 1 - Forks: 0

MennahtullahMabrouk/Arduino-Car-Obstacle-Avoidance

The Arduino Car Obstacle Avoidance project creates a car that autonomously navigates while avoiding obstacles. It uses an Arduino Uno, motors, an H-bridge module, an ultrasonic sensor, and a TSOP sensor for remote control. The system combines assembly and C code, with the assembly controlling the motors and the C code

Language: Assembly - Size: 3.12 MB - Last synced at: about 2 months ago - Pushed at: almost 2 years ago - Stars: 1 - Forks: 0

tdk-invn-oss/ultrasonic.mofmofdetection

TDK CH101/201 Mof-Mof (softness) sensor information and sample program for Raspberry Pi Pico

Language: C - Size: 1.15 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 4 - Forks: 0

tdk-invn-oss/ultrasonic.arduino.CHx01

Arduino Driver for TDK InvenSense consumer ultrasonic sensor family CHx01

Language: C - Size: 3.61 MB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 1 - Forks: 0

ashykng/auto-bin

The Auto Bin Project aims to simplify waste disposal by automating the opening of a dust bin's door. By using an ultrasonic sensor and a servo motor, the system ensures a hands-free and efficient way to manage waste.

Language: C++ - Size: 15.6 KB - Last synced at: 7 months ago - Pushed at: 7 months ago - Stars: 2 - Forks: 0

Arsham-LH/Medical-Ultrasound

Simulations of ultrasound waves in medical applications using the MATLAB k-Wave toolbox.

Language: MATLAB - Size: 3.35 MB - Last synced at: 22 days ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

tamizhanban-nitish-p/smart-dustbin

smart dustbin that display the level of garbage and enables automation of lid opening and closing.

Language: C++ - Size: 85.9 KB - Last synced at: about 1 month ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

lily-osp/arduino-pid

just an example of how to use pid on an arduino program

Language: C++ - Size: 28.5 MB - Last synced at: about 1 month ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

pkarun/Blynk-Water-Tank-Level-Indicator

Measure Water Level in tank with Blynk app, NodeMCU and Ultrsonic sensor.

Language: C++ - Size: 2.43 MB - Last synced at: 6 months ago - Pushed at: over 5 years ago - Stars: 9 - Forks: 3

nitinjs/hydro_nft

Efficient neutrient file technique hydroponic system with particle photon IoT and ultrasonic sensor

Language: C++ - Size: 726 KB - Last synced at: 7 days ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

AhmedRagabMogoda/Ultrasonic-sensor-to-measure-distance-project

Ultrasonic sensor to measure distance project using AVR Atmega32 with LCD and Ultrasonic sensor.The setup involves generating ultrasonic pulses, capturing the echo response, and calculating the distance based on the time it takes for the echo to return.

Language: Makefile - Size: 202 KB - Last synced at: 8 months ago - Pushed at: 8 months ago - Stars: 1 - Forks: 0

larzuaga11/ESP32-WebServer

ESP32 Webserver for Parking Circuit

Language: C++ - Size: 754 KB - Last synced at: about 1 month ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

YahboomTechnology/Color-ultrasonic-module

Yahboom Colorful ultrasonic sensor distance module avoid obstacle

Language: C++ - Size: 67.6 MB - Last synced at: about 2 months ago - Pushed at: almost 2 years ago - Stars: 1 - Forks: 1

PerCollECT/UltrasonicUnderwood

PerCollECT for Ultrasonic Sensors: https://percollect.github.io/UltrasonicUnderwood/

Language: HTML - Size: 118 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 3 - Forks: 1

sathish-a/SmartBin

An Iot Project

Language: Arduino - Size: 132 KB - Last synced at: 8 months ago - Pushed at: about 8 years ago - Stars: 0 - Forks: 0

marcin-chwedczuk/pvc-scanner

Language: Java - Size: 5.87 MB - Last synced at: 14 days ago - Pushed at: 8 months ago - Stars: 0 - Forks: 0

imvickykumar999/Arduino-and-Sensors

Code with Circuit Diagram.

Language: C++ - Size: 27.6 MB - Last synced at: 19 days ago - Pushed at: almost 3 years ago - Stars: 2 - Forks: 1

Sarthak-Singh/Gesture-Controlled-Obstacle-Avoider-Pick-and-Place-Robot

Code for Arduino, controlling accelerometer & ultrasonic sensors, as well as various motors for movement and lifting weights. Also, contains a separate program for simulation which was done on Proteus for this project. This separate program has some slight port changes due to the restrictions of the simulator.

Language: C++ - Size: 7.81 KB - Last synced at: 8 months ago - Pushed at: about 4 years ago - Stars: 1 - Forks: 0

Aditya-A-garwal/mbed-HCSR04

A simple library to use the HCSR04 ultrasonic sensor with ARM MBed OS and ARM Cortex M Microcontrollers

Language: C++ - Size: 29.3 KB - Last synced at: about 2 months ago - Pushed at: over 1 year ago - Stars: 2 - Forks: 0