dummy_slam_broadcaster.h
Go to the documentation of this file.
1 #ifndef DUMMY_SLAM_BROADCASTER_H
2 #define DUMMY_SLAM_BROADCASTER_H
3 #include <ros/ros.h>
4 #include <nav_msgs/OccupancyGrid.h>
6 
10 {
11 public:
13  void broadcastMap( const ros::TimerEvent& e );
14  void broadcastPose( const ros::TimerEvent& e );
15 
16 private:
17  void initMap();
18 
20 
26 
27  nav_msgs::OccupancyGrid empty_map_;
28 
30 };
31 
32 #endif // DUMMY_SLAM_BROADCASTER_H
void broadcastPose(const ros::TimerEvent &e)
tf::TransformBroadcaster tf_pose_broadcaster_
nav_msgs::OccupancyGrid empty_map_
void broadcastMap(const ros::TimerEvent &e)


dummy_slam_broadcaster
Author(s):
autogenerated on Mon Jun 10 2019 14:12:46