Class IMUPerception
Defined in File IMUPerception.hpp
Inheritance Relationships
Base Type
public easynav::PerceptionBase(Class PerceptionBase)
Class Documentation
Represents a single IMU perception from a sensor.
Inherits from PerceptionBase and stores a sensor_msgs::msg::Imu message.
Public Members
IMU data received from the sensor.
Public Static Functions
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
tequals “sensor_msgs/msg/Imu”, otherwise false.
Public Static Attributes
Group identifier for IMU perceptions.