Public Member Functions | |
| void | addTFMarker () | 
| void | bagTF (const string &bag_name, const string &topic_name) | 
| InteractiveTF (const std::string &parent_frame, const std::string &child_frame, double rate=100) | |
| void | processTFControl (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback) | 
| void | publishTF (const ros::TimerEvent &event) | 
Private Attributes | |
| std::string | child_frame_ | 
| geometry_msgs::TransformStamped | cur_tf_msg | 
| interactive_markers::InteractiveMarkerServer | im_server_ | 
| geometry_msgs::Pose | marker_pose_ | 
| std::string | parent_frame_ | 
| double | rate_ | 
| tf::TransformBroadcaster | tf_broad_ | 
| ros::Timer | tf_timer_ | 
Definition at line 9 of file interactive_tf.cpp.
| InteractiveTF::InteractiveTF | ( | const std::string & | parent_frame, | 
| const std::string & | child_frame, | ||
| double | rate = 100  | 
        ||
| ) | 
Definition at line 27 of file interactive_tf.cpp.
| void InteractiveTF::addTFMarker | ( | ) | 
Definition at line 37 of file interactive_tf.cpp.
| void InteractiveTF::bagTF | ( | const string & | bag_name, | 
| const string & | topic_name | ||
| ) | 
Definition at line 107 of file interactive_tf.cpp.
| void InteractiveTF::processTFControl | ( | const visualization_msgs::InteractiveMarkerFeedbackConstPtr & | feedback | ) | 
Definition at line 75 of file interactive_tf.cpp.
| void InteractiveTF::publishTF | ( | const ros::TimerEvent & | event | ) | 
Definition at line 90 of file interactive_tf.cpp.
std::string InteractiveTF::child_frame_ [private] | 
        
Definition at line 14 of file interactive_tf.cpp.
geometry_msgs::TransformStamped InteractiveTF::cur_tf_msg [private] | 
        
Definition at line 18 of file interactive_tf.cpp.
Definition at line 12 of file interactive_tf.cpp.
Definition at line 17 of file interactive_tf.cpp.
std::string InteractiveTF::parent_frame_ [private] | 
        
Definition at line 14 of file interactive_tf.cpp.
double InteractiveTF::rate_ [private] | 
        
Definition at line 15 of file interactive_tf.cpp.
Definition at line 13 of file interactive_tf.cpp.
ros::Timer InteractiveTF::tf_timer_ [private] | 
        
Definition at line 16 of file interactive_tf.cpp.