00001 #include <ros/ros.h> 00002 #include <tf/tf.h> 00003 #include <tf/transform_listener.h> 00004 00005 ros::ServiceClient dynamic_tf_publisher_client; 00006 00007 void CallSetDynamicTf(std::string parent_frame_id, std::string frame_id, geometry_msgs::Transform transform); 00008 00009 void transformCallback(const geometry_msgs::TransformStamped::ConstPtr& msg); 00010 00011