fake_pose_estimation_nodelet.h
Go to the documentation of this file.
1 #include <nodelet/nodelet.h>
2 #include <ros/ros.h>
3 #include <nav_msgs/Odometry.h>
4 
6 {
7 public:
8  virtual void onInit();
9 
10 private:
15 
16  void odomCallback(const nav_msgs::OdometryConstPtr& odom);
17 };
void odomCallback(const nav_msgs::OdometryConstPtr &odom)


tuw_multi_robot_ctrl
Author(s): Benjamin Binder
autogenerated on Mon Jun 10 2019 15:42:29