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 |
Traceback function that moves from cell to cell using only the four neighbors.
Definition at line 46 of file von_neumann_path.h.
nav_2d_msgs::Path2D dlux_plugins::VonNeumannPath::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 45 of file von_neumann_path.cpp.