36 #include <nav_msgs/OccupancyGrid.h> void newDataCallback(const nav_core2::UIntBounds &bounds)
void onSubscribe(const std::string &topic) override
Actual subscription logic, called by subscribe.
ros::NodeHandle update_nh_
nav_grid::VectorNavGrid< unsigned char > panel_data_
Several reusable pieces for displaying polygons.
void init(ros::NodeHandle &nh, NewDataCallback callback, const std::string &topic="map", bool nav_grid=true, bool subscribe_to_updates=true)
void onUnsubscribe() override
Actual unsubscription logic, called by unsubscribe.
void mapUpdated(const nav_core2::UIntBounds &updated_bounds)
Custom signal emitted when new map data is received.
Displays a nav_grid (of unspecified type) along the XY plane.
nav_grid_pub_sub::NavGridSubscriber sub_
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
Displays an OccupancyGrid along the XY plane.