Specialized Template Function tf2::getCovarianceMatrix(const geometry_msgs::msg::PoseWithCovarianceStamped&)

Function Documentation

template<>
inline std::array<std::array<double, 6>, 6> tf2::getCovarianceMatrix(const geometry_msgs::msg::PoseWithCovarianceStamped &t)

Extract a covariance matrix from a PoseWithCovarianceStamped message. This function is a specialization of the getCovarianceMatrix template defined in tf2/convert.h.

Parameters:

t – PoseWithCovarianceStamped message to extract the covariance matrix from.

Returns:

A nested-array representation of the covariance matrix from the message.