1 #ifndef GEOMETRY_MSG_TWIST_H 2 #define GEOMETRY_MSG_TWIST_H 4 #include <geometry_msgs/Twist.h> 5 #include <geometry_msgs/TwistStamped.h> 14 _data.emplace_back(
"/linear/x" );
15 _data.emplace_back(
"/linear/y" );
16 _data.emplace_back(
"/linear/z" );
17 _data.emplace_back(
"/angular/x" );
18 _data.emplace_back(
"/angular/y" );
19 _data.emplace_back(
"/angular/z" );
36 double timestamp)
override 38 geometry_msgs::Twist twist;
42 _data[0].pushBack( {timestamp, twist.linear.x} );
43 _data[1].pushBack( {timestamp, twist.linear.y} );
44 _data[2].pushBack( {timestamp, twist.linear.z} );
45 _data[3].pushBack( {timestamp, twist.angular.x} );
46 _data[4].pushBack( {timestamp, twist.angular.y} );
47 _data[5].pushBack( {timestamp, twist.angular.z} );
67 #endif // GEOMETRY_MSG_TWIST_H
std::vector< PlotData > _data
const std::unordered_set< std::string > & getCompatibleKeys() const override
void extractData(PlotDataMapRef &plot_map, const std::string &prefix) override
const uint8_t * data() const
virtual void pushMessageRef(const std::string &, const MessageRef &msg, double timestamp) override
RosMessageStampedParser< geometry_msgs::TwistStamped, geometry_msgs::Twist, GeometryMsgTwist > GeometryMsgTwistStamped
static const char * value()
static const std::string & getCompatibleKey()
static void appendData(PlotDataMapRef &destination_plot_map, const std::string &field_name, PlotData &in_data)
void deserialize(Stream &stream, T &t)