Ecosyste.ms: Repos

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

GitHub topics: obstacle-detection

szenergy/awesome-lidar

😎 Awesome LIDAR list. The list includes LIDAR manufacturers, datasets, point cloud-processing algorithms, point cloud frameworks and simulators.

Size: 175 KB - Last synced: 4 days ago - Pushed: 5 days ago - Stars: 808 - Forks: 102

pal-robotics/pmb2_robot

A PAL Mobile Base for your advanced navigation needs

Language: Python - Size: 21 MB - Last synced: 15 days ago - Pushed: 15 days ago - Stars: 8 - Forks: 12

gib-student/mapping-robot

Project for Embedded Systems class (ECEN 361) in Winter 2024. Group members include Trevor Gibb and Adam Foster.

Language: C++ - Size: 80.9 MB - Last synced: about 1 month ago - Pushed: about 1 month ago - Stars: 2 - Forks: 0

snktshrma/obstacle_cluster_detection

An obstacle tracking ROS package for detecting obstacles using 2D LiDAR scan using an Extended object tracking algorithm

Language: C++ - Size: 236 KB - Last synced: 24 days ago - Pushed: 24 days ago - Stars: 23 - Forks: 2

Cardinal-Space-Mining/Sick-Perception

Interfacing and obstacle detection pipeline for the SICK Multiscan 136

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

guoxxiong/Human-Robot-Co-transporting-Experiment

Experiment of Human-Robot Co-transporting, Kobuki, Rplidar A3, Displacement Sensor, Angle Sensor, Jetson TX2, Arduino, ROS...

Size: 17.6 KB - Last synced: about 1 month ago - Pushed: almost 2 years ago - Stars: 1 - Forks: 0

bborja/modd

Dataset and Evaluation Scripts for Obstacle Detection via Semantic Segmentation in a Marine Environment

Language: MATLAB - Size: 3.44 MB - Last synced: about 2 months ago - Pushed: over 3 years ago - Stars: 41 - Forks: 5

rybandrei2014/obstacle_processor

ROS package for obstacle segmentation in a point cloud scene

Language: C++ - Size: 19.5 KB - Last synced: 2 months ago - Pushed: over 4 years ago - Stars: 14 - Forks: 6

lojzezust/WaSR

A PyTorch reimplementation of the WaSR obstacle segmentation model

Language: Python - Size: 625 KB - Last synced: about 1 month ago - Pushed: 6 months ago - Stars: 27 - Forks: 7

ay1141982112/Obstacle-detect-robot

Code and Report of an obstacle detection robot

Language: C++ - Size: 408 KB - Last synced: 2 months ago - Pushed: about 6 years ago - Stars: 0 - Forks: 0

SS47816/lidar_obstacle_detector

3D LiDAR Object Detection & Tracking using Euclidean Clustering, RANSAC, & Hungarian Algorithm

Language: C++ - Size: 30 MB - Last synced: 2 months ago - Pushed: 2 months ago - Stars: 193 - Forks: 41

visualbuffer/copilot

Lane and obstacle detection for active assistance during driving. Uses windowed sweep for lane detection. Combination of object tracking and YOLO for obstacles. Determines lane change, relative velocity and time to collision

Language: Jupyter Notebook - Size: 15.1 MB - Last synced: 3 months ago - Pushed: over 3 years ago - Stars: 141 - Forks: 53

lojzezust/WaSR-T

Temporal WaSR-T model for maritime obstacle detection via semantic segmentation

Language: Python - Size: 19.4 MB - Last synced: about 1 month ago - Pushed: 6 months ago - Stars: 17 - Forks: 5

omkarchittar/Dijkstra_Point_Robot

In this project, the Dijkstra's path planning algorithm was implemented on a point robot for helping it navigate through an obstacle filled space.

Language: Python - Size: 1.34 MB - Last synced: 3 months ago - Pushed: 3 months ago - Stars: 0 - Forks: 0

PranaySadavarte/Obstacle-Detecting-Four-Wheel-Drive-4WD

