51 #include "geometry_msgs/Transform.h" 52 #include "geometry_msgs/Pose.h" 53 #include "visp/vpHomogeneousMatrix.h" 55 #ifndef _VISP_BRIDGE_3DPOSE_H_ 56 #define _VISP_BRIDGE_3DPOSE_H_ vpHomogeneousMatrix toVispHomogeneousMatrix(const geometry_msgs::Transform &trans)
Converts a geometry_msgs::Transform to a ViSP homogeneous matrix (vpHomogeneousMatrix).
geometry_msgs::Pose toGeometryMsgsPose(const vpHomogeneousMatrix &mat)
Converts a ViSP homogeneous matrix (vpHomogeneousMatrix) to a geometry_msgs::Pose.
geometry_msgs::Transform toGeometryMsgsTransform(const vpHomogeneousMatrix &mat)
Converts a ViSP homogeneous matrix (vpHomogeneousMatrix) to a geometry_msgs::Transform.