Class ECEFPose

Class Documentation

class ECEFPose

Earth Centered Earth Fixed (ECEF) pose.

Public Functions

inline ECEFPose()

Null constructor. Makes an invalid pose object.

inline explicit ECEFPose(const geographic_msgs::msg::GeoPose &pose)

Create from a WGS 84 geodetic pose.

inline ECEFPose(const ECEFPoint &pt, const geometry_msgs::msg::Quaternion &q)
inline ECEFPose(const geographic_msgs::msg::GeoPoint &pt, const geometry_msgs::msg::Quaternion &q)

Create from a WGS 84 geodetic point and a quaternion.

Public Members

ECEFPoint position

Position in ECEF coordinates.

geometry_msgs::msg::Quaternion orientation

Orientation as a quaternion.