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

Topic: "path-planning"

AtsushiSakai/PythonRobotics

Python sample codes and textbook for robotics algorithms.

Language: Python - Size: 290 MB - Last synced at: 1 day ago - Pushed at: 1 day ago - Stars: 24,915 - Forks: 6,759

zhm-real/PathPlanning

Common used path planning algorithms with animations.

Language: Python - Size: 10.7 MB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 8,475 - Forks: 1,705

ai-winter/ros_motion_planning

Motion planning and Navigation of AGV/AMR:ROS planner plugin implementation of A*, JPS, D*, LPA*, D* Lite, Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, ACO, PSO, Voronoi, PID, LQR, MPC, DWA, APF, Pure Pursuit etc.

Language: C++ - Size: 140 MB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 2,708 - Forks: 427

roboticslibrary/rl

The Robotics Library (RL) is a self-contained C++ library for rigid body kinematics and dynamics, motion planning, and control.

Language: C++ - Size: 3.32 MB - Last synced at: 3 days ago - Pushed at: 25 days ago - Stars: 1,050 - Forks: 231

mit-acl/faster

3D Trajectory Planner in Unknown Environments

Language: C++ - Size: 107 MB - Last synced at: 18 days ago - Pushed at: 2 months ago - Stars: 1,050 - Forks: 189

atb033/multi_agent_path_planning

Python implementation of a bunch of multi-robot path-planning algorithms.

Language: Python - Size: 8.77 MB - Last synced at: 11 months ago - Pushed at: about 2 years ago - Stars: 1,011 - Forks: 251

rst-tu-dortmund/teb_local_planner

An optimal trajectory planner considering distinctive topologies for mobile robots based on Timed-Elastic-Bands (ROS Package)

Language: C++ - Size: 1.68 MB - Last synced at: 9 months ago - Pushed at: about 1 year ago - Stars: 997 - Forks: 547

yrlu/quadrotor

Quadrotor control, path planning and trajectory optimization

Language: MATLAB - Size: 37.5 MB - Last synced at: 30 days ago - Pushed at: about 1 year ago - Stars: 962 - Forks: 291

ShisatoYano/AutonomousVehicleControlBeginnersGuide

Python sample codes and documents about Autonomous vehicle control algorithm. This project can be used as a technical guide book to study the algorithms and the software architectures for beginners.

Language: Python - Size: 130 MB - Last synced at: about 17 hours ago - Pushed at: 21 days ago - Stars: 687 - Forks: 110

ai-winter/python_motion_planning

Motion planning(Path Planning and Trajectory Planning/Tracking) of AGV/AMR:python implementation of Dijkstra, A*, JPS, D*, LPA*, D* Lite, (Lazy)Theta*, RRT, RRT*, RRT-Connect, Informed RRT*, Voronoi, PID, DWA, APF, LQR, MPC, RPP, Bezier, Dubins etc.

Language: Python - Size: 17.6 MB - Last synced at: 30 days ago - Pushed at: 30 days ago - Stars: 678 - Forks: 89

henki-robotics/robotics_essentials_ros2

Learn the basics of robotics through hands-on experience using ROS 2 and Gazebo simulation.

Language: C++ - Size: 27.1 MB - Last synced at: about 2 months ago - Pushed at: about 2 months ago - Stars: 670 - Forks: 95

ethz-asl/mav_active_3d_planning

Modular framework for online informative path planning.

Language: C++ - Size: 1.12 MB - Last synced at: 18 days ago - Pushed at: 5 months ago - Stars: 623 - Forks: 115

rst-tu-dortmund/mpc_local_planner

The mpc_local_planner package implements a plugin to the base_local_planner of the 2D navigation stack. It provides a generic and versatile model predictive control implementation with minimum-time and quadratic-form receding-horizon configurations.

Language: C++ - Size: 168 KB - Last synced at: 4 days ago - Pushed at: over 2 years ago - Stars: 595 - Forks: 147

Fields2Cover/Fields2Cover

Robust and efficient coverage paths for autonomous agricultural vehicles. A modular and extensible Coverage Path Planning library

Language: C++ - Size: 3.55 MB - Last synced at: 6 days ago - Pushed at: 6 days ago - Stars: 587 - Forks: 124

LiJiangnanBit/path_optimizer

Optimization-based real-time path planning for vehicles.

