$search
The data type which will be cross compatable with geometry_msgs This is the tf datatype equivilant of a MessageStamped. More...
#include <transform_datatypes.h>
Public Member Functions | |
void | setData (const T &input) |
Stamped (const T &input, const ros::Time ×tamp, const std::string &frame_id) | |
Stamped () | |
Public Attributes | |
std::string | frame_id_ |
The frame_id associated this data. | |
ros::Time | stamp_ |
The timestamp associated with this data. |
The data type which will be cross compatable with geometry_msgs This is the tf datatype equivilant of a MessageStamped.
Definition at line 64 of file transform_datatypes.h.
tf::Stamped< T >::Stamped | ( | ) | [inline] |
Default constructor
Definition at line 70 of file transform_datatypes.h.
tf::Stamped< T >::Stamped | ( | const T & | input, | |
const ros::Time & | timestamp, | |||
const std::string & | frame_id | |||
) | [inline] |
Full constructor
Definition at line 73 of file transform_datatypes.h.
void tf::Stamped< T >::setData | ( | const T & | input | ) | [inline] |
Set the data element
Definition at line 77 of file transform_datatypes.h.
std::string tf::Stamped< T >::frame_id_ |
The frame_id associated this data.
Definition at line 67 of file transform_datatypes.h.
ros::Time tf::Stamped< T >::stamp_ |
The timestamp associated with this data.
Definition at line 66 of file transform_datatypes.h.