Public Member Functions | Private Member Functions | Private Attributes | List of all members
FakePoseEstimationNodelet Class Reference

#include <fake_pose_estimation_nodelet.h>

Inheritance diagram for FakePoseEstimationNodelet:
Inheritance graph
[legend]

Public Member Functions

virtual void onInit ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Private Member Functions

void odomCallback (const nav_msgs::OdometryConstPtr &odom)
 

Private Attributes

ros::NodeHandle n_param_
 
ros::NodeHandle nh_
 
ros::Subscriber odom_sub_
 
ros::Publisher pose_pub_
 

Additional Inherited Members

- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 5 of file fake_pose_estimation_nodelet.h.

Member Function Documentation

void FakePoseEstimationNodelet::odomCallback ( const nav_msgs::OdometryConstPtr &  odom)
private

Definition at line 17 of file fake_pose_estimation_nodelet.cpp.

void FakePoseEstimationNodelet::onInit ( )
virtual

Implements nodelet::Nodelet.

Definition at line 7 of file fake_pose_estimation_nodelet.cpp.

Member Data Documentation

ros::NodeHandle FakePoseEstimationNodelet::n_param_
private

Definition at line 12 of file fake_pose_estimation_nodelet.h.

ros::NodeHandle FakePoseEstimationNodelet::nh_
private

Definition at line 11 of file fake_pose_estimation_nodelet.h.

ros::Subscriber FakePoseEstimationNodelet::odom_sub_
private

Definition at line 14 of file fake_pose_estimation_nodelet.h.

ros::Publisher FakePoseEstimationNodelet::pose_pub_
private

Definition at line 13 of file fake_pose_estimation_nodelet.h.


The documentation for this class was generated from the following files:


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