#include "rtabmap/core/GainCompensator.h"
#include <rtabmap/utilite/ULogger.h>
#include <rtabmap/utilite/UStl.h>
#include <rtabmap/utilite/UConversion.h>
#include <rtabmap/core/util3d_transforms.h>
#include <pcl/search/kdtree.h>
#include <pcl/common/common.h>
#include <pcl/common/transforms.h>
#include <pcl/correspondence.h>
Go to the source code of this file.
|
template<typename PointT > |
void | rtabmap::applyImpl (int index, typename pcl::PointCloud< PointT >::Ptr &cloud, const pcl::IndicesPtr &indices, const cv::Mat_< double > &gains, bool rgb) |
|
template<typename PointT > |
void | rtabmap::feedImpl (const std::map< int, typename pcl::PointCloud< PointT >::Ptr > &clouds, const std::map< int, pcl::IndicesPtr > &indices, const std::multimap< int, Link > &links, float maxCorrespondenceDistance, double minOverlap, double alpha, double beta, cv::Mat_< double > &gains, std::map< int, int > &idToIndex) |
|
double | rtabmap::sqr (uchar v) |
|
bool | rtabmap::testAABBAABB (const AABB &a, const AABB &b) |
|