Class will call updateMap on the passed map. More...
#include <gpp_update_map.hpp>
Public Member Functions | |
void | initialize (const std::string &_name, Map *_map) override |
bool | preProcess (Pose &_start, Pose &_goal) override |
![]() | |
virtual | ~PrePlanningInterface ()=default |
Private Attributes | |
Map * | map_ = nullptr |
Additional Inherited Members | |
![]() | |
typedef costmap_2d::Costmap2DROS | Map |
typedef geometry_msgs::PoseStamped | Pose |
Class will call updateMap on the passed map.
This allows the user to stop ticked-based re-rendering of the costmap. The plugin only fails, if the internal map_ is a nullptr. In all other cases, it succeeds.
See README.md for the inteface documentation.
Definition at line 43 of file gpp_update_map.hpp.
|
overridevirtual |
Implements gpp_interface::PrePlanningInterface.
Definition at line 53 of file gpp_update_map.cpp.
Implements gpp_interface::PrePlanningInterface.
Definition at line 40 of file gpp_update_map.cpp.
|
private |
Definition at line 51 of file gpp_update_map.hpp.