Traceback function that creates a smooth gradient from the start to the goal. More...
#include <gradient_path.h>
Public Member Functions | |
nav_2d_msgs::Path2D | getPath (const dlux_global_planner::PotentialGrid &potential_grid, const geometry_msgs::Pose2D &start, const geometry_msgs::Pose2D &goal, double &path_cost) override |
void | initialize (ros::NodeHandle &private_nh, dlux_global_planner::CostInterpreter::Ptr cost_interpreter) override |
Public Member Functions inherited from dlux_global_planner::Traceback | |
Traceback () | |
virtual | ~Traceback ()=default |
Protected Member Functions | |
void | calculateGradient (const dlux_global_planner::PotentialGrid &potential_grid, const nav_grid::Index &index) |
nav_grid::Index | gridStep (const dlux_global_planner::PotentialGrid &potential_grid, const nav_grid::Index &index) |
bool | shouldGridStep (const dlux_global_planner::PotentialGrid &potential_grid, const nav_grid::Index &index) |
Protected Member Functions inherited from dlux_global_planner::Traceback | |
nav_2d_msgs::Path2D | mapPathToWorldPath (const nav_2d_msgs::Path2D &original, const nav_grid::NavGridInfo &info) |
Protected Attributes | |
nav_grid::VectorNavGrid< double > | gradx_ |
nav_grid::VectorNavGrid< double > | grady_ |
bool | grid_step_near_high_ |
double | iteration_factor_ |
double | lethal_cost_ |
double | step_size_ |
Protected Attributes inherited from dlux_global_planner::Traceback | |
CostInterpreter::Ptr | cost_interpreter_ |
Traceback function that creates a smooth gradient from the start to the goal.
Definition at line 47 of file gradient_path.h.
|
inlineprotected |
Definition at line 361 of file gradient_path.cpp.
|
overridevirtual |
Implements dlux_global_planner::Traceback.
Definition at line 63 of file gradient_path.cpp.
|
protected |
Definition at line 255 of file gradient_path.cpp.
|
overridevirtual |
Reimplemented from dlux_global_planner::Traceback.
Definition at line 48 of file gradient_path.cpp.
|
protected |
Definition at line 235 of file gradient_path.cpp.
|
protected |
Definition at line 64 of file gradient_path.h.
|
protected |
Definition at line 64 of file gradient_path.h.
|
protected |
Definition at line 63 of file gradient_path.h.
|
protected |
Definition at line 62 of file gradient_path.h.
|
protected |
Definition at line 61 of file gradient_path.h.
|
protected |
Definition at line 60 of file gradient_path.h.