GitHub 中文社区
回车: Github搜索    Shift+回车: Google搜索
论坛
排行榜
趋势
登录

©2025 GitHub中文社区论坛GitHub官网网站地图GitHub官方翻译

  • X iconGitHub on X
  • Facebook iconGitHub on Facebook
  • Linkedin iconGitHub on LinkedIn
  • YouTube iconGitHub on YouTube
  • Twitch iconGitHub on Twitch
  • TikTok iconGitHub on TikTok
  • GitHub markGitHub’s organization on GitHub
集合主题趋势排行榜
#

path-planning

Website
Wikipedia
AtsushiSakai/PythonRobotics
https://static.github-zh.com/github_avatars/AtsushiSakai?size=40
AtsushiSakai / PythonRobotics

#算法刷题#用于机器人算法的示例代码合集

PythonRobotics算法path-planningcontrol动画Localization (l10n)slamcvxpyekfautonomous-vehiclesautonomous-drivingmappingautonomous-navigationrobotHacktoberfest
Python 25.76 k
3 天前
https://static.github-zh.com/github_avatars/zhm-real?size=40
zhm-real / PathPlanning

Common used path planning algorithms with animations.

astaranytime-repairing-astarlearning-realtime-astarrealtime-adaptive-astarlifelong-planning-astardstardstar-liteanytime-dstarrrtrrt-starpath-planning
Python 8.78 k
3 年前
https://static.github-zh.com/github_avatars/atb033?size=40
atb033 / multi_agent_path_planning

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

multi-agent-systemspath-planning
Python 1.34 k
2 年前
https://static.github-zh.com/github_avatars/ai-winter?size=40
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, ...

a-stard-stardijkstramotion-planningrrtrrt-starvoronoimodel-predictive-controlautonomous-vehiclespath-planning
Python 834
5 个月前
https://static.github-zh.com/github_avatars/ShisatoYano?size=40
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.

算法autonomous-drivingautonomous-navigationautonomous-vehiclescalibrationLocalization (l10n)mappingobject-detectionobject-trackingpath-planningperceptionPythonslam
Python 751
4 个月前
https://static.github-zh.com/github_avatars/sichkar-valentyn?size=40
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

reinforcement-learningq-learningpath-planningreinforcement-learning-algorithmsMazessarsarl-environment
Python 477
3 年前
https://static.github-zh.com/github_avatars/zhaohaojie1998?size=40
zhaohaojie1998 / DRL-for-Path-Planning

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

gym-environmentpath-planningsacsoft-actor-criticlidar
Python 418
1 年前
https://static.github-zh.com/github_avatars/Pandas-Team?size=40
Pandas-Team / Automatic-Parking

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

self-driving-carautonomous-vehiclesautonomous-drivingPythonpath-planningcontrolmpc-controlmodel-predictive-control
Python 377
2 年前
https://static.github-zh.com/github_avatars/winstxnhdw?size=40
winstxnhdw / AutoCarROS2

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

ros2gazebopath-planningoccupancy-grid-mapbayesianraytracing
Python 335
3 年前
https://static.github-zh.com/github_avatars/zhaohaojie1998?size=40
zhaohaojie1998 / Path-Planning

路径规划算法,A*,A-star启发搜索,Hybrid-A*,混合A*算法,Dijkstra迪杰斯特拉算法,GBFS贪婪最佳优先搜索算法,DFS深度优先搜索,BFS广度优先搜索算法等,车辆路径规划算法,小黑子路径规划

a-starOpenCVpath-planningdijkstrabreadth-first-search
Python 334
2 年前
https://static.github-zh.com/github_avatars/Dungyichao?size=40
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 tha...

Google 地图reinforcement-learningbatterydouble-dqnroute-plannerpath-planningPythonpython36geocodeelevationdirections
Python 256
3 年前
https://static.github-zh.com/github_avatars/HaiderAbasi?size=40
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. :)

OpenCVPythonRoboticsrosastar-algorithmmappingnavigationpath-planning
Python 193
1 年前
https://static.github-zh.com/github_avatars/jhan15?size=40
jhan15 / dubins_path_planning

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

path-planningrrt
Python 167
3 年前
https://static.github-zh.com/github_avatars/enginBozkurt?size=40
enginBozkurt / MotionPlanner

Motion Planner for Self Driving Cars

motion-planningautonomous-drivingself-driving-carsbehavior-analysispath-planning
Python 165
6 年前
https://static.github-zh.com/github_avatars/ShuiXinYun?size=40
ShuiXinYun / Path_Plan

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

path-planningastar-algorithm
Python 163
6 年前
https://static.github-zh.com/github_avatars/jfrascon?size=40
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 m...

slam算法youtube-playlistpath-planningRoboticsmotion-planningkalman-filteringextended-kalman-filtersparticle-filter
Python 152
7 年前
https://static.github-zh.com/github_avatars/LyapunovJingci?size=40
LyapunovJingci / Warehouse_Robot_Path_Planning

A multi agent path planning solution under a warehouse scenario using Q learning and transfer learning.🤖️

path-planningreinforcement-learningq-learningtransfer-learningmultiagent
Python 144
5 年前
https://static.github-zh.com/github_avatars/iory?size=40
iory / scikit-robot

A Flexible Framework for Robot visualization and programming in Python

robotkinematicsros可视化Pythonrobot-controlmotion-planningpath-planninggeometrysigned-distance-functions
Python 133
6 天前
https://static.github-zh.com/github_avatars/RajPShinde?size=40
RajPShinde / Hybrid-A-Star

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

a-starmotion-planningpath-planningRobotics
Python 124
4 年前
https://static.github-zh.com/github_avatars/realkushagrakhare?size=40
realkushagrakhare / 3D_Path_Planning

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

人工智能artificial-intelligence-algorithmspath-planningconstraint-satisfaction-problemconstraintsFramer Motioncollision-detectionrrtrrt-star
Python 120
7 年前
loading...