#include <post_planning_interface.hpp>
Public Types | |
using | Map = costmap_2d::Costmap2DROS |
using | Path = std::vector< Pose > |
using | Pose = geometry_msgs::PoseStamped |
Public Member Functions | |
virtual void | initialize (const std::string &_name, Map *_map)=0 |
virtual bool | postProcess (const Pose &_start, const Pose &_goal, Path &_path, double &_cost)=0 |
virtual | ~PostPlanningInterface ()=default |
Post-Planning class will be run after the global planner
Use this class to alter the output of your planner. You can implement
Definition at line 44 of file post_planning_interface.hpp.
Definition at line 48 of file post_planning_interface.hpp.
using gpp_interface::PostPlanningInterface::Path = std::vector<Pose> |
Definition at line 47 of file post_planning_interface.hpp.
using gpp_interface::PostPlanningInterface::Pose = geometry_msgs::PoseStamped |
Definition at line 46 of file post_planning_interface.hpp.
|
virtualdefault |
|
pure virtual |
_name | Name of the resource |
_map | Map on which the planning problem will be preformed |
|
pure virtual |
[in] | _start | start pose for the planning |
[in] | _goal | goal pose for the planning |
[out] | _path | path as output from a global planner |
[out] | _cost | cost as output from a global planner |