File point_cloud.hpp
↰ Parent directory (include/beluga_ros)
Implementation of sensor_msgs/PointCloud2 wrapper type for messages with memory-aligned strides.
Definition (include/beluga_ros/point_cloud.hpp)
Detailed Description
The stride calculation ensures that the memory layout of the point cloud data is aligned with the size of the data type used for iteration (iteratorType). To maintain proper memory alignment, the stride must satisfy the condition:
cloud_->point_step % sizeof(iteratorType) == 0
This condition guarantees that point_step is a multiple of the size of the iteratorType, ensuring efficient access to each point in the cloud.
Includes
Eigen/Densebeluga/eigen_compatibility.hppbeluga/sensor/data/point_cloud.hppbeluga/views/take_evenly.hppbeluga_ros/messages.hpp(File messages.hpp)range/v3/view/iota.hppsensor_msgs/msg/point_cloud2.hppsensor_msgs/point_cloud2_iterator.hppsensor_msgs/point_field_conversion.hppsophus/se3.hpp