Traceback function that moves from cell to cell using any of the eight neighbors. More...
#include <grid_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 |
Traceback function that moves from cell to cell using any of the eight neighbors.
Definition at line 46 of file grid_path.h.
nav_2d_msgs::Path2D dlux_plugins::GridPath::getPath | ( | const dlux_global_planner::PotentialGrid & | potential_grid, |
const geometry_msgs::Pose2D & | start, | ||
const geometry_msgs::Pose2D & | goal, | ||
double & | path_cost | ||
) | [override] |
Definition at line 46 of file grid_path.cpp.