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 };
ros::Publisher
ros.h
FakePoseEstimationNodelet
Definition: fake_pose_estimation_nodelet.h:5
FakePoseEstimationNodelet::nh_
ros::NodeHandle nh_
Definition: fake_pose_estimation_nodelet.h:11
FakePoseEstimationNodelet::onInit
virtual void onInit()
Definition: fake_pose_estimation_nodelet.cpp:7
FakePoseEstimationNodelet::n_param_
ros::NodeHandle n_param_
Definition: fake_pose_estimation_nodelet.h:12
FakePoseEstimationNodelet::odomCallback
void odomCallback(const nav_msgs::OdometryConstPtr &odom)
Definition: fake_pose_estimation_nodelet.cpp:17
nodelet::Nodelet
nodelet.h
FakePoseEstimationNodelet::pose_pub_
ros::Publisher pose_pub_
Definition: fake_pose_estimation_nodelet.h:13
FakePoseEstimationNodelet::odom_sub_
ros::Subscriber odom_sub_
Definition: fake_pose_estimation_nodelet.h:14
ros::NodeHandle
ros::Subscriber


tuw_multi_robot_ctrl
Author(s): Benjamin Binder
autogenerated on Wed Mar 2 2022 01:09:58