Namespaces | Functions
util3d.h File Reference
#include "rtabmap/core/RtabmapExp.h"
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/pcl_base.h>
#include <pcl/TextureMesh.h>
#include <rtabmap/core/Transform.h>
#include <rtabmap/core/SensorData.h>
#include <rtabmap/core/Parameters.h>
#include <opencv2/core/core.hpp>
#include <map>
#include <list>
Include dependency graph for util3d.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  rtabmap
namespace  rtabmap::util3d

Functions

pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::cloudFromDepth (const cv::Mat &imageDepth, const CameraModel &model, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0)
pcl::PointCloud
< pcl::PointXYZRGB >::Ptr
RTABMAP_EXP 
rtabmap::util3d::cloudFromDepthRGB (const cv::Mat &imageRgb, const cv::Mat &imageDepth, const CameraModel &model, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0)
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::cloudFromDisparity (const cv::Mat &imageDisparity, const StereoCameraModel &model, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0)
pcl::PointCloud
< pcl::PointXYZRGB >::Ptr
RTABMAP_EXP 
rtabmap::util3d::cloudFromDisparityRGB (const cv::Mat &imageRgb, const cv::Mat &imageDisparity, const StereoCameraModel &model, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0)
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::cloudFromSensorData (const SensorData &sensorData, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0, const ParametersMap &parameters=ParametersMap())
pcl::PointCloud
< pcl::PointXYZRGB >::Ptr
RTABMAP_EXP 
rtabmap::util3d::cloudFromStereoImages (const cv::Mat &imageLeft, const cv::Mat &imageRight, const StereoCameraModel &model, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0, const ParametersMap &parameters=ParametersMap())
pcl::PointCloud
< pcl::PointXYZRGB >::Ptr
RTABMAP_EXP 
rtabmap::util3d::cloudRGBFromSensorData (const SensorData &sensorData, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0, const ParametersMap &parameters=ParametersMap())
pcl::IndicesPtr RTABMAP_EXP rtabmap::util3d::concatenate (const std::vector< pcl::IndicesPtr > &indices)
 Concatenate a vector of indices to a single vector.
