#include <sensor_msgs/PointCloud2.h>
#include <halconcpp/HalconCpp.h>
#include <stdexcept>
Go to the source code of this file.
|
HalconPointcloudPtr | halcon_bridge::toHalconCopy (const sensor_msgs::PointCloud2ConstPtr &source) |
| Convert a sensor_msgs::PointCloud2 message to a Halcon-compatible HObjectModel3D, copying the point cloud data. More...
|
|
HalconPointcloudPtr | halcon_bridge::toHalconCopy (const sensor_msgs::PointCloud2 &source) |
| Convert a sensor_msgs::PointCloud2 message to a Halcon-compatible HObjectModel3D, copying the point cloud data. More...
|
|