38 #include <geometry_msgs/TransformStamped.h> 53 void doTransform(
const T& data_in, T& data_out,
const geometry_msgs::TransformStamped& transform);
93 template<
typename A,
typename B>
102 template<
typename A,
typename B>
112 template <
class A,
class B>
130 #endif //TF2_CONVERT_H const std::string & getFrameId(const T &t)
Get the frame_id from data.
void doTransform(const T &data_in, T &data_out, const geometry_msgs::TransformStamped &transform)
The templated function expected to be able to do a transform.
ros::Time stamp_
The timestamp associated with this data.
void fromMsg(const A &, B &b)
std::string frame_id_
The frame_id associated this data.
const ros::Time & getTimestamp(const T &t)
Get the timestamp from data.
The data type which will be cross compatable with geometry_msgs This is the tf2 datatype equivilant o...
void convert(const A &a, B &b)