Class ADI3DToFImageStitching
Defined in File adi_3dtof_image_stitching.h
Inheritance Relationships
Base Type
public rclcpp::Node
Class Documentation
-
class ADI3DToFImageStitching : public rclcpp::Node
This is main class for this package.
Public Functions
-
inline ADI3DToFImageStitching()
Construct a new ADI3DToFImageStitching object.
-
inline ~ADI3DToFImageStitching()
Destroy the ADI3DToFImageStitching object.
-
void AutoscaleStitching()
-
bool stitchFrames()
-
void generatePointCloud(float *xyz_frame, int *lut_3d_to_2d_mapping, const pcl::PointCloud<pcl::PointXYZ>::Ptr &out_pointcloud)
-
void processOutputAbort()
-
void pushOutputNode(ADI3DToFImageStitchingOutputInfo *new_output_node)
-
void processOutput()
-
inline void inputReadAbort()
-
ADI3DToFImageStitchingInputInfo *getInputNode()
Public Members
-
bool camera_parameters_updated_[MAX_NUM_DEVICES] = {false}
-
float vertical_fov_sensor_in_degrees_ = 75.0f
-
float horizontal_fov_sensor_in_degrees_ = 75.0f
-
int out_image_height_ = 512
-
int out_image_width_ = 512 * MAX_NUM_DEVICES
Public Static Attributes
-
static const int MAX_NUM_DEVICES = 4
-
inline ADI3DToFImageStitching()