conversions between ROS and ViSP structures representing a 3D pose More...
#include <cmath>
#include <visp/vpConfig.h>
#include <visp/vpRotationMatrix.h>
#include "visp_bridge/vpQuaternionVector.h"
#include <visp/vpTranslationVector.h>
#include "visp_bridge/3dpose.h"
Go to the source code of this file.
Namespaces | |
namespace | visp_bridge |
Functions | |
geometry_msgs::Transform | visp_bridge::toGeometryMsgsTransform (vpHomogeneousMatrix &mat) |
Converts a ViSP homogeneous matrix (vpHomogeneousMatrix) to a geometry_msgs::Transform. | |
vpHomogeneousMatrix | visp_bridge::toVispHomogeneousMatrix (const geometry_msgs::Transform &trans) |
Converts a geometry_msgs::Transform to a ViSP homogeneous matrix (vpHomogeneousMatrix). | |
vpHomogeneousMatrix | visp_bridge::toVispHomogeneousMatrix (const geometry_msgs::Pose &pose) |
Converts a geometry_msgs::Transform to a ViSP homogeneous matrix (vpHomogeneousMatrix). |
conversions between ROS and ViSP structures representing a 3D pose
Definition in file 3dpose.cpp.