Class PointCloudConverter

Inheritance Relationships

Base Type

Class Documentation

class PointCloudConverter : public depthai_bridge::BaseConverter

Public Functions

explicit PointCloudConverter(std::string frameName, bool getBaseDeviceTimestamp = false)
~PointCloudConverter()
void setDepthUnit(dai::StereoDepthConfig::AlgorithmControl::DepthUnit depthUnit)

Set the Depth Unit object. By default mode is set to milimeters.

Parameters:

depthUnit

double getScaleFactor() const
void toRosMsg(std::shared_ptr<dai::PointCloudData> inPcl, std::deque<sensor_msgs::msg::PointCloud2> &pclMsgs)