25 #include "nav_msgs/MapMetaData.h" 26 #include "nav_msgs/OccupancyGrid.h" 48 explicit MapServer(
const std::string& fname);
55 explicit MapServer(
const nav_msgs::OccupancyGrid& map);
87 nav_msgs::OccupancyGrid
map_;
Implements the STDR map server functionalities.
ros::Timer tfTimer
ROS tf broadcaster.
ros::NodeHandle n
< The ROS node handle
MapServer(const std::string &fname)
Constructor by filename.
The main namespace for STDR Server.
void publishTransform(const ros::TimerEvent &ev)
Publishes the map to map_static transform.
nav_msgs::MapMetaData meta_data_message_
ROS occupancy grid message.
void publishData()
Publishes the map data and metadata.
tf::TransformBroadcaster tfBroadcaster
ROS map metadata message.
nav_msgs::OccupancyGrid map_
ros::Publisher map_pub
ROS publisher for posting the map metadata.
ros::Publisher metadata_pub
ROS timer for tf posting.