Represents a single IMU perception from a sensor.
More...
#include <IMUPerception.hpp>
|
| static bool | supports_msg_type (std::string_view t) |
| | Returns whether the given ROS 2 type name is supported by this perception.
|
| |
|
| sensor_msgs::msg::Imu | data |
| | IMU data received from the sensor.
|
| |
| std::string | frame_id |
| | Coordinate frame associated with the perception.
|
| |
| bool | new_data = false |
| | Whether the data has changed since the last observation.
|
| |
| rclcpp::Time | stamp |
| | Timestamp of the perception (ROS time).
|
| |
| bool | valid = false |
| | Whether the perception contains valid data.
|
| |
|
| static constexpr std::string_view | default_group_ = "imu" |
| | Group identifier for IMU perceptions.
|
| |
Represents a single IMU perception from a sensor.
Inherits from PerceptionBase and stores a sensor_msgs::msg::Imu message.
◆ supports_msg_type()
| static bool supports_msg_type |
( |
std::string_view | t | ) |
|
|
static |
Returns whether the given ROS 2 type name is supported by this perception.
- Parameters
-
| t | Fully qualified message type name (e.g., "sensor_msgs/msg/Imu"). |
- Returns
- true if
t equals "sensor_msgs/msg/Imu", otherwise false.
◆ data
| sensor_msgs::msg::Imu data |
IMU data received from the sensor.
◆ default_group_
| std::string_view default_group_ = "imu" |
|
staticconstexpr |
Group identifier for IMU perceptions.
The documentation for this class was generated from the following file: