#include "nxLib.h"
#include "pose_utilities.h"
#include <tf2/LinearMath/Transform.h>
#include <boost/optional.hpp>
#include <string>
#include <vector>
Go to the source code of this file.
|
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 ¬SupportedMsg, VersionInfo const &version) |
|
void | setRenderParams (NxLibItem const ¶mItem, RenderPointMapParams const *params) |
|
void | setRenderParams (NxLibItem const &cmdParams, VersionInfo const &nxLibVersion, RenderPointMapParams const *params) |
|
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 |
|
) |
| |
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 |
|
) |
| |
|
inline |