Public Member Functions | |
| objectPose (ros::NodeHandle &nh, std::string topic) | |
| objectPose (ros::NodeHandle &nh, std::string topic) | |
| void | poseCallback (const nav_msgs::OdometryConstPtr &pose) |
| void | poseCallback (const nav_msgs::OdometryConstPtr &pose) |
Public Attributes | |
| bool | got_pose_ |
| nav_msgs::Odometry | pose_ |
| ros::Subscriber | sub_ |
Definition at line 83 of file goto_plug.cpp.
| objectPose::objectPose | ( | ros::NodeHandle & | nh, |
| std::string | topic | ||
| ) | [inline] |
Definition at line 90 of file goto_plug.cpp.
| objectPose::objectPose | ( | ros::NodeHandle & | nh, |
| std::string | topic | ||
| ) | [inline] |
| void objectPose::poseCallback | ( | const nav_msgs::OdometryConstPtr & | pose | ) | [inline] |
| void objectPose::poseCallback | ( | const nav_msgs::OdometryConstPtr & | pose | ) | [inline] |
Definition at line 95 of file goto_plug.cpp.
Definition at line 86 of file goto_plug.cpp.
| nav_msgs::Odometry objectPose::pose_ |
Definition at line 87 of file goto_plug.cpp.
Definition at line 88 of file goto_plug.cpp.