Ecosyste.ms: Repos

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

GitHub topics: pathplanning

vortexntnu/vortex-auv

Software for guidance, navigation and control for the Vortex AUVs. Purpose built for competing in AUV/ROV competitions.

Language: Python - Size: 170 MB - Last synced: 1 day ago - Pushed: 1 day ago - Stars: 80 - Forks: 20

zhm-real/MotionPlanning

Motion planning algorithms commonly used on autonomous vehicles. (path planning + path tracking)

Language: Python - Size: 22.8 MB - Last synced: 3 days ago - Pushed: 4 months ago - Stars: 1,887 - Forks: 540

danielbal21/BMC_Path_Planning

Solve grid-based pathfinding challenges efficiently. Our tool transforms grids into SAT problems using Kripke Structures and Boolean formulas, ensuring step-by-step validity while avoiding collisions. Simplify navigation in dynamic environments with central and dynamic agents.

Language: Python - Size: 54.6 MB - Last synced: 2 days ago - Pushed: 3 days ago - Stars: 0 - Forks: 0

raghavsood1996/Dubins-Path

Language: C++ - Size: 54.7 KB - Last synced: 5 days ago - Pushed: almost 4 years ago - Stars: 0 - Forks: 0

naturerobots/mesh_navigation

Mesh Navigation Stack

Language: C++ - Size: 13.3 MB - Last synced: 3 days ago - Pushed: 25 days ago - Stars: 452 - Forks: 59

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: 10 days ago - Pushed: over 1 year ago - Stars: 103 - Forks: 26

afnastya/Sipp

Pathplanning in dynamic environments. C++ realization of Sipp and Anytime Sipp algorithms and its visualization.

Language: Jupyter Notebook - Size: 1.02 GB - Last synced: 20 days ago - Pushed: over 1 year ago - Stars: 0 - Forks: 0

Krythz43/A-Star-Search-Path-Planning-Implementation

This repository contains the implementation of A* search algorithm in C++ for three cases where the traversing object is a particle, has certain dimension but no direction sense and the third case with direction sense.

Language: C++ - Size: 75.2 KB - Last synced: 25 days ago - Pushed: about 6 years ago - Stars: 0 - Forks: 0

harisankar95/pathfinding3D

Python implementation of common pathfinding algorithms in 3D grid space

Language: Python - Size: 10.8 MB - Last synced: about 2 months ago - Pushed: about 2 months ago - Stars: 16 - Forks: 1

XinJingHao/okayplan_ros

Real-time global path planning algorithm for dynamic environments

Language: Python - Size: 116 KB - Last synced: 29 days ago - Pushed: 29 days ago - Stars: 6 - Forks: 0

PathPlanning/Continuous-CBS

Continuous CBS - a modification of conflict based search algorithm, that allows to perform actions (move, wait) of arbitrary duration. Timeline is not discretized, i.e. is continuous.

Language: C++ - Size: 27.1 MB - Last synced: about 2 months ago - Pushed: 3 months ago - Stars: 163 - Forks: 48

PathPlanning/AA-SIPP-m

Algorithm for prioritized multi-agent path finding (MAPF) in grid-worlds. Moves into arbitrary directions are allowed (each agent is allowed to follow any-angle path on the grid). Timeline is continuous, i.e. action durations are not explicitly discretized into timesteps. Different agents' size and moving speed are supported. Planning is carried out in (x, y, \theta) configuration space, i.e. agents' orientation are taken into account.

Language: C++ - Size: 74.8 MB - Last synced: about 2 months ago - Pushed: over 2 years ago - Stars: 89 - Forks: 37

k2shah/wadl

A python package for planning surveys over large areas using one or more UAV (Unpersoned Aerial Vehicle).

Language: Python - Size: 85.6 MB - Last synced: 18 days ago - Pushed: 7 months ago - Stars: 22 - Forks: 8

skanmera/FunnelAlgorithm

Demonstration project of funnel algorithm in 3D with unity.

