All Projects → teddyluo → Hybrid A Star Annotation

teddyluo / Hybrid A Star Annotation

Licence: bsd-3-clause
Hybrid A*路径规划器的代码注释

Projects that are alternatives of or similar to Hybrid A Star Annotation

Ompl
The Open Motion Planning Library (OMPL)
Stars: ✭ 598 (+218.09%)
Mutual labels:  motion-planning
Path planning
This repository contains path planning algorithms in C++ for a grid based search.
Stars: ✭ 70 (-62.77%)
Mutual labels:  motion-planning
Pick Place Robot
Object picking and stowing with a 6-DOF KUKA Robot using ROS
Stars: ✭ 126 (-32.98%)
Mutual labels:  motion-planning
Fast Planner
A Robust and Efficient Trajectory Planner for Quadrotors
Stars: ✭ 718 (+281.91%)
Mutual labels:  motion-planning
Awesome Decision Making Reinforcement Learning
A selection of state-of-the-art research materials on decision making and motion planning.
Stars: ✭ 68 (-63.83%)
Mutual labels:  motion-planning
Owl
motion planning algorithms with demos for various state-spaces
Stars: ✭ 84 (-55.32%)
Mutual labels:  motion-planning
Unity Robotics Hub
Central repository for tools, tutorials, resources, and documentation for robotics simulation in Unity.
Stars: ✭ 439 (+133.51%)
Mutual labels:  motion-planning
Gpmp2
Gaussian Process Motion Planner 2
Stars: ✭ 161 (-14.36%)
Mutual labels:  motion-planning
Awesome Robotics Libraries
😎 A curated list of robotics libraries and software
Stars: ✭ 1,159 (+516.49%)
Mutual labels:  motion-planning
Cleanit
Open-source Autonomy Software in Rust-lang with gRPC for the Roomba series robot vacuum cleaners. Under development.
Stars: ✭ 125 (-33.51%)
Mutual labels:  motion-planning
Awesome Human Pose Estimation
Human Pose Estimation Related Publication
Stars: ✭ 828 (+340.43%)
Mutual labels:  motion-planning
Topotraj
A robust UAV local planner based on the ICRA2020 paper: Robust Real-time UAV Replanning Using Guided Gradient-based Optimization and Topological Paths
Stars: ✭ 50 (-73.4%)
Mutual labels:  motion-planning
Pybullet Planning
PyBullet Planning
Stars: ✭ 89 (-52.66%)
Mutual labels:  motion-planning
Robotics Toolbox Matlab
Robotics Toolbox for MATLAB
Stars: ✭ 601 (+219.68%)
Mutual labels:  motion-planning
Aikido
Artificial Intelligence for Kinematics, Dynamics, and Optimization
Stars: ✭ 133 (-29.26%)
Mutual labels:  motion-planning
Phd Bibliography
References on Optimal Control, Reinforcement Learning and Motion Planning
Stars: ✭ 523 (+178.19%)
Mutual labels:  motion-planning
Omplapp
The Open Motion Planning Library (OMPL), GUI + FCL/Assimp integration
Stars: ✭ 83 (-55.85%)
Mutual labels:  motion-planning
Xpp
Visualization of Motions for Legged Robots in ros-rviz
Stars: ✭ 177 (-5.85%)
Mutual labels:  motion-planning
Am traj
Alternating Minimization Based Trajectory Generation for Quadrotor Aggressive Flight
Stars: ✭ 142 (-24.47%)
Mutual labels:  motion-planning
Rvo2 3d
Optimal Reciprocal Collision Avoidance in Three Dimensions (C++)
Stars: ✭ 108 (-42.55%)
Mutual labels:  motion-planning

Hybrid A* ROS源码中文注释

本仓库是Hybrid A* 的ROS版代码注释,原始代码地址为: https://github.com/karlkurzer/path_planner

