Public Member Functions | List of all members
dlux_plugins::VonNeumannPath Class Reference

Traceback function that moves from cell to cell using only the four neighbors. More...

#include <von_neumann_path.h>

Inheritance diagram for dlux_plugins::VonNeumannPath:
Inheritance graph
[legend]

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_
 

Detailed Description

Traceback function that moves from cell to cell using only the four neighbors.

Definition at line 46 of file von_neumann_path.h.

Member Function Documentation

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 
)
overridevirtual

Implements dlux_global_planner::Traceback.

Definition at line 45 of file von_neumann_path.cpp.


The documentation for this class was generated from the following files:


dlux_plugins
Author(s):
autogenerated on Sun Jan 10 2021 04:08:54