#include <imu_msg.h>

Public Member Functions | |
| ImuMsgParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| ImuMsgParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| void | parseMessageImpl (const sensor_msgs::msg::Imu &msg, double ×tamp) override |
| void | parseMessageImpl (const sensor_msgs::Imu &msg, double ×tamp) override |
Public Member Functions inherited from BuiltinMessageParser< sensor_msgs::msg::Imu > | |
| BuiltinMessageParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| BuiltinMessageParser (const std::string &topic_name, PlotDataMapRef &plot_data) | |
| bool | parseMessage (MessageRef serialized_msg, double ×tamp) override |
| virtual bool | parseMessage (MessageRef serialized_msg, double ×tamp) |
Public Member Functions inherited from Ros2MessageParser | |
| Ros2MessageParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| const rosidl_message_type_support_t * | typeSupport () const |
Public Member Functions inherited from PJ::RosMessageParser | |
| const RosParserConfig & | getConfig () const |
| PJ::PlotData & | getSeries (const std::string &key) |
| PJ::StringSeries & | getStringSeries (const std::string &key) |
| RosMessageParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| void | setConfig (const RosParserConfig &config) |
Public Member Functions inherited from PJ::MessageParser | |
| bool | clampLargeArray () const |
| unsigned | maxArraySize () const |
| MessageParser (const std::string &topic_name, PlotDataMapRef &plot_data) | |
| virtual bool | parseMessage (const MessageRef serialized_msg, double ×tamp)=0 |
| virtual void | setLargeArraysPolicy (bool clamp, unsigned max_size) |
| virtual | ~MessageParser ()=default |
Public Member Functions inherited from BuiltinMessageParser< sensor_msgs::Imu > | |
| BuiltinMessageParser (const std::string &topic_name, PJ::PlotDataMapRef &plot_data) | |
| BuiltinMessageParser (const std::string &topic_name, PlotDataMapRef &plot_data) | |
| bool | parseMessage (MessageRef serialized_msg, double ×tamp) override |
| virtual bool | parseMessage (MessageRef serialized_msg, double ×tamp) |
Private Attributes | |
| CovarianceParser< 3 > | _ang_vel_covariance |
| std::vector< PJ::PlotData * > | _data |
| HeaderMsgParser | _header_parser |
| bool | _initialized = false |
| std::function< void()> | _lazy_init |
| CovarianceParser< 3 > | _lin_acc_covariance |
| CovarianceParser< 3 > | _orientation_covariance |
| QuaternionMsgParser | _quat_parser |
Additional Inherited Members | |
Protected Member Functions inherited from PJ::MessageParser | |
| PlotData & | getSeries (const std::string &key) |
| StringSeries & | getStringSeries (const std::string &key) |
Protected Attributes inherited from Ros2MessageParser | |
| const rosidl_message_type_support_t * | _type_support = nullptr |
Protected Attributes inherited from PJ::RosMessageParser | |
| RosParserConfig | _config |
Protected Attributes inherited from PJ::MessageParser | |
| PlotDataMapRef & | _plot_data |
| std::string | _topic_name |
Definition at line 10 of file ros1_parsers/imu_msg.h.
|
inline |
Definition at line 13 of file ros1_parsers/imu_msg.h.
|
inline |
Definition at line 13 of file ros2_parsers/imu_msg.h.
|
inlineoverridevirtual |
Implements BuiltinMessageParser< sensor_msgs::msg::Imu >.
Definition at line 23 of file ros2_parsers/imu_msg.h.
|
inlineoverridevirtual |
Implements BuiltinMessageParser< sensor_msgs::Imu >.
Definition at line 33 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 62 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 63 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 58 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 66 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 65 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 61 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 60 of file ros1_parsers/imu_msg.h.
|
private |
Definition at line 59 of file ros1_parsers/imu_msg.h.