Public Member Functions | Private Attributes | List of all members
naoqi::subscriber::MovetoSubscriber Class Reference

#include <moveto.hpp>

Inheritance diagram for naoqi::subscriber::MovetoSubscriber:
Inheritance graph
[legend]

Public Member Functions

void callback (const geometry_msgs::PoseStampedConstPtr &pose_msg)
 
 MovetoSubscriber (const std::string &name, const std::string &topic, const qi::SessionPtr &session, const boost::shared_ptr< tf2_ros::Buffer > &tf2_buffer)
 
void reset (ros::NodeHandle &nh)
 
 ~MovetoSubscriber ()
 
- Public Member Functions inherited from naoqi::subscriber::BaseSubscriber< MovetoSubscriber >
 BaseSubscriber (const std::string &name, const std::string &topic, qi::SessionPtr session)
 
bool isInitialized () const
 
std::string name () const
 
std::string topic () const
 
virtual ~BaseSubscriber ()
 

Private Attributes

qi::AnyObject p_motion_
 
ros::Subscriber sub_moveto_
 
boost::shared_ptr< tf2_ros::Buffertf2_buffer_
 

Additional Inherited Members

- Protected Attributes inherited from naoqi::subscriber::BaseSubscriber< MovetoSubscriber >
bool is_initialized_
 
std::string name_
 
const robot::Robotrobot_
 
qi::SessionPtr session_
 
std::string topic_
 

Detailed Description

Definition at line 39 of file moveto.hpp.

Constructor & Destructor Documentation

naoqi::subscriber::MovetoSubscriber::MovetoSubscriber ( const std::string &  name,
const std::string &  topic,
const qi::SessionPtr &  session,
const boost::shared_ptr< tf2_ros::Buffer > &  tf2_buffer 
)

Definition at line 36 of file moveto.cpp.

naoqi::subscriber::MovetoSubscriber::~MovetoSubscriber ( )
inline

Definition at line 43 of file moveto.hpp.

Member Function Documentation

void naoqi::subscriber::MovetoSubscriber::callback ( const geometry_msgs::PoseStampedConstPtr &  pose_msg)

Definition at line 49 of file moveto.cpp.

void naoqi::subscriber::MovetoSubscriber::reset ( ros::NodeHandle nh)

Definition at line 43 of file moveto.cpp.

Member Data Documentation

qi::AnyObject naoqi::subscriber::MovetoSubscriber::p_motion_
private

Definition at line 49 of file moveto.hpp.

ros::Subscriber naoqi::subscriber::MovetoSubscriber::sub_moveto_
private

Definition at line 50 of file moveto.hpp.

boost::shared_ptr<tf2_ros::Buffer> naoqi::subscriber::MovetoSubscriber::tf2_buffer_
private

Definition at line 51 of file moveto.hpp.


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


naoqi_driver
Author(s): Karsten Knese
autogenerated on Sat Feb 15 2020 03:24:26