Language: C# - Size: 4.37 MB - Last synced: 3 months ago - Pushed: over 6 years ago - Stars: 24 - Forks: 4

Rishikesh-Jadhav/Enhanced-Path-Planning-through-Comparative-Analysis-of-RRT-and-Its-Variants-on-TurtleBot-in-Gazebo

Developed Autonomous Robot Planning with RRT, RRT*, RRT*smart, and RRTconnect Algorithms, validated on 2D maps as well as 3D simulation of Turtlebot3 in Gazebo within a Custom Maze Environment.

Language: Python - Size: 45.9 KB - Last synced: 4 months ago - Pushed: 4 months ago - Stars: 1 - Forks: 0

Boyang--Li/Motion-Planning-Course

Motion Planning for Mobile Robots Course

Language: C++ - Size: 119 MB - Last synced: 5 months ago - Pushed: about 4 years ago - Stars: 164 - Forks: 86

Sollimann/Dstar-lite-pathplanner

Implementation of the D* lite algorithm in Python for "Improved Fast Replanning for Robot Navigation in Unknown Terrain"

Language: Python - Size: 1.9 MB - Last synced: 6 months ago - Pushed: 6 months ago - Stars: 109 - Forks: 28

Sollimann/CleanIt

Open-source Autonomy Software in Rust-lang using gRPC for the Roomba series robot vacuum cleaners. Under development.

Language: Rust - Size: 7.06 MB - Last synced: 6 months ago - Pushed: 6 months ago - Stars: 246 - Forks: 15

fazildgr8/ros_autonomous_slam

ROS package which uses the Navigation Stack to autonomously explore an unknown environment with help of GMAPPING and constructs a map of the explored environment. Finally, a path planning algorithm from the Navigation stack is used in the newly generated map to reach the goal. The Gazebo simulator is used for the simulation of the Turtlebot3 Waffle Pi robot. Various algorithms have been integrated for Autonomously exploring the region and constructing the map with help of the 360-degree Lidar sensor. Different environments can be swapped within launch files to generate a map of the environment.

Language: Python - Size: 24 MB - Last synced: 6 months ago - Pushed: almost 2 years ago - Stars: 159 - Forks: 68

MortezaHagh/PathPlanning-Py

Single robot path planning algorithms implemented in Python. Including heuristic search and incremental heuristic search methods. A*, PEA*, EPEA*, LPA*, D*Lite

Language: Python - Size: 3.62 MB - Last synced: 6 months ago - Pushed: 6 months ago - Stars: 0 - Forks: 0

vss2sn/path_planning

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

Language: C++ - Size: 6.69 MB - Last synced: 6 months ago - Pushed: over 1 year ago - Stars: 321 - Forks: 88

anilharish/RobotExpert_Tecnomatix

Arc Welding Simulation, Collision Detection, Path Planning, and New Cell from CAD files - 6 Axis Robots (ABB, KUKA, YASKAWA)

Language: Eiffel - Size: 78.7 MB - Last synced: 7 months ago - Pushed: about 5 years ago - Stars: 10 - Forks: 3

naderAsadi/Optimal-Path-Planning-Deep-Reinforcement-Learning

Optimal Path Planning with Deep Reinforcement Learning

Language: Python - Size: 26.4 KB - Last synced: 7 months ago - Pushed: over 3 years ago - Stars: 44 - Forks: 8

ahmedadamji/PathPlanning