•A four-wheel drive vehicle was made using Arduino Uno R3 and a motor shield over it. An ultrasonic sensor was used to detect obstacles and a program was made to move away when and obstacle is detected.•The model consisted of an ultrasonic sensor and a servo motor for a complete surveillance for the obstacle.•Four TT motors were used to drive the wheels along with the chassis. The microcontroller and its motor shield is connected to a portable battery source to make this project completely portable and self-sufficient.

Language: C++ - Size: 25.4 KB - Last synced: 3 months ago - Pushed: almost 4 years ago - Stars: 0 - Forks: 1

lojzezust/SLR

Scaffolded Learning Regime for training maritime obstacle detection networks

Language: Python - Size: 6.22 MB - Last synced: about 1 month ago - Pushed: 6 months ago - Stars: 8 - Forks: 1

saad0510/obstacle-avoiding-car

A small robot car which is able to detect obstacles in its way and avoid them.

Language: C++ - Size: 1.65 MB - Last synced: 4 months ago - Pushed: about 2 years ago - Stars: 1 - Forks: 0

beedotkiran/Lidar_For_AD_references

A list of references on lidar point cloud processing for autonomous driving

Size: 79.1 KB - Last synced: 4 months ago - Pushed: about 2 years ago - Stars: 719 - Forks: 216

lojzezust/lars_evaluator

Evaluation scripts for the LaRS dataset

Language: Python - Size: 4.8 MB - Last synced: about 1 month ago - Pushed: 6 months ago - Stars: 7 - Forks: 1

ser94mor/lidar-obstacle-detection

Project: Lidar Obstacle Detection || Udacity: Sensor Fusion Engineer Nanodegree

Language: C++ - Size: 195 MB - Last synced: 4 months ago - Pushed: almost 5 years ago - Stars: 26 - Forks: 9

yudhisteer/Optical-Flow-Obstacle-Avoidance-for-UAV

In this project I aim to develop an unsupervised sense-and-avoid system for UAVs using sparse and dense optical flow.

Language: Python - Size: 527 KB - Last synced: 4 months ago - Pushed: 8 months ago - Stars: 3 - Forks: 1

Valeria9533/Mobile_robot_with_camera_Raspberry-Pi

Robot avoids obstacles using CNN model and USB-camera

Language: Python - Size: 22.5 KB - Last synced: 5 months ago - Pushed: almost 2 years ago - Stars: 2 - Forks: 0

benjaminpowell24/Obstacle-classifier-detector

Obstacle detector and classifier mobile app with flutter and python tensorflow lite yolov4 model

Language: C++ - Size: 23.6 MB - Last synced: 6 months ago - Pushed: 6 months ago - Stars: 0 - Forks: 0

Git-Utkarsh/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: 6 months ago - Pushed: 6 months ago - Stars: 0 - Forks: 0

frmadeira/nmpc_controller

NMPC controller for trajectory tracking and obstacle avoidance

Language: Python - Size: 14.6 KB - Last synced: 7 months ago - Pushed: 7 months ago - Stars: 0 - Forks: 0

yymmaa0000/Trash_Delivery_Robot_Design_Project

This is a group project where we designed a autonomous trash delivery robot to help households deliver their trash from home to curb

Language: C++ - Size: 2.04 MB - Last synced: 7 months ago - Pushed: over 4 years ago - Stars: 0 - Forks: 0

greenDev7/DijkstraAlgorithm

Реализация алгоритма Дейкстры для поиска кратчайшего пути между двумя вершинами и оптимального маршрута на 3D поверхности с использованием очереди с приоритетом (PriorityQueue).

Language: C# - Size: 1.16 MB - Last synced: 8 months ago - Pushed: over 1 year ago - Stars: 1 - Forks: 0

nihalsoans91/phantom_obstacles

Removes phantom obstacles from maps created from robot point clouds

Language: Jupyter Notebook - Size: 271 KB - Last synced: 8 months ago - Pushed: over 5 years ago - Stars: 2 - Forks: 0

