17 #ifndef CARTOGRAPHER_MAPPING_INTERNAL_3D_SCAN_MATCHING_CERES_SCAN_MATCHER_3D_H_ 18 #define CARTOGRAPHER_MAPPING_INTERNAL_3D_SCAN_MATCHING_CERES_SCAN_MATCHER_3D_H_ 26 #include "cartographer/mapping/proto/scan_matching/ceres_scan_matcher_options_3d.pb.h" 32 namespace scan_matching {
35 common::LuaParameterDictionary* parameter_dictionary);
38 std::pair<const sensor::PointCloud*, const HybridGrid*>;
51 void Match(
const Eigen::Vector3d& target_translation,
53 const std::vector<PointCloudAndHybridGridPointers>&
54 point_clouds_and_hybrid_grids,
56 ceres::Solver::Summary* summary);
59 const proto::CeresScanMatcherOptions3D
options_;
67 #endif // CARTOGRAPHER_MAPPING_INTERNAL_3D_SCAN_MATCHING_CERES_SCAN_MATCHER_3D_H_
proto::CeresScanMatcherOptions3D CreateCeresScanMatcherOptions3D(common::LuaParameterDictionary *const parameter_dictionary)
ceres::Solver::Options ceres_solver_options_
CeresScanMatcher3D(const proto::CeresScanMatcherOptions3D &options)
void Match(const Eigen::Vector3d &target_translation, const transform::Rigid3d &initial_pose_estimate, const std::vector< PointCloudAndHybridGridPointers > &point_clouds_and_hybrid_grids, transform::Rigid3d *pose_estimate, ceres::Solver::Summary *summary)
CeresScanMatcher3D & operator=(const CeresScanMatcher3D &)=delete
const proto::CeresScanMatcherOptions3D options_
std::pair< const sensor::PointCloud *, const HybridGrid * > PointCloudAndHybridGridPointers