Template Class WithCovarianceStamped

Inheritance Relationships

Base Type

  • public T

Class Documentation

template<typename T>
class WithCovarianceStamped : public T

The data type which will be cross compatable with geometry_msgs This is the tf2 datatype equivalent of a MessageWithCovarianceStamped.

Public Functions

inline WithCovarianceStamped()

Default constructor

inline WithCovarianceStamped(const T &input, const TimePoint &timestamp, const std::string &frame_id, const std::array<std::array<double, 6>, 6> &covariance_matrix)

Full constructor

inline WithCovarianceStamped(const WithCovarianceStamped<T> &w)

Copy constructor

inline void setData(const T &input)

Set the data element

inline WithCovarianceStamped &operator=(const WithCovarianceStamped<T> &w)

Public Members

TimePoint stamp_

The timestamp associated with this data.

std::string frame_id_

The frame_id associated this data.

std::array<std::array<double, 6>, 6> cov_mat_

The covariance matrix associated with this data // NOLINT.