32 #ifndef TF_TRANSFORMLISTENER_H 33 #define TF_TRANSFORMLISTENER_H 35 #include "sensor_msgs/PointCloud.h" 36 #include "std_msgs/Empty.h" 37 #include "tf/tfMessage.h" 42 #include "tf/FrameGraph.h" 43 #include "boost/thread.hpp" 59 std::string return_val;
95 void transformQuaternion(
const std::string& target_frame,
const geometry_msgs::QuaternionStamped& stamped_in, geometry_msgs::QuaternionStamped& stamped_out)
const;
98 void transformVector(
const std::string& target_frame,
const geometry_msgs::Vector3Stamped& stamped_in, geometry_msgs::Vector3Stamped& stamped_out)
const;
101 void transformPoint(
const std::string& target_frame,
const geometry_msgs::PointStamped& stamped_in, geometry_msgs::PointStamped& stamped_out)
const;
104 void transformPose(
const std::string& target_frame,
const geometry_msgs::PoseStamped& stamped_in, geometry_msgs::PoseStamped& stamped_out)
const;
114 const geometry_msgs::QuaternionStamped& qin,
115 const std::string& fixed_frame, geometry_msgs::QuaternionStamped& qout)
const;
119 const geometry_msgs::Vector3Stamped& vin,
120 const std::string& fixed_frame, geometry_msgs::Vector3Stamped& vout)
const;
124 const geometry_msgs::PointStamped& pin,
125 const std::string& fixed_frame, geometry_msgs::PointStamped& pout)
const;
129 const geometry_msgs::PoseStamped& pin,
130 const std::string& fixed_frame, geometry_msgs::PoseStamped& pout)
const;
135 void transformPointCloud(
const std::string& target_frame,
const sensor_msgs::PointCloud& pcin, sensor_msgs::PointCloud& pcout)
const;
140 const sensor_msgs::PointCloud& pcin,
141 const std::string& fixed_frame, sensor_msgs::PointCloud& pcout)
const;
147 bool getFrames(tf::FrameGraph::Request&, tf::FrameGraph::Response& res)
154 std::string
resolve(
const std::string& frame_name)
173 void transformPointCloud(
const std::string & target_frame,
const Transform& transform,
const ros::Time& target_time,
const sensor_msgs::PointCloud& pcin, sensor_msgs::PointCloud& pcout)
const;
178 #endif //TF_TRANSFORMLISTENER_H
bool param(const std::string ¶m_name, T ¶m_val, const T &default_val)
std::string remap(const std::string &frame_id) __attribute__((deprecated))
resolve names
std::string getPrefixParam(ros::NodeHandle &nh)
Get the tf_prefix from the parameter server.
std::string resolve(const std::string &prefix, const std::string &frame_name)
resolve tf names
bool searchParam(const std::string &key, std::string &result) const
bool getParam(const std::string &key, std::string &s) const
tf::tfVector4 __attribute__