MarkBenjamins/NHL-Stenden-Python-course-programming-exercises

Project Drone programming-exercises

Language: Python - Size: 7 MB - Last synced: 4 months ago - Pushed: almost 3 years ago - Stars: 8 - Forks: 1

ais-climber/sense-able Fork of SCCapstone/Sense-Able

🎊 A LIDAR obstacle sensor for the visually impaired. Proof-of-concept. The sensible obstacle sensor™

Language: C++ - Size: 1.06 GB - Last synced: 10 months ago - Pushed: over 2 years ago - Stars: 0 - Forks: 0

mferri17/ros-thymio-simulation

Simple simulation of differential drive robots avoiding obstacles while randomly exploring an environment with ROS and Gazebo. 2nd assignment of the Robotics course at Università della Svizzera Italiana (USI) Lugano.

Language: Python - Size: 228 KB - Last synced: 10 months ago - Pushed: about 4 years ago - Stars: 1 - Forks: 0

mjs513/TeensyOpenMV

Language: Python - Size: 13.3 MB - Last synced: 10 months ago - Pushed: over 6 years ago - Stars: 13 - Forks: 5

dhruvil009/Obstacle-detection-using-Ultrasonic-Sensors-on-ESP8266

Language: C++ - Size: 2.93 KB - Last synced: 10 months ago - Pushed: almost 6 years ago - Stars: 0 - Forks: 0

hpreshit/Autonomous-Driving

This repository consists of the course project for ECEN 5623 Real-Time Embedded Systems

Language: C - Size: 57.6 KB - Last synced: 10 months ago - Pushed: over 5 years ago - Stars: 0 - Forks: 1

kparnis3/Final-Year-Project

Undergraduate Dissertation (University of Malta) 2020-2023 - 'Autonomous Drone Control using Reinforcement Learning''

Language: Jupyter Notebook - Size: 10.7 MB - Last synced: 12 months ago - Pushed: 12 months ago - Stars: 1 - Forks: 0

hassanaftab93/Obstacle-Detection-for-the-blind

My project is an Arduino based module that would will help the visually impaired people to be able to sense whether there are obstacles in front of them (further than the reach of their walking cane) and easily let their family/friends know their location with the help of Internet of Things.

Language: C++ - Size: 3.95 MB - Last synced: 12 months ago - Pushed: about 2 years ago - Stars: 1 - Forks: 0

balazsplaszkony/Obstacle-Avoiding-Car

BME-VIK Electrical Engineering 6th semester project, obstacle avoiding car using NXP LPC microcontoller

Language: C - Size: 21 MB - Last synced: 4 months ago - Pushed: 11 months ago - Stars: 0 - Forks: 0

rohanbhamre01/FirebirdV-Forge

A New Paradigm for Robotics Control with Firebird and Arduino for Reimagining Firebird-Arduino Interactions.

Language: C++ - Size: 13.8 MB - Last synced: about 1 year ago - Pushed: about 1 year ago - Stars: 1 - Forks: 0

Kartmaan/Bouncing_cube

Cube bouncing against window edges and against a changing obstacle

Language: Python - Size: 316 KB - Last synced: about 1 year ago - Pushed: about 1 year ago - Stars: 0 - Forks: 0

PandaMunda/Obstacle-avoider-using-Arduino

A bot which can move without colliding with any walls with the help of HC-SR04 ultrasonic sensors.

Language: C++ - Size: 9.77 KB - Last synced: about 1 year ago - Pushed: about 1 year ago - Stars: 7 - Forks: 0

hans-ob1/neural_cam_ros

This package is essentially a ros-wrapper of neural_cam. More features would be added in the future, geared towards mobile robot platform. Eventual goal of this package is to solve the problem of given an image, where is the obstacle with respect to the robot in a 3D space.

Language: C++ - Size: 8.51 MB - Last synced: 11 months ago - Pushed: almost 5 years ago - Stars: 11 - Forks: 7

