Class PointPerception
Defined in File PointPerception.hpp
Inheritance Relationships
Base Type
public easynav::PerceptionBase(Class PerceptionBase)
Class Documentation
Concrete perception class for 3D point cloud data.
Stores a point cloud of type
pcl::PointCloud<pcl::PointXYZ>and the common metadata inherited from PerceptionBase.Public Functions
Resizes the internal point cloud storage.
- Parameters:
size – Number of points to allocate in data.
Public Members
The 3D point cloud data associated with this perception.
Public Static Functions
Checks if a ROS message type is supported by this perception.
- Parameters:
t – Fully-qualified ROS 2 message type name (e.g.,
"sensor_msgs/msg/PointCloud2").- Returns:
trueiftissensor_msgs/msg/LaserScanorsensor_msgs/msg/PointCloud2, otherwisefalse.
Public Static Attributes
Group identifier for point perceptions.