PointCloud message class that is interoperable with sensor_msgs/PointCloud2 but uses a HObjectModel3D representation for the point cloud data. More...
#include <halcon_pointcloud.h>
Public Member Functions | |
sensor_msgs::PointCloud2Ptr | toPointcloudMsg () const |
Convert this message to a ROS sensor_msgs::PointCloud2 message. | |
void | toPointcloudMsg (sensor_msgs::PointCloud2 &ros_pointcloud) const |
Copy the message data to a ROS sensor_msgs::PointCloud2 message. | |
~HalconPointcloud () | |
Public Attributes | |
HalconCpp::HTuple | curvature |
std_msgs::Header | header |
HalconCpp::HObjectModel3D * | model |
PointCloud message class that is interoperable with sensor_msgs/PointCloud2 but uses a HObjectModel3D representation for the point cloud data.
Definition at line 36 of file halcon_pointcloud.h.
Definition at line 39 of file halcon_pointcloud.cpp.
sensor_msgs::PointCloud2Ptr halcon_bridge::HalconPointcloud::toPointcloudMsg | ( | ) | const |
Convert this message to a ROS sensor_msgs::PointCloud2 message.
The returned sensor_msgs::PointCloud2 message contains a copy of the Halcon-ObjectModel data.
Definition at line 44 of file halcon_pointcloud.cpp.
void halcon_bridge::HalconPointcloud::toPointcloudMsg | ( | sensor_msgs::PointCloud2 & | ros_pointcloud | ) | const |
Copy the message data to a ROS sensor_msgs::PointCloud2 message.
Definition at line 50 of file halcon_pointcloud.cpp.
HalconCpp::HTuple halcon_bridge::HalconPointcloud::curvature |
Definition at line 39 of file halcon_pointcloud.h.
Definition at line 38 of file halcon_pointcloud.h.
HalconCpp::HObjectModel3D* halcon_bridge::HalconPointcloud::model |
Definition at line 40 of file halcon_pointcloud.h.