#include <mocap_config.h>
| Public Member Functions | |
| void | publish (RigidBody &) | 
| PublishedRigidBody (XmlRpc::XmlRpcValue &) | |
| Private Member Functions | |
| bool | validateParam (XmlRpc::XmlRpcValue &, const std::string &) | 
| Private Attributes | |
| std::string | frame_id | 
| ros::NodeHandle | n | 
| ros::Publisher | pose2d_pub | 
| std::string | pose2d_topic | 
| ros::Publisher | pose_pub | 
| std::string | pose_topic | 
| bool | publish_pose | 
| bool | publish_pose2d | 
| bool | publish_tf | 
| tf::TransformBroadcaster | tf_pub | 
Definition at line 54 of file mocap_config.h.
| PublishedRigidBody::PublishedRigidBody | ( | XmlRpc::XmlRpcValue & | config_node | ) | 
Definition at line 55 of file mocap_config.cpp.
| void PublishedRigidBody::publish | ( | RigidBody & | body | ) | 
Definition at line 81 of file mocap_config.cpp.
| bool PublishedRigidBody::validateParam | ( | XmlRpc::XmlRpcValue & | config_node, | 
| const std::string & | name | ||
| ) |  [private] | 
Definition at line 137 of file mocap_config.cpp.
| std::string PublishedRigidBody::frame_id  [private] | 
Definition at line 61 of file mocap_config.h.
| ros::NodeHandle PublishedRigidBody::n  [private] | 
Definition at line 57 of file mocap_config.h.
| ros::Publisher PublishedRigidBody::pose2d_pub  [private] | 
Definition at line 69 of file mocap_config.h.
| std::string PublishedRigidBody::pose2d_topic  [private] | 
Definition at line 60 of file mocap_config.h.
| ros::Publisher PublishedRigidBody::pose_pub  [private] | 
Definition at line 68 of file mocap_config.h.
| std::string PublishedRigidBody::pose_topic  [private] | 
Definition at line 59 of file mocap_config.h.
| bool PublishedRigidBody::publish_pose  [private] | 
Definition at line 63 of file mocap_config.h.
| bool PublishedRigidBody::publish_pose2d  [private] | 
Definition at line 65 of file mocap_config.h.
| bool PublishedRigidBody::publish_tf  [private] | 
Definition at line 64 of file mocap_config.h.
Definition at line 67 of file mocap_config.h.