Class ImagePerception
Defined in File ImagePerception.hpp
Inheritance Relationships
Base Type
public easynav::PerceptionBase(Class PerceptionBase)
Class Documentation
Represents a single image perception from a sensor.
Inherits from PerceptionBase and stores an OpenCV image (cv::Mat) along with metadata such as timestamp and frame_id.
Public Members
Image data received from the sensor.
The matrix layout follows OpenCV conventions. The encoding and channel depth depend on upstream conversion (typically via cv_bridge).
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/Image”).
- Returns:
true if
tequals “sensor_msgs/msg/Image”, otherwise false.
Public Static Attributes
Group identifier for image perceptions.