Language: C++ - Size: 11.3 MB - Last synced at: 4 days ago - Pushed at: over 1 year ago - Stars: 570 - Forks: 148

Zhefan-Xu/CERLAB-UAV-Autonomy

[CMU] A Versatile and Modular Framework Designed for Autonomous Unmanned Aerial Vehicles [UAVs] (C++/ROS/PX4)

Language: C++ - Size: 144 KB - Last synced at: about 1 month ago - Pushed at: about 1 month ago - Stars: 470 - Forks: 62

mit-acl/mader

Trajectory Planner in Multi-Agent and Dynamic Environments

Language: C++ - Size: 123 MB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 451 - Forks: 74

giacomo-b/CppRobotics

Header-only C++ library for robotics, control, and path planning algorithms. Work in progress, contributions are welcome!

Language: C++ - Size: 265 KB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 434 - Forks: 51

Habrador/Self-driving-vehicle

Simulation of path planning for self-driving vehicles in Unity. This is also an implementation of the Hybrid A* pathfinding algorithm which is useful if you are interested in pathfinding for vehicles.

Language: C# - Size: 13 MB - Last synced at: 16 days ago - Pushed at: over 1 year ago - Stars: 428 - Forks: 103

rlnav/motion_planning

Robot path planning, mapping and exploration algorithms

Language: Jupyter Notebook - Size: 169 MB - Last synced at: 22 days ago - Pushed at: 2 months ago - Stars: 383 - Forks: 75

YashBansod/Robotics-Planning-Dynamics-and-Control

RPDC : This contains all my MATLAB codes for the Robotics, Planning, Dynamics and Control . The implementations model various kinds of manipulators and mobile robots for position control, trajectory planning and path planning problems.

Language: MATLAB - Size: 4.98 MB - Last synced at: about 1 month ago - Pushed at: almost 5 years ago - Stars: 383 - Forks: 82

vleue/polyanya

Pathfinding using Polyanya

Language: Rust - Size: 2 MB - Last synced at: 27 days ago - Pushed at: about 1 month ago - Stars: 369 - Forks: 25

Pandas-Team/Automatic-Parking

Python implementation of an automatic parallel parking system in a virtual environment, including path planning, path tracking, and parallel parking

Language: Python - Size: 1.43 MB - Last synced at: 13 days ago - Pushed at: almost 2 years ago - Stars: 363 - Forks: 84

ayushgaud/path_planning

Quadcopter path planning using RRT* and minimum jerk trajectory generation

Language: C++ - Size: 27.3 KB - Last synced at: 6 months ago - Pushed at: over 2 years ago - Stars: 344 - Forks: 99

winstxnhdw/AutoCarROS2

A virtual simulation platform for autonomous vehicle sensing, mapping, control and behaviour methods using ROS 2 and Gazebo.

Language: Python - Size: 81.6 MB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 329 - Forks: 58

vss2sn/path_planning

This repository contains path planning algorithms in C++ for a grid based search.

Language: C++ - Size: 6.69 MB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 321 - Forks: 88

vleue/vleue_navigator

Pathfinding on NavMeshes for Bevy

Language: Rust - Size: 2.49 MB - Last synced at: 6 days ago - Pushed at: about 1 month ago - Stars: 319 - Forks: 28

sichkar-valentyn/Reinforcement_Learning_in_Python

Implementing Reinforcement Learning, namely Q-learning and Sarsa algorithms, for global path planning of mobile robot in unknown environment with obstacles. Comparison analysis of Q-learning and Sarsa

Language: Python - Size: 23.4 MB - Last synced at: over 1 year ago - Pushed at: about 3 years ago - Stars: 294 - Forks: 97

rishabh1b/RealTimePathPlanning

Sampling based rewiring approaches to solve motion planning problems for a robot with dynamic obstacles

Language: C++ - Size: 2.76 MB - Last synced at: over 1 year ago - Pushed at: over 7 years ago - Stars: 275 - Forks: 96

sigmaai/self-driving-golf-cart

Be Driven 🚘

Language: C++ - Size: 1.58 GB - Last synced at: about 2 months ago - Pushed at: over 3 years ago - Stars: 260 - Forks: 68

Dungyichao/Electric-Vehicle-Route-Planning-on-Google-Map-Reinforcement-Learning

User can set up destination for any agent to navigate on Google Map and learn the best route for the agent based on its current condition and the traffic. Our result is 10% less energy consumption than the route provided by Google map

