#include <moveto.hpp>
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 () | |
Private Attributes | |
qi::AnyObject | p_motion_ |
ros::Subscriber | sub_moveto_ |
boost::shared_ptr < tf2_ros::Buffer > | tf2_buffer_ |
Definition at line 39 of file moveto.hpp.
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.
Definition at line 43 of file moveto.hpp.
void naoqi::subscriber::MovetoSubscriber::callback | ( | const geometry_msgs::PoseStampedConstPtr & | pose_msg | ) |
Definition at line 49 of file moveto.cpp.
Definition at line 43 of file moveto.cpp.
qi::AnyObject naoqi::subscriber::MovetoSubscriber::p_motion_ [private] |
Definition at line 49 of file moveto.hpp.
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.