8 #ifndef sophus_ros_conversions_GEOMETRY_HPP_ 9 #define sophus_ros_conversions_GEOMETRY_HPP_ 15 #include <geometry_msgs/Pose.h> 16 #include <geometry_msgs/Transform.h> 17 #include <geometry_msgs/Vector3.h> 18 #include <sophus/se3.hpp> 50 void vector3MsgToSophus(
const geometry_msgs::Vector3 &v, Sophus::SE3f::Point &translation);
68 Eigen::Quaternion<T> q;
69 Eigen::Matrix<T,3,1> t;
78 se3 = Sophus::SE3Group<T>(q,t);
geometry_msgs::Transform sophusToTransformMsg(const Sophus::SE3f &se3)
TFSIMD_FORCE_INLINE const tfScalar & getY() const
TFSIMD_FORCE_INLINE const tfScalar & getW() const
TFSIMD_FORCE_INLINE const tfScalar & getZ() const
void transformMsgToSophus(const geometry_msgs::Transform &transform, Sophus::SE3f &se3)
geometry_msgs::Pose sophusToPoseMsg(const Sophus::SE3f &s)
void stampedTransformToSophus(const tf::StampedTransform &transform, Sophus::SE3Group< T > &se3)
void poseMsgToSophus(const geometry_msgs::Pose &p, Sophus::SE3f &s)
TFSIMD_FORCE_INLINE const tfScalar & getX() const
void vector3MsgToSophus(const geometry_msgs::Vector3 &v, Sophus::SE3f::Point &translation)