32 geometry_msgs::PoseStamped pose;
33 pose.pose.position.x = 0;
34 pose.pose.position.y = 0;
35 pose.pose.position.z = 0;
37 pose.pose.orientation.w = 0;
38 pose.pose.orientation.x = 0;
39 pose.pose.orientation.y = 0;
40 pose.pose.orientation.z = 0;
42 pose.header.frame_id =
"/map";
51 const std::size_t mapSize = 2500;
69 int main(
int argc,
char **argv)
71 ros::init(argc, argv,
"dummy_slam_broadcaster");
void publish(const boost::shared_ptr< M > &message) const
int broadcast_zero_pose_enabled_
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ros::Timer pub_pose_timer_
ROSCPP_DECL void spin(Spinner &spinner)
ros::Publisher map_publisher_
int main(int argc, char **argv)
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val) const
ros::NodeHandle node_handle_
Timer createTimer(Rate r, Handler h, Obj o, bool oneshot=false, bool autostart=true) const
ros::Timer pub_map_timer_
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void broadcastPose(const ros::TimerEvent &e)
tf::TransformBroadcaster tf_pose_broadcaster_
ros::Publisher pose_publisher_
nav_msgs::OccupancyGrid empty_map_
void broadcastMap(const ros::TimerEvent &e)