Classes | Functions
stereo_camera_helpers.h File Reference
#include "ensenso_camera/ros2/core.h"
#include "ensenso_camera/conversion.h"
#include "ensenso_camera/point_cloud_utilities.h"
#include "ensenso_camera/pose_utilities.h"
#include <tf2/LinearMath/Transform.h>
#include <limits>
#include <string>
#include <vector>
#include "nxLib.h"
Include dependency graph for stereo_camera_helpers.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  RenderPointMapParams
 
class  RenderPointMapParamsProjection
 
class  RenderPointMapParamsTelecentric
 

Functions

std::unique_ptr< ensenso::pcl::PointCloudpointCloudFromNxLib (NxLibItem const &node, std::string const &frame, bool isFileCamera=false, PointCloudROI const *roi=nullptr)
 
std::unique_ptr< ensenso::pcl::PointCloudColoredpointCloudTexturedFromNxLib (NxLibItem const &imageNode, NxLibItem const &pointsNode, std::string const &frame, bool isFileCamera=false, PointCloudROI const *roi=nullptr)
 
std::unique_ptr< ensenso::pcl::PointCloudNormalspointCloudWithNormalsFromNxLib (NxLibItem const &pointMapNode, NxLibItem const &normalNode, std::string const &frame, bool isFileCamera=false, PointCloudROI const *roi=nullptr)
 
sensor_msgs::msg::ImagePtr retrieveRenderedDepthMap (NxLibItem const &cmdResult, std::string const &frame, bool isFileCamera)
 
std::unique_ptr< ensenso::pcl::PointCloudretrieveRenderedPointCloud (NxLibItem const &cmdResult, std::string const &frame, bool isFileCamera=false)
 
std::unique_ptr< ensenso::pcl::PointCloudColoredretrieveTexturedPointCloud (NxLibItem const &cmdResult, std::string const &targetFrame, bool isFileCamera=false)
 
void setRenderParams (NxLibItem const &cmdParams, RenderPointMapParams const *params)
 

Function Documentation

◆ pointCloudFromNxLib()

std::unique_ptr<ensenso::pcl::PointCloud> pointCloudFromNxLib ( NxLibItem const &  node,
std::string const &  frame,
bool  isFileCamera = false,
PointCloudROI const *  roi = nullptr 
)

Definition at line 182 of file stereo_camera_helpers.h.

◆ pointCloudTexturedFromNxLib()

std::unique_ptr<ensenso::pcl::PointCloudColored> pointCloudTexturedFromNxLib ( NxLibItem const &  imageNode,
NxLibItem const &  pointsNode,
std::string const &  frame,
bool  isFileCamera = false,
PointCloudROI const *  roi = nullptr 
)

Definition at line 271 of file stereo_camera_helpers.h.

◆ pointCloudWithNormalsFromNxLib()

std::unique_ptr<ensenso::pcl::PointCloudNormals> pointCloudWithNormalsFromNxLib ( NxLibItem const &  pointMapNode,
NxLibItem const &  normalNode,
std::string const &  frame,
bool  isFileCamera = false,
PointCloudROI const *  roi = nullptr 
)

Definition at line 222 of file stereo_camera_helpers.h.

◆ retrieveRenderedDepthMap()

sensor_msgs::msg::ImagePtr retrieveRenderedDepthMap ( NxLibItem const &  cmdResult,
std::string const &  frame,
bool  isFileCamera 
)

Definition at line 335 of file stereo_camera_helpers.h.

◆ retrieveRenderedPointCloud()

std::unique_ptr<ensenso::pcl::PointCloud> retrieveRenderedPointCloud ( NxLibItem const &  cmdResult,
std::string const &  frame,
bool  isFileCamera = false 
)

Definition at line 320 of file stereo_camera_helpers.h.

◆ retrieveTexturedPointCloud()

std::unique_ptr<ensenso::pcl::PointCloudColored> retrieveTexturedPointCloud ( NxLibItem const &  cmdResult,
std::string const &  targetFrame,
bool  isFileCamera = false 
)

Definition at line 327 of file stereo_camera_helpers.h.

◆ setRenderParams()

void setRenderParams ( NxLibItem const &  cmdParams,
RenderPointMapParams const *  params 
)

Definition at line 143 of file stereo_camera_helpers.h.



ensenso_camera
Author(s): Ensenso
autogenerated on Wed Apr 2 2025 02:37:46