#include <vector>
#include <type_traits>
#include <cmath>
#include <ros/console.h>
#include <ros/assert.h>
#include <nav_msgs/OccupancyGrid.h>
#include <geometry_msgs/Pose.h>
#include <tf/transform_datatypes.h>
#include <opencv2/core/utility.hpp>
Go to the source code of this file.
Namespaces | |
namespace | combine_grids |
namespace | combine_grids::internal |
Functions | |
template<typename ForwardIt , typename OutputIt > | |
size_t | combine_grids::estimateGridTransform (ForwardIt grids_begin, ForwardIt grids_end, OutputIt transforms_begin, double confidence=1.0) |
Estimates transformation between grids when initial positions of grids in the world are unknown. | |
size_t | combine_grids::internal::opencvEstimateTransform (const std::vector< cv::Mat > &images, std::vector< cv::Mat > &transforms, double confidence) |
Estimates tranformation using opencv stitching pipeline. |