GitHub topics: collision-avoidance
Zhefan-Xu/NavRL
[IEEE RA-L'25] NavRL: Learning Safe Flight in Dynamic Environments (NVIDIA Isaac/Python/ROS1/ROS2)
Language: C++ - Size: 215 MB - Last synced at: about 7 hours ago - Pushed at: about 8 hours ago - Stars: 653 - Forks: 67

snape/RVO2-3D
Optimal Reciprocal Collision Avoidance in Three Dimensions (C++)
Language: C++ - Size: 189 KB - Last synced at: 2 days ago - Pushed at: 2 days ago - Stars: 272 - Forks: 67

hanruihua/NeuPAN
[TRO 2025] NeuPAN: Direct Point Robot Navigation with End-to-End Model-based Learning.
Language: Python - Size: 2.81 MB - Last synced at: 4 days ago - Pushed at: 4 days ago - Stars: 366 - Forks: 32

pjbgf/sha1cd
SHA1 implementation with collision detection.
Language: Go - Size: 3.47 MB - Last synced at: 6 days ago - Pushed at: 6 days ago - Stars: 13 - Forks: 6

adwise-fiu/homomorphic-path-comparison
Privacy-Preserving Drone Navigation Through Homomorphic Encryption for Collision Avoidance
Language: Java - Size: 602 KB - Last synced at: 6 days ago - Pushed at: 6 days ago - Stars: 0 - Forks: 2

hanruihua/rda_ros
ROS Wrapper of RDA planner
Language: Python - Size: 4.74 MB - Last synced at: 6 days ago - Pushed at: 7 months ago - Stars: 86 - Forks: 13

goktug97/DynamicWindowApproach
The Dynamic Window Approach (DWA) planning algorithm written in C with Python Bindings
Language: Cython - Size: 3.45 MB - Last synced at: 5 days ago - Pushed at: over 2 years ago - Stars: 99 - Forks: 24

Zhefan-Xu/LV-DOT
LV-DOT: LiDAR-Visual Dynamic Obstacle Detection and Tracking (C++/Python/ROS)
Language: C++ - Size: 33.7 MB - Last synced at: 18 days ago - Pushed at: 18 days ago - Stars: 166 - Forks: 16

dji-sdk/Payload-SDK
DJI Payload SDK Official Repository
Language: C - Size: 285 MB - Last synced at: 23 days ago - Pushed at: 23 days ago - Stars: 320 - Forks: 140

carlo98/tello-ai-features
Tello AI features. Face recognition and tracking, collision avoidance, reinforcement learning and more.
Language: Python - Size: 76.2 MB - Last synced at: 5 days ago - Pushed at: almost 2 years ago - Stars: 10 - Forks: 4

ArduPilot/OctomapPlanner
ArduPilot Gazebo SITL 3D mapping and planning
Language: C++ - Size: 106 KB - Last synced at: 26 days ago - Pushed at: over 6 years ago - Stars: 143 - Forks: 45

snape/RVO2
Optimal Reciprocal Collision Avoidance (C++)
Language: C++ - Size: 277 KB - Last synced at: 27 days ago - Pushed at: about 1 year ago - Stars: 809 - Forks: 253

snape/RVO2-CS
Optimal Reciprocal Collision Avoidance (C#)
Language: C# - Size: 256 KB - Last synced at: 28 days ago - Pushed at: about 1 year ago - Stars: 754 - Forks: 130

hucebot/cartesio_collision_avoidance
ROS package to transform a pointcloud object into a mesh for obstacle avoidance using cartesIO
Language: CMake - Size: 106 KB - Last synced at: 17 days ago - Pushed at: 17 days ago - Stars: 0 - Forks: 0

ZJU-FAST-Lab/Implicit-SDF-Planner
[IROS 2023] Continuous Implicit SDF Based Any-shape Robot Trajectory Optimization
Language: C++ - Size: 162 MB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 230 - Forks: 24

JoanStinson/SteeringBehaviors
C++ SDL AI Steering Behaviors: Seek, Flee, Arrive, Pursue, Evade, Wander, Path Following, Collision Avoidance and Combining them.
Language: C++ - Size: 258 MB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 40 - Forks: 6

Piyush-Srivastava16/FLAPPY_BIRD-
A simple game where you control a bird to avoid pipes by tapping to make it flap. Built with HTML, CSS, and JavaScript for structure, styling, and game logic.
Language: JavaScript - Size: 72.3 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 0 - Forks: 0

Shuijing725/CrowdNav_HEIGHT
[arXiv 2024] "HEIGHT: Heterogeneous Interaction Graph Transformer for Robot Navigation in Crowded and Constrained Environments"
Language: Python - Size: 71.2 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 38 - Forks: 2

AUTOBarge/autobargesim
A MATLAB toolbox for the design and analysis of a guidance and control system for autonomous inland vessels.
Language: C++ - Size: 51.1 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 1 - Forks: 0

dji-sdk/Onboard-SDK
DJI Onboard SDK Official Repository
Language: C++ - Size: 237 MB - Last synced at: about 1 month ago - Pushed at: about 1 year ago - Stars: 933 - Forks: 632

snape/RVO2-Java
Optimal Reciprocal Collision Avoidance (Java)
Language: Java - Size: 471 KB - Last synced at: 27 days ago - Pushed at: about 1 year ago - Stars: 50 - Forks: 9

lilingxi01/cas_ws
Collision Avoidance System (Robotics) - Implemented using ROS Noetic (with Python), YOLOv8, OpenCV, and Kalman Filter.
Language: Python - Size: 600 KB - Last synced at: 2 days ago - Pushed at: almost 2 years ago - Stars: 7 - Forks: 0

palmerabollo/rvo2-js
Reciprocal Collision Avoidance for Real-Time Multi-Agent Simulation (port to Javascript). This is an alpha release of a RVO2 port from the C# version to Javascript, only for research purposes.
Language: JavaScript - Size: 27.3 KB - Last synced at: 29 days ago - Pushed at: over 7 years ago - Stars: 35 - Forks: 9

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: about 1 month ago - Pushed at: about 2 months ago - Stars: 18 - Forks: 6

gkouros/rsband_local_planner
A ROS move_base local planner plugin for Car-Like robots with Ackermann or 4-Wheel-Steering.
Language: C++ - Size: 910 KB - Last synced at: about 1 month ago - Pushed at: almost 6 years ago - Stars: 166 - Forks: 51

shaoanlu/sqp_nmpc_cbf_cvxpy
Model predictive control with Discrete Control Barrier Function constraints using CVXPY and OSQP
Language: Jupyter Notebook - Size: 644 KB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 0 - Forks: 0

Voltamon/Aeronet
AeroNet is a project aimed at improving Air Traffic Management (ATM). It automates routine tasks, enhances safety, and provides efficient flight path planning.
Language: Python - Size: 45.8 MB - Last synced at: 26 days ago - Pushed at: about 2 months ago - Stars: 2 - Forks: 1

aavek/Aeolus-Ocean
An all-weather, day-and-night, collision avoidance simulator that can be implemented as a digital twin for the autonomous COLREG-compliant navigation of maritime vessels.
Size: 147 KB - Last synced at: about 1 month ago - Pushed at: almost 2 years ago - Stars: 44 - Forks: 4

Kaushal-Bora/Cut-In-Detection
Intel workshop project on vehicle cut in detection
Language: Python - Size: 148 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 2 - Forks: 0

Mobile-Telematics/telematicsSDK-demoapp-flutter-
Demo telematics app for Flutter. The application walks you through the telematics SDK integration. The technology is suitable for UBI (Usage-based insurance), shared mobility, transportation, safe driving, tracking, family trackers, drive-coach, and other driving mobile applications
Language: Dart - Size: 199 KB - Last synced at: 23 days ago - Pushed at: 2 months ago - Stars: 21 - Forks: 10

zergon321/cirno
An easy-to-use collision resolution library for gamedev written in pure Go.
Language: Go - Size: 3.46 MB - Last synced at: about 1 month ago - Pushed at: over 3 years ago - Stars: 23 - Forks: 2

mghro/rad-collision
Platform for collision detection during treatment planning in radiotherapy
Language: Python - Size: 587 KB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 33 - Forks: 13

snape/HRVO
The Hybrid Reciprocal Velocity Obstacle (C++)
Language: C++ - Size: 744 KB - Last synced at: 27 days ago - Pushed at: about 1 year ago - Stars: 139 - Forks: 39

salihmarangoz/dawn_ik
Master's Thesis: DawnIK is a real-time inverse kinematics solver for robotic arms focusing on observation capabilities with collision avoidance and multiple objectives for ROS1
Language: C++ - Size: 43.1 MB - Last synced at: about 15 hours ago - Pushed at: about 1 year ago - Stars: 6 - Forks: 0

milosz275/uav-collision-avoidance 📦
Python project regarding implementation of two UAVs physics and collision detection/avoidance simulation.
Language: Python - Size: 9.72 MB - Last synced at: 7 days ago - Pushed at: 10 months ago - Stars: 6 - Forks: 0

heethesh/Collision-Avoidance-System
Collision Avoidance System for Self-Driving Vehicles by Delta Autonomy, Robotics Institute, CMU
Size: 2.85 MB - Last synced at: 3 months ago - Pushed at: over 4 years ago - Stars: 51 - Forks: 26

zenop95/Recursive-polynomial-CAM-design
This repository includes all the necessary routines to run the CAM optimization with the method described in Pavanello et al. 2024.
Language: Sway - Size: 148 MB - Last synced at: 30 days ago - Pushed at: 3 months ago - Stars: 0 - Forks: 0

snape/AVO2
Reciprocal Collision Avoidance with Acceleration-Velocity Obstacles (C++)
Language: C++ - Size: 315 KB - Last synced at: 27 days ago - Pushed at: about 1 year ago - Stars: 63 - Forks: 18

os-olaniyi/mpc-motion-predictor
Model Predictive Controller (MPC) with a learning-based motion predictor
Language: Python - Size: 6.38 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 2 - Forks: 0

pepeleduin/Collision-Avoidance-Algorithms-in-2D-using-Voronoi-Diagrams
Code used in my Graduation Project as requirement for obtaining the degree of Information Technology Engineer.
Language: Jupyter Notebook - Size: 9.46 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 3 - Forks: 0

RobustFieldAutonomyLab/Distributional_RL_Navigation
[IROS 2023] Robust Unmanned Surface Vehicle Navigation with Distributional Reinforcement Learning
Language: Python - Size: 4.04 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 56 - Forks: 2

TempleRAIL/drl_vo_nav
[T-RO 2023] DRL-VO: Learning to Navigate Through Crowded Dynamic Scenes Using Velocity Obstacles
Language: Python - Size: 131 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 176 - Forks: 13

raja-s/ORCA
An attempt at a simple implementation of the ORCA algorithm 🤖💢🤖📋
Language: C++ - Size: 41 KB - Last synced at: 12 days ago - Pushed at: about 1 year ago - Stars: 9 - Forks: 4

Shuijing725/CrowdNav_Sim2Real_Turtlebot
[ICRA 2023] Intention Aware Robot Crowd Navigation with Attention-Based Interaction Graph -- Sim2real code on Turtlebot2i
Language: Python - Size: 311 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 41 - Forks: 7

Shuijing725/CrowdNav_Prediction_AttnGraph
[ICRA 2023] Intention Aware Robot Crowd Navigation with Attention-Based Interaction Graph
Language: Python - Size: 45.9 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 173 - Forks: 30

tdorssers/Robot2
Line following and collision avoidance robot car II
Language: C - Size: 901 KB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 1 - Forks: 1

le9endary/Depth_Estimation_and_Collision_Avoidance
This repository contain code for Collision avoidance, Monocular and Stereo Depth Estimation
Language: Python - Size: 3.65 MB - Last synced at: 15 days ago - Pushed at: over 2 years ago - Stars: 1 - Forks: 1

sepsamavi/safe-interactive-crowdnav
Code base for SICNav: Safe and Interactive Crowd Navigation using Model Predictive Control and Bilevel Optimization
Language: Python - Size: 1.03 MB - Last synced at: 6 months ago - Pushed at: 6 months ago - Stars: 10 - Forks: 2

manthan0x23/Pallete-town-gamified-JS
Gamified pallete town
Language: JavaScript - Size: 147 KB - Last synced at: 22 days ago - Pushed at: 10 months ago - Stars: 1 - Forks: 0

chentyra/jetracer-CollisionAvoidance
Collision Avoidance Strategies with Jetracer Pro AI Kit.
Language: Jupyter Notebook - Size: 16.3 MB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 3 - Forks: 1

jaimeperezsanchez/Collision_Avoidance_Challenge_Deep_Learning
Language: Jupyter Notebook - Size: 106 MB - Last synced at: 3 months ago - Pushed at: about 5 years ago - Stars: 8 - Forks: 1

Shuijing725/awesome-robot-social-navigation
A curated list of robot social navigation.
Size: 87.9 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 72 - Forks: 7

UmbertoPirovano/WiFi6_Collision_Avoidance_Simulator
Wi-Fi6 Collision avoidance simulator for Microsoft AirSim
Language: Python - Size: 273 MB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 0

CAI23sbP/CrowdNav_Cai
Stable-baselines3 based CrowdNavigation Simulator, It is based on 2d lidar scan.
Language: Python - Size: 20.6 MB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 2 - Forks: 6

francesco-fortunato/Laser-Based-Collision-Avoidance-System
Questa repository rappresenta il risultato del mio lavoro di tesi, focalizzato sullo sviluppo di un Laser-Based Collision Avoidance System per applicazioni robotiche. Il sistema è stato progettato per migliorare la sicurezza dei robot e prevenire le collisioni utilizzando la tecnologia basata su laser.
Language: C++ - Size: 2.8 MB - Last synced at: 9 months ago - Pushed at: almost 3 years ago - Stars: 0 - Forks: 0

RobustFieldAutonomyLab/Multi_Robot_Distributional_RL_Navigation
[ICRA 2024] Decentralized Multi-Robot Navigation for Autonomous Surface Vehicles with Distributional Reinforcement Learning
Language: Python - Size: 1.16 MB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 40 - Forks: 4

H1ghBre4k3r/orca-rs
Library for using ORCA written in Rust. Originally part of my bachelors thesis.
Language: Rust - Size: 38.1 KB - Last synced at: 2 days ago - Pushed at: 9 months ago - Stars: 2 - Forks: 0

JosephRajBGCT/NEX_GEN_ZERO
NEXT-GEN-ZERO is the project developed to tackle the problem faced by India during the 2023 Odisha Train Collision
Language: Python - Size: 532 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 0 - Forks: 0

vita-epfl/CrowdNav
[ICRA19] Crowd-aware Robot Navigation with Attention-based Deep Reinforcement Learning
Language: Python - Size: 612 KB - Last synced at: 9 months ago - Pushed at: over 2 years ago - Stars: 568 - Forks: 166

ZalZarak/RGBD-to-3D-Pose
This repository extracts 3D-coordinates of joint positions of a humanoid using OpenPose and a IntelRealSense Depth-Camera. With those joints it simulates a humanoid having spheres and cylinders as limbs in PyBullet. It is designed detect humans for collision avoidance for robots (proof of concept).
Language: Python - Size: 9.89 MB - Last synced at: 10 months ago - Pushed at: 10 months ago - Stars: 4 - Forks: 1

Golchoubian/UncertaintyAware_DRL_CrowdNav
Uncertainty-Aware DRL for Autonomous Vehicle Crowd Navigation in Shared Space (IEEE-IV-2024)
Language: Python - Size: 57 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 8 - Forks: 1

downflux/go-boids
Golang implementation of Boid flocking
Language: Go - Size: 105 MB - Last synced at: 11 months ago - Pushed at: over 2 years ago - Stars: 0 - Forks: 0

TagirMuslimov/Swarm_with_VortexVectField
Vortex vector field for collision avoidance in drone swarm formation control
Language: Python - Size: 5.56 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

TempleRAIL/nav-competition-icra2022-drl-vo
DRL-VO navigation policy for BARN Challenge
Language: Python - Size: 33.6 MB - Last synced at: 10 months ago - Pushed at: over 1 year ago - Stars: 21 - Forks: 2

FelixChristian011226/NTFields Fork of ruiqini/NTFields
NTFields-Based Multi-robot Path Planning.
Language: Python - Size: 7.54 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

phuongboi/robot-navigation-in-crowd
Robot navigation with Q learning
Language: Python - Size: 45.5 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 0 - Forks: 0

tdorssers/Robot
Line following and collision avoidance robot car
Language: C - Size: 9.41 MB - Last synced at: 12 months ago - Pushed at: over 6 years ago - Stars: 0 - Forks: 0

QuantuMAtharva/Swarm_ARIITK
Obstacle Avoidance using Swarm Robotics
Language: C++ - Size: 13.7 MB - Last synced at: 12 months ago - Pushed at: 12 months ago - Stars: 4 - Forks: 3

LuddeWessen/assembly-robot-manager-minizinc
A scheduler to manage a multi tool dual arm robot while avoiding arm-to-arm collisions; considering complex side constraints; and optimizing for cyclic schedules.
Language: Python - Size: 312 KB - Last synced at: 11 months ago - Pushed at: almost 4 years ago - Stars: 8 - Forks: 0

Kartmaan/turtle-anticollision
Random generation of circles bounded by an anti-collision system
Language: Python - Size: 13.7 KB - Last synced at: about 2 months ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 0

Shuijing725/CrowdNav_DSRNN
[ICRA 2021] Decentralized Structural-RNN for Robot Crowd Navigation with Deep Reinforcement Learning
Language: Python - Size: 7.49 MB - Last synced at: 12 months ago - Pushed at: about 1 year ago - Stars: 91 - Forks: 23

alexbhas/RFID-Binary-Tree-Collision-Avoidance
A Python simulation that re-creates the work of an RFID anti collision algorithms research paper
Language: Python - Size: 14.6 KB - Last synced at: about 1 year ago - Pushed at: about 2 years ago - Stars: 1 - Forks: 0

GuillermoHazebrouck/gnav
G-NAV is a soaring computer for Linux OS, written in Ada and powered by OpenGL (ES) and either GLFW or SDL. It runs native on Raspberry Pi and similar ARM boards.
Language: G-code - Size: 67.9 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 19 - Forks: 0

mit-acl/cadrl_ros
ROS package for dynamic obstacle avoidance for ground robots trained with deep RL
Language: Python - Size: 6.12 MB - Last synced at: about 1 year ago - Pushed at: over 3 years ago - Stars: 545 - Forks: 155

gustavomoers/CollisionAvoidance-Carla-DRL-MPC
A hybrid collision avoidance system combining Deep Reinforcement Learning with Model Predictive Control, designed for autonomous vehicles in CARLA to navigate scenarios with stationary obstacles.
Language: Python - Size: 35.1 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 0 - Forks: 0

mit-acl/rl_collision_avoidance
Training code for GA3C-CADRL algorithm (collision avoidance with deep RL)
Language: Python - Size: 90.8 KB - Last synced at: about 1 year ago - Pushed at: almost 3 years ago - Stars: 110 - Forks: 27

ngafur/MPC_MultiRobot_Motion_Planning
Online motion control for a multirobot system based on model predictive control (MPC)
Language: Python - Size: 265 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 1 - Forks: 0

gustavomoers/E2E-CARLA-ReinforcementLearning-PPO
An end-to-end (E2E) reinforcement learning model for autonomous vehicle collision avoidance in the CARLA simulator, using a recurrent PPO algorithm for dynamic control. The model processes RGB camera inputs to make real-time acceleration and steering decisions.
Language: Python - Size: 307 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 2 - Forks: 0

downflux/go-orca
Golang implementation of the Optimal Reciprocal Collision Avoidance (ORCA) algorithm
Language: Go - Size: 200 MB - Last synced at: 11 months ago - Pushed at: over 2 years ago - Stars: 42 - Forks: 2

jimfleming/rvo2
Unofficial port of RVO2 to Python3
Language: Python - Size: 21.5 KB - Last synced at: about 1 year ago - Pushed at: over 7 years ago - Stars: 29 - Forks: 9

jiemingChen/pedestrainAvoidance
Language: C++ - Size: 265 MB - Last synced at: about 1 year ago - Pushed at: over 4 years ago - Stars: 8 - Forks: 5

pulp-bio/tcn_under_review
Temporal Convolutional Network shared for academic manuscript peer review.
Language: Jupyter Notebook - Size: 58.6 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

Geonhee-LEE/mpc_ros
Differential Wheeled Mobile Robot - Nonlinear Model Predictive Control based on ROS
Language: C++ - Size: 2.33 MB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 590 - Forks: 153

Acmece/rl-collision-avoidance
Implementation of the paper "Towards Optimally Decentralized Multi-Robot Collision Avoidance via Deep Reinforcement Learning"
Language: Python - Size: 29.4 MB - Last synced at: over 1 year ago - Pushed at: over 4 years ago - Stars: 266 - Forks: 90

JaiminShimpi/collicube
A small game with a cube as your main hero and try to avoid your enemy colliders.
Language: C# - Size: 345 KB - Last synced at: 2 months ago - Pushed at: almost 4 years ago - Stars: 2 - Forks: 0

justinprez/ecocar
EcoCAR Y2 submission - car detection and collision prevention.
Language: Python - Size: 5.14 MB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 1 - Forks: 1

hanlinniu/turtlebot3_ddpg_collision_avoidance
Mapless Collision Avoidance of Turtlebot3 Mobile Robot Using DDPG and Prioritized Experience Replay
Language: C++ - Size: 48.4 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 76 - Forks: 27

SiddhantNadkarni/Keypoint-Tracking-and-Matching
Keypoint Tracking and Matching in Autonomous Vehicles to measure TTC between consecutive frames of the KITTI Dataset
Language: Jupyter Notebook - Size: 6.31 MB - Last synced at: over 1 year ago - Pushed at: over 5 years ago - Stars: 5 - Forks: 0

szebedy/autonomous-drone
This repository intends to enable autonomous drone delivery with the Intel Aero RTF drone and PX4 autopilot. The code can be executed both on the real drone or simulated on a PC using Gazebo. Its core is a robot operating system (ROS) node, which communicates with the PX4 autopilot through mavros. It uses SVO 2.0 for visual odometry, WhyCon for visual marker localization and Ewok for trajectoy planning with collision avoidance.
Language: C++ - Size: 860 KB - Last synced at: over 1 year ago - Pushed at: almost 6 years ago - Stars: 144 - Forks: 67

jesusBV20/MT-DATCOM
Design and integration of Guidance, Navigation and Control systems for autonomous robot swarms
Language: TeX - Size: 48 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

Blue-Ray7/TurtleBot3
Create different robot applications using Turtlebot3 burger
Language: C++ - Size: 41 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 0 - Forks: 0

lunarpulse/Integrator
Language: C - Size: 516 KB - Last synced at: almost 2 years ago - Pushed at: almost 8 years ago - Stars: 0 - Forks: 0

Gnabriel/Multi-Agent-AI-Dynamic-Interaction
Assignment 3 in course DD2438 Artificial Intelligence and Multi Agent Systems at KTH Royal Institute of Technology.
Language: C# - Size: 20.3 MB - Last synced at: almost 2 years ago - Pushed at: over 3 years ago - Stars: 0 - Forks: 0

acsl-inha/collision_avoidance
Aircraft detection and collision avoidance
Language: Jupyter Notebook - Size: 335 MB - Last synced at: almost 2 years ago - Pushed at: about 4 years ago - Stars: 3 - Forks: 0

DeepDuke/DWA-Simulation
Simulation for DWA (Dynamic Window Approach) and modified DWA algorithms
Language: Python - Size: 105 KB - Last synced at: almost 2 years ago - Pushed at: almost 5 years ago - Stars: 14 - Forks: 1

ser94mor/2d-feature-tracking
Project: 2D Feature Tracking || Udacity: Sensor Fusion Engineer Nanodegree
Language: C++ - Size: 5.3 MB - Last synced at: almost 2 years ago - Pushed at: almost 6 years ago - Stars: 6 - Forks: 1

Baptistussi/collision_predictor
Simple self-driving cars simulation using pygame applying Kalman Filters for avoiding collisions
Language: Python - Size: 372 KB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 0 - Forks: 0

Ericcsr/wheeled_robot_navigation
A package for realtime wheeled robot motion planning and collision-free control
Language: Python - Size: 7.38 MB - Last synced at: almost 2 years ago - Pushed at: over 4 years ago - Stars: 16 - Forks: 2

LyapunovJingci/Warehouse_Robot_Path_Planning
A multi agent path planning solution under a warehouse scenario using Q learning and transfer learning.🤖️
Language: Python - Size: 2.58 MB - Last synced at: almost 2 years ago - Pushed at: almost 5 years ago - Stars: 72 - Forks: 19

MustafaLotfi/Controlling-Multiple-Robots
Controlling multiple mobile robots to go to their destinations without any collision.
Language: MATLAB - Size: 3.39 MB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 6 - Forks: 0
