83 map_.info.origin.position.x,
84 map_.info.origin.position.y,
ros::Timer tfTimer
ROS tf broadcaster.
void publish(const boost::shared_ptr< M > &message) const
ros::NodeHandle n
< The ROS node handle
MapServer(const std::string &fname)
Constructor by filename.
static double getYaw(const Quaternion &bt_q)
The main namespace for STDR Server.
void publishTransform(const ros::TimerEvent &ev)
Publishes the map to map_static transform.
nav_msgs::OccupancyGrid loadMap(const std::string &fname)
Loads a map from an image file.
void setRPY(const tfScalar &roll, const tfScalar &pitch, const tfScalar &yaw)
nav_msgs::MapMetaData meta_data_message_
ROS occupancy grid message.
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
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.