#include <asr_halcon_bridge/halcon_pointcloud.h>
#include <boost/make_shared.hpp>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/PointField.h>
Go to the source code of this file.
Namespaces | |
namespace | halcon_bridge |
Functions | |
int | halcon_bridge::getSizeFromDatatype (int datatype) |
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. | |
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. |