Language: Python - Size: 3.44 MB - Last synced at: about 1 month ago - Pushed at: over 2 years ago - Stars: 250 - Forks: 65

RoboJackets/rrt 📦

C++ RRT (Rapidly-exploring Random Tree) Implementation

Language: C++ - Size: 1.62 MB - Last synced at: 9 months ago - Pushed at: almost 5 years ago - Stars: 250 - Forks: 85

zhaohaojie1998/Grey-Wolf-Optimizer-for-Path-Planning

灰狼优化算法(GWO)路径规划/轨迹规划/轨迹优化、多智能体/多无人机航迹规划

Language: MATLAB - Size: 7 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 237 - Forks: 24

UnknownFreeOccupied/ufomap

UFOMap: An Efficient Probabilistic 3D Mapping Framework That Embraces the Unknown

Language: C++ - Size: 1.75 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 222 - Forks: 42

fjp/frenet

Transform Frenet (s,d) to local Cartesian (x,y) coordinates.

Language: HTML - Size: 1.76 MB - Last synced at: about 1 year ago - Pushed at: about 2 years ago - Stars: 207 - Forks: 65

icsl-Jeon/traj_gen

Optimal trajectory generation library given equality and inequality constraints (C++/Matlab)

Language: HTML - Size: 39.4 MB - Last synced at: over 1 year ago - Pushed at: over 4 years ago - Stars: 191 - Forks: 47

peiyu-cui/uav_motion_planning

UAV Motion-Planning Path-Planning A*, Kinodynamic A*, RRT, RRT*, SE(3)Planning, Minimum-Snap

Language: C++ - Size: 171 MB - Last synced at: 26 days ago - Pushed at: 26 days ago - Stars: 184 - Forks: 23

haosulab/MPlib

a Lightweight Motion Planning Package

Language: C++ - Size: 58.6 MB - Last synced at: 15 days ago - Pushed at: 7 months ago - Stars: 184 - Forks: 32

ZJU-FAST-Lab/Implicit-SVSDF-Planner

[SIGGRAPH 2024 & TOG]

Language: C++ - Size: 61.1 MB - Last synced at: about 1 month ago - Pushed at: 10 months ago - Stars: 181 - Forks: 11

jvgomez/fast_methods

N-Dimensional Fast Methods: Fast Marching, Fast Sweeping, Group Marching, Fast Iterative, etc.

Language: C++ - Size: 154 MB - Last synced at: 5 months ago - Pushed at: about 2 years ago - Stars: 175 - Forks: 60

SS47816/fiss_planner

[RA-L 2022] FISS: A Trajectory Planning Framework using Fast Iterative Search and Sampling Strategy for Autonomous Driving

Language: C++ - Size: 7.93 MB - Last synced at: 30 days ago - Pushed at: over 1 year ago - Stars: 169 - Forks: 35

enginBozkurt/MotionPlanner

Motion Planner for Self Driving Cars

Language: Python - Size: 171 KB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 156 - Forks: 62

olzhas/rrt_toolbox

RRT, RRT*, RRT*FN algorithms for MATLAB

Language: MATLAB - Size: 1.06 MB - Last synced at: over 1 year ago - Pushed at: about 4 years ago - Stars: 151 - Forks: 48

rsasaki0109/rust_robotics

Rust implementation of PythonRobotics such as EKF, DWA, Pure Pursuit, LQR.

Language: Rust - Size: 538 KB - Last synced at: 3 months ago - Pushed at: 3 months ago - Stars: 146 - Forks: 9

zhaohaojie1998/DRL-for-Path-Planning

深度强化学习路径规划, SAC-Auto路径规划, Soft Actor-Critic算法, SAC-pytorch,激光雷达Lidar避障,激光雷达仿真模拟,Adaptive-SAC

Language: Python - Size: 11.5 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 138 - Forks: 17

moribots/motion_planning

Motion Planning Library to accompany turtlebot3_from_scratch repository. Deployed PRM, Grid Map, A*, Theta*, LPA*, D* Lite*, Potential Field, and MPPI.

Language: C++ - Size: 30.5 MB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 135 - Forks: 37

jfrascon/SLAM_AND_PATH_PLANNING_ALGORITHMS

