#include <graph_search.h>
Definition at line 153 of file graph_search.h.
virtual teb_local_planner::lrKeyPointGraph::~lrKeyPointGraph |
( |
| ) |
|
|
inlinevirtual |
void teb_local_planner::lrKeyPointGraph::createGraph |
( |
const PoseSE2 & |
start, |
|
|
const PoseSE2 & |
goal, |
|
|
double |
dist_to_obst, |
|
|
double |
obstacle_heading_threshold, |
|
|
const geometry_msgs::Twist * |
start_velocity |
|
) |
| |
|
virtual |
Create a graph containing points in the global frame that can be used to explore new possible paths between start and goal.
This version of the graph creation places a keypoint on the left and right side of each obstacle w.r.t to the goal heading.
All feasible paths between start and goal point are extracted using a Depth First Search afterwards.
This version works very well for small point obstacles. For more complex obstacles call the createProbRoadmapGraph() method that samples keypoints in a predefined area and hopefully finds all relevant alternative paths.
- See also
- createProbRoadmapGraph
- Parameters
-
start | Start pose from wich to start on (e.g. the current robot pose). |
goal | Goal pose to find paths to (e.g. the robot's goal). |
dist_to_obst | Allowed distance to obstacles: if not satisfying, the path will be rejected (note, this is not the distance used for optimization). |
obstacle_heading_threshold | Value of the normalized scalar product between obstacle heading and goal heading in order to take them (obstacles) into account [0,1] |
start_velocity | start velocity (optional) |
Implements teb_local_planner::GraphSearchInterface.
Definition at line 93 of file graph_search.cpp.
The documentation for this class was generated from the following files: