11 #include <grid_map_msgs/GridMap.h> 18 : nodeHandle_(nodeHandle)
50 grid_map_msgs::GridMap message;
void publish(const boost::shared_ptr< M > &message) const
std::string filePath_
Path the ROS bag to be published.
grid_map::GridMap map_
Grid map data.
static void toMessage(const grid_map::GridMap &gridMap, grid_map_msgs::GridMap &message)
std::string publishTopic_
Topic name of the grid map to be loaded.
ros::Duration duration_
Duration to publish the grid map.
Duration & fromSec(double t)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
std::string bagTopic_
Topic name of the grid map in the ROS bag.
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
ros::NodeHandle nodeHandle_
ROS nodehandle.
ROSCPP_DECL void requestShutdown()
#define ROS_INFO_STREAM(args)
ros::Publisher publisher_
Grid map publisher.