This repository contains the solutions to all the exercises for the MOOC about SLAM and PATH-PLANNING algorithms given by professor Claus Brenner at Leibniz University. This repository also contains my personal notes, most of them in PDF format, and many vector graphics created by myself to illustrate the theoretical concepts. Hope you enjoy it! :)

Language: Python - Size: 267 MB - Last synced at: over 1 year ago - Pushed at: over 6 years ago - Stars: 129 - Forks: 53

LiJiangnanBit/path_optimizer_2

Optimization-based real-time path planning for vehicles.

Language: C++ - Size: 118 KB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 125 - Forks: 48

iory/scikit-robot

A Flexible Framework for Robot visualization and programming in Python

Language: Python - Size: 3.27 MB - Last synced at: about 15 hours ago - Pushed at: 17 days ago - Stars: 124 - Forks: 25

HaiderAbasi/ROS2-Path-Planning-and-Maze-Solving

Developing a maze solving robot in ROS2 that leverages information from a drone or Satellite's camera using OpenCV algorithms to find its path to the goal and solve the maze. :)

Language: Python - Size: 54.2 MB - Last synced at: 9 months ago - Pushed at: about 1 year ago - Stars: 124 - Forks: 104

realkushagrakhare/3D_Path_Planning

AI project for 3D Path Planning. Other details and running instructions can be found on the Readme.md file

Language: Python - Size: 5.74 MB - Last synced at: about 1 month ago - Pushed at: over 6 years ago - Stars: 117 - Forks: 39

Zhefan-Xu/Intent-MPC