C++ Implementation of Path Planning Algorithms based on the Python Implementation by Huiming Zhou (https://github.com/zhm-real)

Language: C++ - Size: 6.14 MB - Last synced: 7 months ago - Pushed: 7 months ago - Stars: 3 - Forks: 2

SimoneTinella/Path-Planning-Robot-over-Voronoi-Diagram

Robot Path Planning Algorithm- Generalized Voronoi Diagram

Language: C++ - Size: 51.8 KB - Last synced: 6 months ago - Pushed: about 5 years ago - Stars: 30 - Forks: 10

RajPShinde/Path_Tracer_for_TB2

Waypoint tracer for Turtlebot 2

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

RajPShinde/Autonomous_Wheelchair

ROS Package for an Autonomous Wheelchair capable of navigating in an indoor environments.

Language: C++ - Size: 39.6 MB - Last synced: 8 months ago - Pushed: about 2 years ago - Stars: 6 - Forks: 2

gubbriaco/industrial-and-mobile-robotics

Robotics Project (Industrial Robotics and Mobile Robotics).

Language: MATLAB - Size: 62.2 MB - Last synced: 9 months ago - Pushed: 9 months ago - Stars: 0 - Forks: 0

Skwarson96/d_star_lite

Implementation of d-star-lite and a-star algorithms

Language: Python - Size: 42.7 MB - Last synced: 9 months ago - Pushed: 11 months ago - Stars: 0 - Forks: 0

RTPWDSDM/MGPFD

MGPFD: a dataset for multi-goal path finding (MGPF) problerm. S&reg: End-to-end learningbased model for multi-goal path planning problem

Size: 1000 MB - Last synced: 9 months ago - Pushed: 9 months ago - Stars: 0 - Forks: 0

RTPWDSDM/Path-Planning-Dataset

a dataset for training region prediction model in path planning field

Size: 402 MB - Last synced: 9 months ago - Pushed: 9 months ago - Stars: 0 - Forks: 0

abdalla1912mohamed/Deep_reinforcement_learning_Bachelor_project

Deep Reinforcement Learning navigation of autonomous vehicles. Implementation of deep-Q learning, dyna-Q learning, Q-learning agents including SSMR(Skid-steering_mobile robot) Kinematics in various OpenAi gym environments

Language: Python - Size: 8.58 MB - Last synced: 8 months ago - Pushed: over 1 year ago - Stars: 5 - Forks: 1

MortezaHagh/PathPlanning-MATLAB

Single robot path planning algorithms implemented in MATLAB. Including heuristic search and incremental heuristic search methods.

Language: MATLAB - Size: 1.14 MB - Last synced: 10 months ago - Pushed: 10 months ago - Stars: 1 - Forks: 0

zehuilu/astar-algorithm-cpp Fork of justinhj/astar-algorithm-cpp

Efficient implementations of the A Star algorithm in C++, and a Python wrapper.

Language: C++ - Size: 136 KB - Last synced: 10 months ago - Pushed: over 2 years ago - Stars: 2 - Forks: 1

zehuilu/Lazy-Theta-with-optimization-any-angle-pathfinding Fork of lapinozz/Lazy-Theta-with-optimization-any-angle-pathfinding

Efficient implementations of the Lazy Theta Star algorithm in C++, and a Python wrapper.

Language: C++ - Size: 119 KB - Last synced: 10 months ago - Pushed: 12 months ago - Stars: 4 - Forks: 5

PathPlanning/ASearchVisualizer

Program for visualization of detailed logs of path planning algorithms

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

hwixley/SDP-DrPhil

DR.PHIL (Disinfecting Robot Prioritising High Interaction Locations) is an autonomous robot which can navigate a single floor, and disinfect door handles. This product was awarded 3rd place and the Robotical prize (out of 24 teams).

Language: Python - Size: 237 MB - Last synced: 9 days ago - Pushed: about 3 years ago - Stars: 0 - Forks: 1

DGIST-ARTIV/Control-Planning

자율'주행'의 "주행"을 책임지다.

Language: C++ - Size: 48.6 MB - Last synced: 9 months ago - Pushed: almost 3 years ago - Stars: 20 - Forks: 10

jnlt3/Raven

A competitive 1v1 specialist for robocode

Language: Java - Size: 77.1 KB - Last synced: 12 months ago - Pushed: over 2 years ago - Stars: 1 - Forks: 0

grzesiek2201/RRT-STAR-FND-Algorithm

Simulation of RRT, RRT*, RRT*-FN and RRT*-FND algorithms.

Language: Python - Size: 776 KB - Last synced: 12 months ago - Pushed: 12 months ago - Stars: 3 - Forks: 1

aswinbkk/mobile_robot_pathplanning

The Firebird v robot being used as a slave robot for pick and place tasks, along with traversing a detected path, and a PC with a camera serving as the master, handling arena image acquisition, image processing, obstacle detection, object detection, path planning, and commanding the slave robot.

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

BorisVandermeer/DeepBlueCourses-PathingPlanning-Homework

深蓝学院 - 高飞 - 运动规划课程作业

Language: Makefile - Size: 5.59 MB - Last synced: 10 months ago - Pushed: about 2 years ago - Stars: 17 - Forks: 2

JLGGaming/APCSA-Final

Mecanum drive robot with PathPlanner integration. Java WPILib

Language: Java - Size: 288 KB - Last synced: 10 months ago - Pushed: 12 months ago - Stars: 0 - Forks: 0

PathPlanning/LPLian

Lifelong Planning version of LIAN algorithm

Language: Jupyter Notebook - Size: 583 KB - Last synced: about 2 months ago - Pushed: over 5 years ago - Stars: 3 - Forks: 1

chaddy1004/PathPlanning

Implementation of PRM and RRT

Language: Python - Size: 183 KB - Last synced: 12 months ago - Pushed: about 4 years ago - Stars: 5 - Forks: 1

diamantis-rafail-papadam/Path_Finding_AI

This is an assignment I completed as an undergraduate student in a team of 2 members.

Size: 421 KB - Last synced: 8 months ago - Pushed: about 1 year ago - Stars: 0 - Forks: 0

MortezaHagh/Astar-Path-Planning-MATLAB

Astar single robot path planning algorithm in MATLAB. For grid-based 2D environments.

Language: MATLAB - Size: 536 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 3 - Forks: 0

SeunghyunLim/Astar-with-smoothed-path

Astar algorithm with smoothed path using Fast marching method

Language: Python - Size: 2.59 MB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 13 - Forks: 2

YashTrikannad/f110_rrt_star

RRT Star path planning for dynamic obstacle avoidance for the F110 Autonomous Car

Language: C++ - Size: 4.14 MB - Last synced: about 1 year ago - Pushed: over 4 years ago - Stars: 42 - Forks: 12

MortezaHagh/DStarLiteOptimised-Path-Planning-MATLAB

DStarLite single robot path planning algorithm in MATLAB. An incremental search algorithm. For grid-based 2D environments.

Language: MATLAB - Size: 12.7 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 2 - Forks: 0

ugurkanates/NeurIRS2019DroneChallengeRL

Long-Term Planning with Deep Reinforcement Learning on Autonomous Drones

Language: Python - Size: 7.3 MB - Last synced: about 1 year ago - Pushed: almost 4 years ago - Stars: 26 - Forks: 9

BlackMagicAI/AStar

Java and Python implementations of the A* (A Star) path planning algorithm. Includes example test driver command line program.

Language: Java - Size: 184 KB - Last synced: about 1 year ago - Pushed: over 1 year ago - Stars: 2 - Forks: 3

fotisk07/RoboticsSpecialization-UPenn

Projects from the Robotics specialization from Coursera offered by the University of Pennsylvania

Language: Matlab - Size: 28.1 MB - Last synced: about 1 year ago - Pushed: almost 6 years ago - Stars: 12 - Forks: 7

MortezaHagh/LPAstar-Path-Planning-MATLAB

LPAstar single robot path planning algorithm in MATLAB. An Incremental search algorithm. For grid-based 2D environments.

Language: MATLAB - Size: 70.3 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 2 - Forks: 0

MortezaHagh/DStarLite-Path-Planning-MATLAB

DStarLite single robot path planning algorithm in MATLAB. An incremental search algorithm. For grid-based 2D environments.

Language: MATLAB - Size: 75.2 KB - Last synced: about 1 year ago - Pushed: almost 2 years ago - Stars: 2 - Forks: 0

prat1kbhujbal/astar_ros_pathplanning

Implementation of AStar path planning algorithm in simulation.

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

Ayushman-Choudhuri/Udacity-Robotics-Software-Engineer-Nanodegree

Robot Localization , SLAM , Path Planning and Navigation algoithms implemented using the ROS framework

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

deepak-1530/Drone_SuspendedPayload_Navigation

Obstacle avoidance for drone with cable suspended payload using RGBD Camera, Octomap and PX4 Firmware

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

marios-stam/thesis_ws

A ROS based platform that includes 2 or more drones carrying flecible objects (ropes) and flying through narrow places and obstacles

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

daysun/oc_ndt

2.5D-NDT map: version 1.0

Language: C++ - Size: 28 MB - Last synced: 4 months ago - Pushed: over 6 years ago - Stars: 2 - Forks: 3

SeunghyunLim/Walkable-area-extraction

Simple code using cv2 to extract the walkable area (or reachable random goal point) for robot

Language: Python - Size: 2.4 MB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 1 - Forks: 0

kaushik4444/Mobile-Robotics-Control-and-Simulation

The 5 basic principles of Robotics namely, Kinematics, Locomotion, Perception, Localization, and both planning and navigation have been used to operate various mobile robots in multiple Simulation Environments.

Language: MATLAB - Size: 93.9 MB - Last synced: about 1 year ago - Pushed: almost 3 years ago - Stars: 1 - Forks: 2

gowrijsuria/RRT-PathPlanning

Implementation of the RRT algorithm for Holonomic and Non-Holonomic Robot

Language: Jupyter Notebook - Size: 1.7 MB - Last synced: about 1 year ago - Pushed: about 3 years ago - Stars: 0 - Forks: 0

greesh02/Following-20

Following'20 is an annual flagship event(inter college competition), exclusively for 1st years conducted by the RMI(Robotics and Machine Intelligence) club of NIT-Trichy. this took place during August 2020.

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

birongit/RRT-demo

Rapidly Exploring Random Trees -- Interactive Demo

Language: JavaScript - Size: 6.84 KB - Last synced: about 1 year ago - Pushed: over 3 years ago - Stars: 0 - Forks: 0

0aqz0/path-planning-with-qlearning

path-planning using qlearning

Language: QML - Size: 18.5 MB - Last synced: about 1 year ago - Pushed: almost 5 years ago - Stars: 0 - Forks: 0

ISG-UAH/up2ta

Unified Path Planning & Task Planning Architecture (UP2TA)

Language: C - Size: 2.39 MB - Last synced: about 1 year ago - Pushed: about 5 years ago - Stars: 1 - Forks: 0

dtbinh/PSO_PathPlaningNew Fork of zegangYang/PSO_PathPlaningNew

This open source project is a matlab GUI project,is a Robot Path Planing Demo use Particle Swarm Optimization(PSO) algorithm

Language: MATLAB - Size: 30.3 KB - Last synced: about 1 year ago - Pushed: over 5 years ago - Stars: 0 - Forks: 0

kim366/Pathplanning

Various Pathplanning Algorithms Derived off Dijkstra's in mulitple situations visualized by SFML. Paper: https://schmider.kim/vwa/main.pdf

Language: C++ - Size: 253 KB - Last synced: about 1 year ago - Pushed: about 6 years ago - Stars: 1 - Forks: 2

YuYuCong/Multiobjective-Path-Planning

This is a solution to TSP(Traveling Salesman Problem)

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

Ahtesham519/AIND-Planning Fork of udacity/AIND-Planning

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

sjhansen3/influence_aware_planning

influence aware motion planning experiments - path planning for a robot that understands the influences it has on humans

Language: Python - Size: 971 KB - Last synced: 25 days ago - Pushed: over 6 years ago - Stars: 0 - Forks: 1