34 #ifndef MRPT_MAP_SERVER_NODE_H 35 #define MRPT_MAP_SERVER_NODE_H 38 #include "nav_msgs/MapMetaData.h" 39 #include "nav_msgs/GetMap.h" 40 #include "boost/smart_ptr.hpp" 42 #include <mrpt/version.h> 43 #if MRPT_VERSION >= 0x199 44 #include <mrpt/config/CConfigFile.h> 45 using namespace mrpt::config;
47 #include <mrpt/utils/CConfigFile.h> 51 #include <mrpt/maps/CMultiMetricMap.h> 52 using mrpt::maps::CMultiMetricMap;
66 unsigned long loop_count_{0};
75 nav_msgs::GetMap::Request& req, nav_msgs::GetMap::Response& res);
78 #endif // MRPT_MAP_SERVER_NODE_H
nav_msgs::GetMap::Response resp_ros_
boost::shared_ptr< CMultiMetricMap > metric_map_
ros::ServiceServer service_map_
ros::Publisher pub_map_ros_
ros::Publisher pub_metadata_