[IEEE RA-L'25] Intent Prediction-Driven Model Predictive Control for UAV Planning and Navigation in Dynamic Environments (C++/ROS)

Language: C++ - Size: 90.7 MB - Last synced at: 30 days ago - Pushed at: 30 days ago - Stars: 115 - Forks: 7

yunshengtian/Assemble-Them-All

[SIGGRAPH Asia 2022] Assemble Them All: Physics-Based Planning for Generalizable Assembly by Disassembly

Language: C++ - Size: 15.1 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 115 - Forks: 14

medalotte/sampling-based-planners

C++ implementation of RRT, RRT*, and Informed-RRT* using kd-tree for searching NN and NBHD nodes. Supports arbitrary dimensions and compiles as a shared library.

Language: C++ - Size: 4.33 MB - Last synced at: over 1 year ago - Pushed at: almost 4 years ago - Stars: 115 - Forks: 27

jhan15/dubins_path_planning

Path planning using Hybrid A*/RRT + Dubins Path (as final shot).

Language: Python - Size: 221 KB - Last synced at: about 1 year ago - Pushed at: almost 3 years ago - Stars: 107 - Forks: 29

gavincangan/multiagent-pathfinding

Conflict-based search for multi-agent path finding

Language: Python - Size: 60.5 KB - Last synced at: 4 days ago - Pushed at: about 6 years ago - Stars: 107 - Forks: 15

sarthak268/Obstacle_Avoidance_for_UAV

ROS workspace that creates a trajectory for a UAV to follow passing through a set of given waypoints and avoiding a set of given cylindrical obstacles.

Language: Makefile - Size: 2.92 MB - Last synced at: about 1 year ago - Pushed at: over 2 years ago - Stars: 103 - Forks: 26

AliAmini93/Metaheuristic-Optimization

Projects with Genetic Algorithm (GA), Ant Colony Optimization (ACO), and Particle Swarm Optimization (PSO)

Size: 4.88 KB - Last synced at: 9 months ago - Pushed at: 9 months ago - Stars: 102 - Forks: 1

duongpm/SPSO

Spherical Vector-based Particle Swarm Optimization

Language: MATLAB - Size: 2.88 MB - Last synced at: 20 days ago - Pushed at: 20 days ago - Stars: 100 - Forks: 28

hayoung-kim/udacity-path-planning

My solution for udacity path planning project. This makes the car drive > 20 miles without collision without constraint violation

Language: C++ - Size: 9.21 MB - Last synced at: about 2 years ago - Pushed at: almost 7 years ago - Stars: 98 - Forks: 35

omron-sinicx/neural-astar

Official implementation of "Path Planning using Neural A* Search" (ICML-21)

Language: Jupyter Notebook - Size: 12.3 MB - Last synced at: about 2 years ago - Pushed at: about 2 years ago - Stars: 96 - Forks: 34

RicheyHuang/CoveragePlanner

Complete Coverage Path Planning Using BCD Algorithm

Language: C++ - Size: 802 KB - Last synced at: about 2 years ago - Pushed at: almost 5 years ago - Stars: 96 - Forks: 38

sourishg/rrt-simulator

Path planning using RRT

Language: C++ - Size: 63.5 KB - Last synced at: over 1 year ago - Pushed at: over 2 years ago - Stars: 93 - Forks: 39

kohonda/proj-svg_mppi

[ICRA2024] Stein Variational Guided Model Predictive Path Integral Control: Proposal and Experiments with Fast Maneuvering Vehicles

Language: C++ - Size: 10.5 MB - Last synced at: 4 months ago - Pushed at: 4 months ago - Stars: 89 - Forks: 11

TixiaoShan/lexicographic_planning

A Receding Horizon Multi-Objective Planner for Autonomous Surface Vehicles in Urban Waterways

Language: C++ - Size: 5.83 MB - Last synced at: 12 days ago - Pushed at: over 4 years ago - Stars: 89 - Forks: 34

xxxtai/Android-CourierAssistant

派送助手——2016年全国研究生移动终端应用设计创新大赛一等奖作品。本APP集合快件管理,路线规划,一键导航和智能呼叫功能,能够帮助快递员\外卖员提高派送效率。首先将快件的地址和电话信息添加到"派送助手",点击"开始派送"。后台算法将会计算最优路线,确定快件的派送次序,快递员\外卖员依照提示依次派送。快递员\外卖员遇到不熟悉路线时,点击"导航"可以获取当前位置到目的地的导航路线。当快递员将要到达目的地时,手机会智能识别并提前拨叫用户。节省快递员等待客户取件的时间。

Language: Java - Size: 47.3 MB - Last synced at: about 2 years ago - Pushed at: about 5 years ago - Stars: 88 - Forks: 47

ShuiXinYun/Path_Plan

Path plan algorithm, include: A*, APF(Artificial Potential Field)

Language: Python - Size: 120 KB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 88 - Forks: 24

ProtoTeam/immutability-helper-x

The library extends the kolodny/immutability-helper to support update data by path string, like the get/set in lodash.

Language: JavaScript - Size: 14.6 KB - Last synced at: 18 days ago - Pushed at: over 7 years ago - Stars: 87 - Forks: 3

jhlenes/complete_coverage

ROS implementation of online complete coverage maneuvering for unmanned surface vehicles

Language: C++ - Size: 5.59 MB - Last synced at: 9 months ago - Pushed at: almost 4 years ago - Stars: 86 - Forks: 22

ETHZ-RobotX/smb_path_planner

Repository for the path planner for SMB for the ETH Robotics Summer School

Language: C++ - Size: 2.99 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 85 - Forks: 32

robotics-upo/Heuristic_path_planners

Collection of classes and functions to allow 2D/3D path generation with heuristic algorithms such as A*, Theta* and LazyTheta* and ROS Interfaces

Language: C++ - Size: 88 MB - Last synced at: 19 days ago - Pushed at: 19 days ago - Stars: 83 - Forks: 15

JatinVira/100-Days-of-Ros

A breakdown of 100 days encapsulating my journey of learning ROS, starting at the basic and upscaling to advanced concepts

Language: CMake - Size: 1.05 MB - Last synced at: almost 2 years ago - Pushed at: almost 2 years ago - Stars: 82 - Forks: 15

seung-lab/dijkstra3d

Dijkstra's Shortest Path for 6, 18, and 26-Connected 3D (Volumetric) Image Volumes

Language: C++ - Size: 2.53 MB - Last synced at: 1 day ago - Pushed at: 4 months ago - Stars: 80 - Forks: 14

JohannesBetz/AutonomousRacing_Literature

Autonomous Literature Overview

Language: TeX - Size: 4.15 MB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 79 - Forks: 13

kirilcvetkov92/Path-planning

Path planning implemented with behavior trees

Language: C++ - Size: 3.01 MB - Last synced at: about 2 years ago - Pushed at: about 6 years ago - Stars: 79 - Forks: 36

willyfh/uav-trajectory-planning

The first unofficial implementation of a paper with the title of "UAV Trajectory Planning for Data Collection from Time-Constrained IoT Devices" (IEEE Transactions on Wireless Communications 2019)

Language: MATLAB - Size: 804 KB - Last synced at: about 1 month ago - Pushed at: over 1 year ago - Stars: 78 - Forks: 14

rlnav/adaptive_swarm

Multiple robots layered path planning algorithm implemented as a ROS node to control a swarm of nano quadrotors, Crazyflies 2.X, with real-time obstacle avoidance.

Language: Jupyter Notebook - Size: 269 MB - Last synced at: 23 days ago - Pushed at: 11 months ago - Stars: 77 - Forks: 20

wylloong/Global_path_planning_for_USV

This repository uses the S-57 electronic chart to build the octree grid environment model, and proposes an improved A* algorithm based on sailing safety weight, pilot quantity and path curve smoothing to ensure the safety of the route, reduce the planning time, and improve path smoothness.

Language: Python - Size: 4.47 MB - Last synced at: over 1 year ago - Pushed at: almost 6 years ago - Stars: 75 - Forks: 22

RoboJackets/roboracing-software

ROS packages for the RoboJackets RoboRacing team.

Language: C++ - Size: 323 MB - Last synced at: over 1 year ago - Pushed at: almost 2 years ago - Stars: 74 - Forks: 57

idincern/idincern-husky

AUTONOMOUS ROBOT NAVIGATION USING ROS Clearpath Husky A200 robot with Gazebo and RViz simulations using different SLAM and Path Planning algorithms. 360 degrees laser scan with two SICK LMS511 LIDARs

Language: C++ - Size: 2.66 MB - Last synced at: almost 2 years ago - Pushed at: about 7 years ago - Stars: 73 - Forks: 28

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

abdurj/Local-Planner-Visualization-Project

An all-in-one application to visualize multiple different local path planning algorithms

Language: Python - Size: 14.3 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 71 - Forks: 10

shinkansan/2019-UGRP-DPoom

2019 DGIST DPoom project under UGRP : SBC and RGB-D camera based full autonomous driving system for mobile robot with indoor SLAM

Language: Python - Size: 180 MB - Last synced at: about 1 month ago - Pushed at: almost 3 years ago - Stars: 70 - Forks: 17

balcilar/Multi-Robot-Path-Planning-on-Graphs

Multi-Robot Path Planning on Graphs Solution by A* algorithm

Language: Matlab - Size: 147 KB - Last synced at: about 2 years ago - Pushed at: over 6 years ago - Stars: 70 - Forks: 21

papalotis/ft-fsd-path-planning

Formula Student Driverless Path Planning Algorithm. Colorblind centerline calculation algorithm developed by FaSTTUBe. It introduces a novel approach that uses neither Delaunay Triangulation nor RRT.

Language: Python - Size: 8.68 MB - Last synced at: 29 days ago - Pushed at: 29 days ago - Stars: 66 - Forks: 22

mit-acl/rmader

Decentralized Multiagent Trajectory Planner Robust to Communication Delay

Language: C++ - Size: 143 MB - Last synced at: 11 months ago - Pushed at: 11 months ago - Stars: 65 - Forks: 10

Kei18/lacam3

Engineering LaCAM*: Towards Real-Time, Large-Scale, and Near-Optimal Multi-Agent Pathfinding (AAMAS-24)

Language: C++ - Size: 27.7 MB - Last synced at: 2 months ago - Pushed at: 2 months ago - Stars: 62 - Forks: 15

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 at: about 2 years ago - Pushed at: almost 8 years ago - Stars: 62 - Forks: 19

fzipp/pathfind

Path finding on a 2D polygonal map

Language: Go - Size: 28.3 KB - Last synced at: 2 days ago - Pushed at: 4 months ago - Stars: 57 - Forks: 5

sanchithaseshadri/PathPlanningAstar

An implementation of a mobile robot path planner in Python and ROS

Language: Python - Size: 11.7 KB - Last synced at: about 2 years ago - Pushed at: over 6 years ago - Stars: 57 - Forks: 19

SS47816/frenet_optimal_planner

Implementation of the Frenet Optimal Planning Algorithm (with modifications) in ROS.

Language: C++ - Size: 15.4 MB - Last synced at: over 1 year ago - Pushed at: over 1 year ago - Stars: 56 - Forks: 20

Eurecat/astar-gridmap-2d

A* algorithms for 2D gridmaps. The fastest one, until you prove me wrong

Language: C++ - Size: 245 KB - Last synced at: about 1 year ago - Pushed at: over 5 years ago - Stars: 55 - Forks: 17

nubot-nudt/T-Hybrid-planner

[IROS23] Hybrid Map-Based Path Planning for Robot Navigation in Unstructured Environments

Language: C++ - Size: 4.12 MB - Last synced at: about 1 year ago - Pushed at: about 1 year ago - Stars: 54 - Forks: 4

tii-racing/drone-racing-dataset

A fully-annotated, open-design dataset of autonomous and piloted high-speed flight

Language: Python - Size: 2.22 MB - Last synced at: 5 months ago - Pushed at: 5 months ago - Stars: 51 - Forks: 11

ivy-llc/robot

Functions and classes for gradient-based robot motion planning, written in Ivy.

Language: Python - Size: 20 MB - Last synced at: 28 days ago - Pushed at: over 1 year ago - Stars: 51 - Forks: 11

RajPShinde/Hybrid-A-Star

Hybrid A* Motion Planner for a Car using kinematic & Reeds-Shepp Model

Language: Python - Size: 453 KB - Last synced at: over 1 year ago - Pushed at: over 3 years ago - Stars: 50 - Forks: 8

bigmb/Autonomous-Navigation-and-Exploration

Autonomous Exploration, Mapping and Path-Planning using Octomap

Language: Python - Size: 1.38 MB - Last synced at: about 1 month ago - Pushed at: over 5 years ago - Stars: 50 - Forks: 16

ericlavigne/CarND-Capstone-Wolf-Pack

ROS-based code to control a real self-driving car. Final project for "Wolf Pack" team in Udacity's Self-Driving Car Engineer Nanodegree.

Language: Python - Size: 970 MB - Last synced at: 8 months ago - Pushed at: about 7 years ago - Stars: 48 - Forks: 26

donghaiwang/NewEagles

大疆M100无人机灾后搜救的障碍物规避和路径规划模块

Language: C++ - Size: 83 KB - Last synced at: 5 days ago - Pushed at: over 8 years ago - Stars: 47 - Forks: 15

Jerrylum/path.jerryio

The best path editor in VRC for designing skills routes and generating path files.

Language: TypeScript - Size: 75.1 MB - Last synced at: 20 days ago - Pushed at: 20 days ago - Stars: 46 - Forks: 22

Related Topics
robotics 266 ros 159 pathfinding 107 motion-planning 106 python 104 navigation 80 rrt 80 self-driving-car 73 cpp 70 astar-algorithm 65 rrt-star 60 autonomous-vehicles 60 autonomous-driving 51 obstacle-avoidance 49 localization 49 matlab 44 slam 43 computer-vision 42 a-star 42 astar 41 simulation 37 gazebo 37 robot 36 dijkstra-algorithm 34 python3 34 udacity 32 uav 32 trajectory-generation 32 mapping 32 ros2 31 artificial-intelligence 31 reinforcement-learning 29 udacity-self-driving-car 28 algorithm 28 ros-noetic 25 autonomous-navigation 25 trajectory-planning 25 a-star-algorithm 24 c-plus-plus 24 control 24 deep-learning 23 opencv 23 optimization 22 dijkstra 22 machine-learning 22 astar-pathfinding 22 object-detection 22 algorithms 20 autonomous-robots 20 drone 19 planning 19 pathfinding-algorithm 18 rviz 18 search-algorithm 18 mobile-robots 17 perception 17 genetic-algorithm 17 lidar 17 potential-fields 15 trajectory-optimization 15 path-tracking 15 turtlebot3 15 bfs 15 sensor-fusion 14 graph-algorithms 14 java 14 path-planning-algorithm 14 pid-control 14 ai 13 prm 13 optimal-path 13 path-finding 13 pathfinder 12 multi-agent-systems 12 dijkstra-shortest-path 12 pathplanning 12 informed-rrt-star 12 control-systems 12 inverse-kinematics 12 path 12 kinematics 12 arduino 11 reeds-shepp 11 shortest-path-algorithm 11 collision-avoidance 11 dynamic-environments 10 ros-kinetic 10 astar-search-algorithm 10 breadth-first-search 10 dubins-path 10 a-star-search 10 sampling-based-planning 10 turtlebot 10 visualization 10 deep-reinforcement-learning 10 image-processing 10 planning-algorithms 10 frc 10 behavior-planning 9 cmake 9