Public Member Functions | |
| JointTfPublisherNode () | |
Private Member Functions | |
| void | cbJoint (const sensor_msgs::JointState::ConstPtr &msg) |
Private Attributes | |
| ros::NodeHandle | nh_ |
| ros::NodeHandle | pnh_ |
| std::map< std::string, ros::Subscriber > | subs_ |
| tf::TransformBroadcaster | tf_broadcaster_ |
Definition at line 45 of file joint_tf_publisher.cpp.
| JointTfPublisherNode::JointTfPublisherNode | ( | ) | [inline] |
Definition at line 67 of file joint_tf_publisher.cpp.
| void JointTfPublisherNode::cbJoint | ( | const sensor_msgs::JointState::ConstPtr & | msg | ) | [inline, private] |
Definition at line 53 of file joint_tf_publisher.cpp.
ros::NodeHandle JointTfPublisherNode::nh_ [private] |
Definition at line 48 of file joint_tf_publisher.cpp.
ros::NodeHandle JointTfPublisherNode::pnh_ [private] |
Definition at line 49 of file joint_tf_publisher.cpp.
std::map<std::string, ros::Subscriber> JointTfPublisherNode::subs_ [private] |
Definition at line 50 of file joint_tf_publisher.cpp.
Definition at line 51 of file joint_tf_publisher.cpp.