Classes | Functions
nxLibHelpers.h File Reference
#include "nxLib.h"
#include "pose_utilities.h"
#include <tf2/LinearMath/Transform.h>
#include <boost/optional.hpp>
#include <string>
#include <vector>
Include dependency graph for nxLibHelpers.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

bool checkNxLibVersion (int major, int minor)
 
sensor_msgs::ImagePtr retrieveRenderedDepthMap (NxLibItem const &cmdResult, VersionInfo const &nxLibVersion, std::string const &frame)
 
pcl::PointCloud< pcl::PointXYZ >::Ptr retrieveRenderedPointCloud (NxLibItem const &cmdResult, VersionInfo const &nxLibVersion, std::string const &frame)
 
NxLibItem retrieveResultPath (NxLibItem const &cmdResult, VersionInfo const &nxLibVersion)
 
pcl::PointCloud< pcl::PointXYZRGB >::Ptr retrieveTexturedPointCloud (NxLibItem const &cmdResult, VersionInfo const &nxLibVersion, std::string const &targetFrame)
 
void rosWarnOnceAboutDeprSDKVersion (std::string const &notSupportedMsg, VersionInfo const &version)
 
void setRenderParams (NxLibItem const &paramItem, RenderPointMapParams const *params)
 
void setRenderParams (NxLibItem const &cmdParams, VersionInfo const &nxLibVersion, RenderPointMapParams const *params)
 

Function Documentation

bool checkNxLibVersion ( int  major,
int  minor 
)

Check whether the NxLib has at least the given version.

Definition at line 14 of file nxLibHelpers.h.

sensor_msgs::ImagePtr retrieveRenderedDepthMap ( NxLibItem const &  cmdResult,
VersionInfo const &  nxLibVersion,
std::string const &  frame 
)

Definition at line 226 of file nxLibHelpers.h.

pcl::PointCloud<pcl::PointXYZ>::Ptr retrieveRenderedPointCloud ( NxLibItem const &  cmdResult,
VersionInfo const &  nxLibVersion,
std::string const &  frame 
)

Definition at line 184 of file nxLibHelpers.h.

NxLibItem retrieveResultPath ( NxLibItem const &  cmdResult,
VersionInfo const &  nxLibVersion 
)

Definition at line 216 of file nxLibHelpers.h.

pcl::PointCloud<pcl::PointXYZRGB>::Ptr retrieveTexturedPointCloud ( NxLibItem const &  cmdResult,
VersionInfo const &  nxLibVersion,
std::string const &  targetFrame 
)

Definition at line 200 of file nxLibHelpers.h.

void rosWarnOnceAboutDeprSDKVersion ( std::string const &  notSupportedMsg,
VersionInfo const &  version 
)
inline

Definition at line 178 of file nxLibHelpers.h.

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

Definition at line 149 of file nxLibHelpers.h.

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

Definition at line 240 of file nxLibHelpers.h.



ensenso_camera
Author(s): Ensenso
autogenerated on Thu May 6 2021 02:50:06