geometry_msgs/TwistWithCovarianceStamped Message

File: geometry_msgs/TwistWithCovarianceStamped.msg

# This represents an estimate twist with reference coordinate frame and timestamp.
Header header
TwistWithCovariance twist

Expanded Definition

Header header
    uint32 seq
    time stamp
    string frame_id
TwistWithCovariance twist
    geometry_msgs/Twist twist
        geometry_msgs/Vector3 linear
            float64 x
            float64 y
            float64 z
        geometry_msgs/Vector3 angular
            float64 x
            float64 y
            float64 z
    float64[36] covariance