#include <sensor_msgs/PointCloud2.h>
#include <HalconCpp.h>
#include <stdexcept>
Go to the source code of this file.
Classes | |
class | halcon_bridge::HalconPointcloud |
PointCloud message class that is interoperable with sensor_msgs/PointCloud2 but uses a HObjectModel3D representation for the point cloud data. More... | |
Namespaces | |
namespace | halcon_bridge |
Typedefs | |
typedef boost::shared_ptr < HalconPointcloud > | halcon_bridge::HalconPointcloudPtr |
Functions | |
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. |