整体注释依据的主要参考文献有:

  • DOLGOV D, THRUN S, MONTEMERLO M, et al. Practical search techniques in path planning for autonomous driving[J]. Ann Arbor, 2008, 1001(48105):18-80.
  • KURZERK. Path Planning in Unstructured Environments: A Real-time Hybrid A* Implementation for Fast and Deterministic Path Generation for the KTH Research Concept Vehicle[Z].2016.
  • OK K, ANSARI S, GALLAGHER B, et al. Path planning with uncertainty: Voronoi uncertainty fields[C]//2013 IEEE International Conference on Robotics and Automation. 2013:4596-4601.
  • DOLGOV D, THRUN S. Autonomous driving in semi-structured environments: Mapping and planning[C]//2009 IEEE International Conference on Robotics and Automation. 2009:3407-3414.
  • DOLGOVD, THRUNS, MONTEMERLOM, et al. Path planning for autonomous vehiclesin unknown semi-structured environments[J]. The International Journal of Robotics Research, 2010, 29(5):485-501.
  • 齐尧, 徐友春, 李华等. 一种基于改进混合 A* 的智能车路径规划算法[J]. 军事交通学院学报, 2018(2018 年 08):85-90.

Dubins路径生成参考文献(源码来源):

  • Shkel A M, Lumelsky V. Classification of the Dubins set[J]. Robotics and Autonomous Systems, 2001, 34(4): 179-202.
  • Giese A. A Comprehensive, Step-by-Step Tutorial on Computing Dubins’s Curves[J]. 2014.
  • Eriksson-Bique S, Kirkpatrick D, Polishchuk V. Discrete dubins paths[J]. arXiv preprint arXiv:1211.2365, 2012.

Reeds-Shepp曲线参考文献:

  • Reeds J, Shepp L. Optimal paths for a car that goes both forwards and backwards[J]. Pacific journal of mathematics, 1990, 145(2): 367-393.

附加代码

  • 注释主要分布在includesrc文件夹的文件内
  • 若有错误请在Issues里提出,会尽快更正

:关于运动规划与控制,翻译了一篇综述文献,由于刚入门,错误在所难免,请各位扔个砖头。

翻译的文献为: Paden B, Čáp M, Yong S Z, et al. A survey of motion planning and control techniques for self-driving urban vehicles[J]. IEEE Transactions on intelligent vehicles, 2016, 1(1): 33-55.

翻译项目主页

https://github.com/teddyluo/motion-planning-chs


以下为原始Hybrid A Star算法的README内容

Hybrid A* Path Planner for the KTH Research Concept Vehicle Build Status

The code in this repository is the result of my master's thesis which I have written at the Integrated Research Lab (ITRL) at KTH Royal Institute of Technology (2016). The code is documented here and the associated thesis can be found here.

The goal of the thesis and hence this code is to create a real-time path planning algorithm for the nonholonomic Research Concept Vehicle (RCV). The algorithm uses a binary obstacle map as an input, generated using LIDAR mounted on top of the vehicle. The algorithm is being developed using C++ due to real-time requirements in combination with ROS to ensure modularity and portability as well as using RViz as a visualization/simulation environment.

Key Characteristics
  • Sampling in continuous space with 72 different headings per cell (5° discretization)
  • Constrained Heuristic - nonholonomic without obstacles
  • Unconstrained Heuristic - holonomic with obstacles
  • Dubin's Shot
  • C++ real-time implementation (~10 Hz)

Large parts of the implementation are closely related to the hybrid A* algorithm developed by Dmitri Dolgov and Sebastian Thrun (Path Planning for Autonomous Vehicles in Unknown Semi-structured Environments DOI: 10.1177/0278364909359210)

Videos
Images
Reversing in a Maze Parking Mitigating a U-shape Obstacle

Dependencies

Setup

Run the following command to clone, build, and launch the package (requires a sources ROS environment):

sudo apt install libompl-dev \
&& mkdir -p ~/catkin_ws/src \
&& cd ~/catkin_ws/src \
&& git clone https://github.com/karlkurzer/path_planner.git  \
&& cd .. \
&& catkin_make \
&& source devel/setup.bash \
&& rospack profile \
&& roslaunch hybrid_astar manual.launch

Visualization (Rviz)

  1. Add -> By Topic -> /map, /path, /pathVehicle, (/visualizeNode2DPoses)
  2. Click 2D Pose Estimate to set a start point on the map (p)
  3. Click 2D Nav Goal to set a goal point on the map (g)
  4. Wait for the path being searched! (this process can be visualized [optional])

Citation

In case you are using my code for your project, I would appreciate if you include a respective citation.

@mastersthesis{kurzer2016,
  author       = {Karl Kurzer}, 
  title        = {Path Planning in Unstructured Environments : A Real-time Hybrid A* Implementation for Fast and Deterministic Path Generation for the KTH Research Concept Vehicle},
  school       = {KTH Royal Institute of Technology},
  year         = 2016,
  month        = 12,
}
Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].