#include <rocon_pose_client.h>
Public Member Functions | |
| std::string | getClientName () |
| geometry_msgs::PoseStamped | getPoseStamped () |
| bool | isInitialized () |
| void | processPose (const geometry_msgs::PoseStamped::ConstPtr msg) |
| RoconPoseClient () | |
| RoconPoseClient (ros::NodeHandle &nh, std::string client_name, std::string topic_name) | |
| ~RoconPoseClient () | |
Private Attributes | |
| std::string | client_name |
| bool | initialized |
| geometry_msgs::PoseStamped | pose_stamped |
| std::string | pose_topic |
| ros::Subscriber | sub |
Definition at line 43 of file rocon_pose_client.h.
Definition at line 5 of file rocon_pose_client.cpp.
| rocon::RoconPoseClient::RoconPoseClient | ( | ros::NodeHandle & | nh, |
| std::string | client_name, | ||
| std::string | topic_name | ||
| ) |
Definition at line 10 of file rocon_pose_client.cpp.
Definition at line 21 of file rocon_pose_client.cpp.
| std::string rocon::RoconPoseClient::getClientName | ( | ) |
Definition at line 38 of file rocon_pose_client.cpp.
| geometry_msgs::PoseStamped rocon::RoconPoseClient::getPoseStamped | ( | ) |
Definition at line 33 of file rocon_pose_client.cpp.
Definition at line 43 of file rocon_pose_client.cpp.
| void rocon::RoconPoseClient::processPose | ( | const geometry_msgs::PoseStamped::ConstPtr | msg | ) |
Definition at line 27 of file rocon_pose_client.cpp.
std::string rocon::RoconPoseClient::client_name [private] |
Definition at line 56 of file rocon_pose_client.h.
bool rocon::RoconPoseClient::initialized [private] |
Definition at line 59 of file rocon_pose_client.h.
geometry_msgs::PoseStamped rocon::RoconPoseClient::pose_stamped [private] |
Definition at line 61 of file rocon_pose_client.h.
std::string rocon::RoconPoseClient::pose_topic [private] |
Definition at line 57 of file rocon_pose_client.h.
ros::Subscriber rocon::RoconPoseClient::sub [private] |
Definition at line 58 of file rocon_pose_client.h.