pcl::IndicesPtr RTABMAP_EXP rtabmap::util3d::concatenate (const pcl::IndicesPtr &indicesA, const pcl::IndicesPtr &indicesB)
 Concatenate two vector of indices to a single vector.
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::concatenateClouds (const std::list< pcl::PointCloud< pcl::PointXYZ >::Ptr > &clouds)
pcl::PointCloud
< pcl::PointXYZRGB >::Ptr
RTABMAP_EXP 
rtabmap::util3d::concatenateClouds (const std::list< pcl::PointCloud< pcl::PointXYZRGB >::Ptr > &clouds)
pcl::TextureMesh::Ptr RTABMAP_EXP rtabmap::util3d::concatenateTextureMeshes (const std::list< pcl::TextureMesh::Ptr > &meshes)
cv::Mat RTABMAP_EXP rtabmap::util3d::depthFromCloud (const pcl::PointCloud< pcl::PointXYZRGBA > &cloud, float &fx, float &fy, bool depth16U=true)
void RTABMAP_EXP rtabmap::util3d::fillProjectedCloudHoles (cv::Mat &depthRegistered, bool verticalDirection, bool fillToBorder)
bool RTABMAP_EXP rtabmap::util3d::isFinite (const cv::Point3f &pt)
cv::Mat RTABMAP_EXP rtabmap::util3d::laserScan2dFromPointCloud (const pcl::PointCloud< pcl::PointXYZ > &cloud, const Transform &transform=Transform())
pcl::PointCloud< pcl::PointXYZ >
RTABMAP_EXP 
rtabmap::util3d::laserScanFromDepthImage (const cv::Mat &depthImage, float fx, float fy, float cx, float cy, float maxDepth=0, float minDepth=0, const Transform &localTransform=Transform::getIdentity())
cv::Mat RTABMAP_EXP rtabmap::util3d::laserScanFromPointCloud (const pcl::PointCloud< pcl::PointXYZ > &cloud, const Transform &transform=Transform())
cv::Mat RTABMAP_EXP rtabmap::util3d::laserScanFromPointCloud (const pcl::PointCloud< pcl::PointNormal > &cloud, const Transform &transform=Transform())
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::laserScanToPointCloud (const cv::Mat &laserScan, const Transform &transform=Transform())
pcl::PointCloud
< pcl::PointNormal >::Ptr
RTABMAP_EXP 
rtabmap::util3d::laserScanToPointCloudNormal (const cv::Mat &laserScan, const Transform &transform=Transform())
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::loadBINCloud (const std::string &fileName, int dim)
pcl::PointCloud< pcl::PointXYZ >
::Ptr RTABMAP_EXP 
rtabmap::util3d::loadCloud (const std::string &path, const Transform &transform=Transform::getIdentity(), int downsampleStep=1, float voxelSize=0.0f)
cv::Mat RTABMAP_EXP rtabmap::util3d::loadScan (const std::string &path, const Transform &transform=Transform::getIdentity(), int downsampleStep=1, float voxelSize=0.0f, int normalsK=0)
cv::Mat RTABMAP_EXP rtabmap::util3d::projectCloudToCamera (const cv::Size &imageSize, const cv::Mat &cameraMatrixK, const cv::Mat &laserScan, const rtabmap::Transform &cameraTransform)
cv::Mat RTABMAP_EXP rtabmap::util3d::projectCloudToCamera (const cv::Size &imageSize, const cv::Mat &cameraMatrixK, const pcl::PointCloud< pcl::PointXYZ >::Ptr laserScan, const rtabmap::Transform &cameraTransform)
pcl::PointXYZ RTABMAP_EXP rtabmap::util3d::projectDepthTo3D (const cv::Mat &depthImage, float x, float y, float cx, float cy, float fx, float fy, bool smoothing, float maxZError=0.02f)
cv::Point3f RTABMAP_EXP rtabmap::util3d::projectDisparityTo3D (const cv::Point2f &pt, float disparity, const StereoCameraModel &model)
cv::Point3f RTABMAP_EXP rtabmap::util3d::projectDisparityTo3D (const cv::Point2f &pt, const cv::Mat &disparity, const StereoCameraModel &model)
void RTABMAP_EXP rtabmap::util3d::rgbdFromCloud (const pcl::PointCloud< pcl::PointXYZRGBA > &cloud, cv::Mat &rgb, cv::Mat &depth, float &fx, float &fy, bool bgrOrder=true, bool depth16U=true)
cv::Mat RTABMAP_EXP rtabmap::util3d::rgbFromCloud (const pcl::PointCloud< pcl::PointXYZRGBA > &cloud, bool bgrOrder=true)
 rtabmap::util3d::RTABMAP_DEPRECATED (pcl::PointCloud< pcl::PointXYZ >::Ptr RTABMAP_EXP cloudFromDepth(const cv::Mat &imageDepth, float cx, float cy, float fx, float fy, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0),"Use cloudFromDepth with CameraModel interface.")
 rtabmap::util3d::RTABMAP_DEPRECATED (pcl::PointCloud< pcl::PointXYZRGB >::Ptr RTABMAP_EXP cloudFromDepthRGB(const cv::Mat &imageRgb, const cv::Mat &imageDepth, float cx, float cy, float fx, float fy, int decimation=1, float maxDepth=0.0f, float minDepth=0.0f, std::vector< int > *validIndices=0),"Use cloudFromDepthRGB with CameraModel interface.")
void RTABMAP_EXP rtabmap::util3d::savePCDWords (const std::string &fileName, const std::multimap< int, pcl::PointXYZ > &words, const Transform &transform=Transform::getIdentity())
void RTABMAP_EXP rtabmap::util3d::savePCDWords (const std::string &fileName, const std::multimap< int, cv::Point3f > &words, const Transform &transform=Transform::getIdentity())


rtabmap
Author(s): Mathieu Labbe
autogenerated on Sat Jul 23 2016 11:44:30