#include <frame_common/frame.h>
#include <frame_common/frame_extended.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/PointIndices.h>
#include <pcl/features/normal_3d.h>
#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/filters/passthrough.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/filters/filter.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/common/transform.h>
#include <pcl/registration/transforms.h>
#include <pcl/registration/icp.h>
#include <pcl/registration/icp_nl.h>
#include <pcl/io/pcd_io.h>
Go to the source code of this file.
Namespaces | |
namespace | frame_common |
Functions | |
static void | frame_common::drawSmallKeypoints (const cv::Mat &image, const std::vector< cv::KeyPoint > &keypoints, cv::Mat &display, cv::Scalar color) |
void | frame_common::drawVOtracks (const cv::Mat &image, const vector< FrameExtended, Eigen::aligned_allocator< FrameExtended > > &frames, cv::Mat &display) |
void | frame_common::drawVOtracks (const cv::Mat &image, const vector< Frame, Eigen::aligned_allocator< Frame > > &frames, cv::Mat &display) |