Easy Navigation
Loading...
Searching...
No Matches
IMUPerception Class Reference

Represents a single IMU perception from a sensor. More...

#include <IMUPerception.hpp>

Inheritance diagram for IMUPerception:
Collaboration diagram for IMUPerception:

Static Public Member Functions

static bool supports_msg_type (std::string_view t)
 Returns whether the given ROS 2 type name is supported by this perception.
 

Public Attributes

sensor_msgs::msg::Imu data
 IMU data received from the sensor.
 
- Public Attributes inherited from PerceptionBase
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 Public Attributes

static constexpr std::string_view default_group_ = "imu"
 Group identifier for IMU perceptions.
 

Additional Inherited Members

- Public Member Functions inherited from PerceptionBase
virtual ~PerceptionBase ()=default
 

Detailed Description

Represents a single IMU perception from a sensor.

Inherits from PerceptionBase and stores a sensor_msgs::msg::Imu message.

Member Function Documentation

◆ 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
tFully qualified message type name (e.g., "sensor_msgs/msg/Imu").
Returns
true if t equals "sensor_msgs/msg/Imu", otherwise false.

Member Data Documentation

◆ 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: