Traceback function that moves from cell to cell using only the four neighbors. More...
#include <von_neumann_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 |
Public Member Functions inherited from dlux_global_planner::Traceback | |
virtual void | initialize (ros::NodeHandle &private_nh, CostInterpreter::Ptr cost_interpreter) |
Traceback () | |
virtual | ~Traceback ()=default |
Additional Inherited Members | |
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 inherited from dlux_global_planner::Traceback | |
CostInterpreter::Ptr | cost_interpreter_ |
Traceback function that moves from cell to cell using only the four neighbors.
Definition at line 46 of file von_neumann_path.h.
|
overridevirtual |
Implements dlux_global_planner::Traceback.
Definition at line 45 of file von_neumann_path.cpp.