Class IMUPerception

Inheritance Relationships

Base Type

Class Documentation

class IMUPerception : public easynav::PerceptionBase

Represents a single IMU perception from a sensor.

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

Public Members

sensor_msgs::msg::Imu data

IMU data received from the sensor.

Public Static Functions

static inline bool supports_msg_type(std::string_view t)

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.

Public Static Attributes

static constexpr std::string_view default_group_ = "imu"

Group identifier for IMU perceptions.