Aniruddha-Tapas/Obstacle-Detection-and-Path-Planning

Processing an Image to find obstacles and the minimum path between two similar objects using OpenCV.

Language: Python - Size: 187 KB - Last synced: about 1 year ago - Pushed: almost 7 years ago - Stars: 62 - Forks: 19

amirx96/velodyne_height_map_occupancy_map Fork of jack-oquin/velodyne_height_map

ROS obstacle detection for 3D point clouds using a height map algorithm.

Language: C++ - Size: 358 KB - Last synced: about 1 year ago - Pushed: almost 4 years ago - Stars: 21 - Forks: 6

VirtualRoyalty/PointCloudSegmentation

The research project based on Semantic KITTTI dataset, 3d Point Cloud Segmentation , Obstacle Detection

Language: Jupyter Notebook - Size: 780 MB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 61 - Forks: 14

SihabSahariar/Computer-Vision-Based-Rover-Navigation-Avoiding-Obstacle

Using Python and OpenCV to implement a basic obstacle avoidance and navigation on the rover.

Language: Python - Size: 386 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 5 - Forks: 0

NDharshan/iNeuron-Blind-Navigation

This project attempts to create a system which would bring in added ease to the visually impaired, through our nagivation, obstacle-detection, obstacle distance identification and speech-driven system to seamlessly integrate applications like Ola, Uber, etc. This was built during the PW-Hacks Jan-2023.

Language: Python - Size: 22.5 MB - Last synced: about 1 year ago - Pushed: over 1 year ago - Stars: 2 - Forks: 0

urastogi885/humanDetectionModule

Human Detection using openCV in C++

Language: C++ - Size: 79.9 MB - Last synced: 10 months ago - Pushed: over 1 year ago - Stars: 1 - Forks: 0

tamasino52/Railroad_and_Obstacle_detection

This program detect and identify obstacle on railway. If program detect some obstacle that train must stop, program gives you warning sign. This program Also estimate riskiness of obstacle how it is negligible or not. We provide many models to you to detect railways and obstacles.

Language: Jupyter Notebook - Size: 1.01 GB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 20 - Forks: 4

salvatore-arienzo/Arduino-Robot-Car-Line-Following-Obstacle-Avoidance

Robot Car realized using Arduino able to follow a path and to detect and avoid obstacles during the way.

Language: C++ - Size: 17.6 MB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 5 - Forks: 1

aviralchharia/Autonomous-Vehicle-based-on-Dublin-Luas-Light-Rail-System

To develop an autonomous vehicle using Arduino (Atmega-328p) & remote wireless supervisory control (using, XCTU & XBee or C#) with capability of ultrasonic obstacle detection & avoidance, self-parking, stopping at gantries in its path & safely co-existing with other vehicles. The Infra-Red module, Transmitter & Receiver circuits were designed & fabricated on a PCB from scratch to develop the vehicle.

Language: C++ - Size: 1.25 MB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 2 - Forks: 0

DK-sr/SFND_Lidar_Obstacle_Detection

Sensor Fusion Nanodegree Project

Language: C++ - Size: 24.5 MB - Last synced: about 1 year ago - Pushed: almost 5 years ago - Stars: 47 - Forks: 16

mmarouen/SFND_Lidar_Obstacle_Detection

Use lidar car data to detect incoming road obstacles track multiple cars on the road, estimating their positions and speed

Language: Makefile - Size: 191 MB - Last synced: about 1 year ago - Pushed: almost 5 years ago - Stars: 4 - Forks: 0

yogeshgajjar/SFND_Lidar_Obstacle_Detection

3D LiDAR obstacle detection on point cloud data using segmentation and clustering.

Language: Makefile - Size: 194 MB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 9 - Forks: 1

hsl-prog/AARVIN

AARVIN - the Autonomous Arduino-based Research Vehicle In Nature. AARVIN autonomously navigates and takes pictures at set waypoints along its route!

Language: C++ - Size: 83 KB - Last synced: about 1 year ago - Pushed: about 1 year ago - Stars: 1 - Forks: 0

MatteoCarlone/PyGame_Robot_Sim

Portable Robot Simulator to make a holonomic robot move inside a maze without hitting obstacles

Language: Python - Size: 15.9 MB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 4 - Forks: 0

lgkimjy/object_detector

sources for object or obstacle detecting based on 1 channel LiDAR

Language: Python - Size: 31.3 KB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 2 - Forks: 0

mratanusarkar/Obstacle-Avoiding-Bot

My goal is to come up with a simple and a basic model of an obstacle avoiding bot with the best possible algorithm to detect and avoid an obstacle using only One Ultrasonic Sensor module (HCSR04) and 2 wheels. The project is still into development to find even better an algorithm to achieve the same task.

Language: C++ - Size: 1.29 MB - Last synced: about 1 year ago - Pushed: over 1 year ago - Stars: 7 - Forks: 3

RishitaReddyChilla/IOT-based-Fall-Detection-System

💡 This project proposes an IoT based fall detection and rescue system. The main objective here is to alert the user as well as a guardian/ doctor if there is a possibility of fall.

Language: C++ - Size: 102 KB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 3 - Forks: 1

ragu-manjegowda/lidar-obstacle-detection

Obstacle detection using lidar point cloud

Language: C++ - Size: 203 MB - Last synced: about 1 year ago - Pushed: almost 4 years ago - Stars: 14 - Forks: 5

yashsriram/sixth-sense

Simple and robust real-time navigation for a noisy differential-drive agent with LIDAR in unknown static environment.

Language: Kotlin - Size: 10.1 MB - Last synced: about 1 year ago - Pushed: over 1 year ago - Stars: 1 - Forks: 0

kvnptl/safety_detector_robot

Obstacle detection (custom) robot using 2D Lidar sensor (Hokuyo). Robot stops moving once obstacle detected within its safety boundry.

Language: CMake - Size: 44.1 MB - Last synced: about 1 year ago - Pushed: about 3 years ago - Stars: 1 - Forks: 0

pepes97/Optimal-trajectory-generation-in-the-Duckietown-environment

Optimal Trajectory Generation in the Duckietown Environment

Language: Python - Size: 487 MB - Last synced: about 1 year ago - Pushed: almost 3 years ago - Stars: 1 - Forks: 1

Daheer/Distance-Sensor-with-HC-SR04

Using an ultrasonic sensor to detect how far obstacles are

Language: C++ - Size: 14 MB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 0 - Forks: 0

souvik0306/Traffic-Sign-Classifier

An autonomous braking system that uses sensor data from Radar and Computer Vision to localize the accurate position of an object around a vehicle using Neural Networks. An algorithm to fuse the data from sensors and camera to perform odometry operations

Language: Jupyter Notebook - Size: 207 MB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 3 - Forks: 1

shengkai365/lidar-obstacle-detection

The task of this project is to detect car and trucks on a narrow street using lidar. The detection pipeline follows the covered methods below, filtering, segmentation, clustering, and bounding boxes.

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

farkoo/Obstacle-Avoiding-Robot

In this project, a robot has been implemented and built that can move freely without hitting an obstacle

Language: C++ - Size: 33.2 MB - Last synced: 11 months ago - Pushed: almost 2 years ago - Stars: 0 - Forks: 0

kni9ht/Master_control

Arduino controll obstacle avoiding car with 2 modes manual and auto

Language: C++ - Size: 19.5 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 0 - Forks: 0

HuangQiang/obstacle Fork of 1flei/obstacle

Detecting Implicit Obstacle from Trajectories (DASFAA 2022)

Size: 112 KB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 1 - Forks: 0

MatteoCarlone/Mobile_Discovery_Robot_ROS Fork of CarmineD8/final_assignment

A ROS Robotics simulator of a mobile robot to discover and map a confined environment

Language: Python - Size: 54.7 KB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 0 - Forks: 0

DreamVu/SLAM

SLAM

Language: C++ - Size: 227 MB - Last synced: about 1 year ago - Pushed: about 2 years ago - Stars: 0 - Forks: 1

monaSaurusRex/mr-robot

A small project where an Arduino robot follows a black line while avoiding obstacles on its path.

Language: C++ - Size: 1.95 KB - Last synced: about 1 year ago - Pushed: almost 3 years ago - Stars: 0 - Forks: 0

PooyaAlamirpour/Lidar-Obstacle-Detection

A self-driving car needs some techniques for preventing collision with pedestrians, vehicles, and other objects that would exist in the way of a car. One of these tools is LiDAR that can be used for obstacle detection on the road. In this repository, I am going to implement a LiDAR Obstacle Detection by using C++.

Language: C++ - Size: 189 MB - Last synced: about 1 year ago - Pushed: almost 3 years ago - Stars: 1 - Forks: 0

ken-power/SelfDrivingCarND-Capstone

Program a real Self-Driving Car by writing ROS nodes to implement core functionality of the autonomous vehicle system.

Language: CMake - Size: 37.7 MB - Last synced: about 1 year ago - Pushed: over 2 years ago - Stars: 1 - Forks: 0

hrsajjad844/Obstacle-Detection-Using-IR-Sensor

IR sensor is used to detect objects. When an object is near the sensor, and led turns ON.

Language: C++ - Size: 4.01 MB - Last synced: about 1 year ago - Pushed: almost 3 years ago - Stars: 2 - Forks: 1

GabeCasciano/Capstone20

Autonomous subsystem for an autonomous vehicle

Language: HTML - Size: 67 MB - Last synced: about 1 year ago - Pushed: about 3 years ago - Stars: 1 - Forks: 1

easy-to-fly/easy-to-fly

Software and hardware for the Clover drone for make drone control easily (preventing collisions with obstacles, web setup, etc.)

Language: JavaScript - Size: 3.22 MB - Last synced: about 1 year ago - Pushed: about 3 years ago - Stars: 0 - Forks: 3

e-loq/eloq-api

Recognizing obstacles in 3d point cloud data

Language: Jupyter Notebook - Size: 500 KB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 0 - Forks: 0

abdullaayyad96/CarND-Vehicle-Detection

A machine learning software to detect nearby vehicles from camera feedback

Language: Python - Size: 372 MB - Last synced: about 1 year ago - Pushed: about 5 years ago - Stars: 3 - Forks: 1

LdwgWffnschmdt/anomaly_detector

Detect anomalies in images using deep features

Language: Python - Size: 38 MB - Last synced: about 1 year ago - Pushed: almost 4 years ago - Stars: 0 - Forks: 1

evrenkaraarslan/LegoMindstormsJava

Line Following and Obstacle Avoidance Lego Mindstorms Robot

Language: Java - Size: 9.77 KB - Last synced: about 1 year ago - Pushed: about 4 years ago - Stars: 0 - Forks: 0

Saad29/Smart-Cane-for-visually-impaired-people

A smart cane/stick with obstacle detection and voice feedback on temperature and humidity coordinated with Raspberry Pi 3 via Publish/Subscribe mechanism.

Language: C++ - Size: 264 KB - Last synced: 10 months ago - Pushed: over 4 years ago - Stars: 0 - Forks: 0

sbatururimi/programming_real_self_driving_car

Implementing ROS nodes for core functionality of the autonomous vehicle system, including traffic light detection, control, and waypoint following!

Language: CMake - Size: 96.5 MB - Last synced: about 1 year ago - Pushed: over 5 years ago - Stars: 3 - Forks: 1

shantnu-agarwal/Collision-Avoidance

Project with Team Rudra

Language: C++ - Size: 170 KB - Last synced: about 1 year ago - Pushed: over 5 years ago - Stars: 0 - Forks: 1

heenasurve/Software-Architecture

Language: Java - Size: 311 MB - Last synced: 4 months ago - Pushed: about 2 years ago - Stars: 0 - Forks: 1