41 #ifndef MBF_COSTMAP_NAV__COSTMAP_WRAPPER_H_    42 #define MBF_COSTMAP_NAV__COSTMAP_WRAPPER_H_    84   void reconfigure(
double shutdown_costmap, 
double shutdown_costmap_delay);
 
bool clear_on_shutdown_
clear the costmap, when shutting down 
bool shutdown_costmap_
don't update costmap when not using it 
void reconfigure(double shutdown_costmap, double shutdown_costmap_delay)
Reconfiguration method called by dynamic reconfigure. 
void clear()
Clear costmap. 
void checkActivate()
Check whether the costmap should be activated. 
ros::Duration shutdown_costmap_delay_
costmap delayed shutdown delay 
boost::mutex check_costmap_mutex_
Start/stop costmap mutex; concurrent calls to start can lead to segfault. 
void deactivate(const ros::TimerEvent &event)
Timer-triggered deactivation of the costmap. 
void checkDeactivate()
Check whether the costmap should and could be deactivated. 
The CostmapWrapper class manages access to a costmap by locking/unlocking its mutex and handles (de)a...
ros::Timer shutdown_costmap_timer_
costmap delayed shutdown timer 
virtual ~CostmapWrapper()
Destructor. 
int16_t costmap_users_
keep track of plugins using costmap 
boost::shared_ptr< CostmapWrapper > Ptr
CostmapWrapper(const std::string &name, const TFPtr &tf_listener_ptr)
Constructor. 
ros::NodeHandle private_nh_
Private node handle.