├── ORB_SLAM2_modified
├── CMakeLists.txt
├── Dependencies.md
├── Examples
│ ├── Monocular
│ │ ├── KITTI00-02.yaml
│ │ ├── KITTI03.yaml
│ │ ├── KITTI04-12.yaml
│ │ ├── TUM1.yaml
│ │ ├── TUM2.yaml
│ │ ├── TUM3.yaml
│ │ ├── mono_kitti
│ │ ├── mono_kitti.cc
│ │ ├── mono_tum
│ │ └── mono_tum.cc
│ ├── RGB-D
│ │ ├── TUM1.yaml
│ │ ├── TUM2.yaml
│ │ ├── TUM3.yaml
│ │ ├── associations
│ │ │ ├── fr1_desk.txt
│ │ │ ├── fr1_desk2.txt
│ │ │ ├── fr1_room.txt
│ │ │ ├── fr1_xyz.txt
│ │ │ ├── fr2_desk.txt
│ │ │ ├── fr2_xyz.txt
│ │ │ ├── fr3_nstr_tex_near.txt
│ │ │ ├── fr3_office.txt
│ │ │ ├── fr3_str_tex_far.txt
│ │ │ └── fr3_str_tex_near.txt
│ │ ├── rgbd_cc
│ │ ├── rgbd_cc.cc
│ │ ├── rgbd_tum
│ │ ├── rgbd_tum.cc
│ │ └── xtion.yaml
│ ├── ROS
│ │ └── ORB-SLAM2_DENSE
│ │ │ ├── CMakeLists.txt
│ │ │ ├── Mono
│ │ │ ├── Pose_transform
│ │ │ ├── RGBD
│ │ │ ├── launch
│ │ │ ├── Octomap.launch
│ │ │ ├── move_base.launch
│ │ │ └── transform.launch
│ │ │ ├── manifest.xml
│ │ │ ├── orb_octomap
│ │ │ ├── params
│ │ │ ├── base_local_planner_params.yaml
│ │ │ ├── costmap_common_params.yaml
│ │ │ ├── global_costmap_params.yaml
│ │ │ ├── local_costmap_params.yaml
│ │ │ └── move_base_params.yaml
│ │ │ ├── src
│ │ │ ├── Pose_transform.cc
│ │ │ ├── octomap.cc
│ │ │ ├── ros_mono.cc
│ │ │ └── ros_rgbd.cc
│ │ │ └── visual_octomap
│ └── Stereo
│ │ ├── KITTI00-02.yaml
│ │ ├── KITTI03.yaml
│ │ ├── KITTI04-12.yaml
│ │ ├── stereo_kitti
│ │ └── stereo_kitti.cc
├── LICENSE.txt
├── License-gpl.txt
├── ORB_SLAM2_modified.kdev4
├── README.md
├── Thirdparty
│ └── DBoW2
│ │ ├── CMakeLists.txt
│ │ ├── DBoW2
│ │ ├── BowVector.cpp
│ │ ├── BowVector.h
│ │ ├── FClass.h
│ │ ├── FORB.cpp
│ │ ├── FORB.h
│ │ ├── FeatureVector.cpp
│ │ ├── FeatureVector.h
│ │ ├── ScoringObject.cpp
│ │ ├── ScoringObject.h
│ │ └── TemplatedVocabulary.h
│ │ ├── DUtils
│ │ ├── Random.cpp
│ │ ├── Random.h
│ │ ├── Timestamp.cpp
│ │ └── Timestamp.h
│ │ ├── LICENSE.txt
│ │ └── README.txt
├── build.sh
├── cmake_modules
│ ├── FindCholmod.cmake
│ ├── FindEigen3.cmake
│ └── FindG2O.cmake
├── include
│ ├── Converter.h
│ ├── Frame.h
│ ├── FrameDrawer.h
│ ├── Initializer.h
│ ├── KeyFrame.h
│ ├── KeyFrameDatabase.h
│ ├── LocalMapping.h
│ ├── LoopClosing.h
│ ├── Map.h
│ ├── MapDrawer.h
│ ├── MapPoint.h
│ ├── ORBVocabulary.h
│ ├── ORBextractor.h
│ ├── ORBmatcher.h
│ ├── Optimizer.h
│ ├── PnPsolver.h
│ ├── Sim3Solver.h
│ ├── System.h
│ ├── Tracking.h
│ ├── Viewer.h
│ └── pointcloudmapping.h
├── orb_slam2_dense
│ ├── CMakeLists.txt
│ ├── main.cpp
│ ├── orb_slam2_dense.cpp
│ ├── orb_slam2_dense.h
│ └── orb_slam2_dense.kdev4
├── run_now.sh
└── src
│ ├── Converter.cc
│ ├── Frame.cc
│ ├── FrameDrawer.cc
│ ├── Initializer.cc
│ ├── KeyFrame.cc
│ ├── KeyFrameDatabase.cc
│ ├── LocalMapping.cc
│ ├── LoopClosing.cc
│ ├── Map.cc
│ ├── MapDrawer.cc
│ ├── MapPoint.cc
│ ├── ORBextractor.cc
│ ├── ORBmatcher.cc
│ ├── Optimizer.cc
│ ├── PnPsolver.cc
│ ├── Sim3Solver.cc
│ ├── System.cc
│ ├── Tracking.cc
│ ├── Viewer.cc
│ └── pointcloudmapping.cc
├── README.md
└── g2o_with_orbslam2
├── CMakeLists.txt
├── EXTERNAL
├── CMakeLists.txt
├── ceres
│ ├── LICENSE
│ ├── autodiff.h
│ ├── eigen.h
│ ├── fixed_array.h
│ ├── fpclassify.h
│ ├── jet.h
│ ├── macros.h
│ ├── manual_constructor.h
│ └── variadic_evaluate.h
├── csparse
│ ├── CMakeLists.txt
│ ├── License.txt
│ ├── README.txt
│ ├── cs.h
│ ├── cs_add.c
│ ├── cs_amd.c
│ ├── cs_api.h
│ ├── cs_chol.c
│ ├── cs_cholsol.c
│ ├── cs_compress.c
│ ├── cs_counts.c
│ ├── cs_cumsum.c
│ ├── cs_dfs.c
│ ├── cs_dmperm.c
│ ├── cs_droptol.c
│ ├── cs_dropzeros.c
│ ├── cs_dupl.c
│ ├── cs_entry.c
│ ├── cs_ereach.c
│ ├── cs_etree.c
│ ├── cs_fkeep.c
│ ├── cs_gaxpy.c
│ ├── cs_happly.c
│ ├── cs_house.c
│ ├── cs_ipvec.c
│ ├── cs_leaf.c
│ ├── cs_load.c
│ ├── cs_lsolve.c
│ ├── cs_ltsolve.c
│ ├── cs_lu.c
│ ├── cs_lusol.c
│ ├── cs_malloc.c
│ ├── cs_maxtrans.c
│ ├── cs_multiply.c
│ ├── cs_norm.c
│ ├── cs_permute.c
│ ├── cs_pinv.c
│ ├── cs_post.c
│ ├── cs_print.c
│ ├── cs_pvec.c
│ ├── cs_qr.c
│ ├── cs_qrsol.c
│ ├── cs_randperm.c
│ ├── cs_reach.c
│ ├── cs_scatter.c
│ ├── cs_scc.c
│ ├── cs_schol.c
│ ├── cs_spsolve.c
│ ├── cs_sqr.c
│ ├── cs_symperm.c
│ ├── cs_tdfs.c
│ ├── cs_transpose.c
│ ├── cs_updown.c
│ ├── cs_usolve.c
│ ├── cs_util.c
│ ├── cs_utsolve.c
│ └── lesser.txt
└── freeglut
│ ├── CMakeLists.txt
│ ├── COPYING
│ ├── freeglut_font.cpp
│ ├── freeglut_minimal.h
│ ├── freeglut_stroke_mono_roman.cpp
│ └── freeglut_stroke_roman.cpp
├── README.md
├── cmake_modules
├── FindBLAS.cmake
├── FindCSparse.cmake
├── FindCholmod.cmake
├── FindEigen3.cmake
├── FindG2O.cmake
├── FindLAPACK.cmake
├── FindQGLViewer.cmake
└── FindSuiteSparse.cmake
├── config.h.in
├── doc
└── .gitignore
├── g2o
├── .gitignore
├── CMakeLists.txt
├── apps
│ ├── CMakeLists.txt
│ ├── g2o_cli
│ │ ├── CMakeLists.txt
│ │ ├── dl_wrapper.cpp
│ │ ├── dl_wrapper.h
│ │ ├── g2o.cpp
│ │ ├── g2o_cli_api.h
│ │ ├── g2o_common.cpp
│ │ ├── g2o_common.h
│ │ ├── output_helper.cpp
│ │ └── output_helper.h
│ ├── g2o_hierarchical
│ │ ├── CMakeLists.txt
│ │ ├── backbone_tree_action.cpp
│ │ ├── backbone_tree_action.h
│ │ ├── edge_creator.cpp
│ │ ├── edge_creator.h
│ │ ├── edge_labeler.cpp
│ │ ├── edge_labeler.h
│ │ ├── edge_types_cost_function.cpp
│ │ ├── edge_types_cost_function.h
│ │ ├── g2o_hierarchical.cpp
│ │ ├── g2o_hierarchical_api.h
│ │ ├── g2o_hierarchical_test_functions.cpp
│ │ ├── simple_star_ops.cpp
│ │ ├── simple_star_ops.h
│ │ ├── star.cpp
│ │ └── star.h
│ ├── g2o_simulator
│ │ ├── CMakeLists.txt
│ │ ├── convertSegmentLine.cpp
│ │ ├── converteSegmentLine.cpp
│ │ ├── g2o_anonymize_observations.cpp
│ │ ├── g2o_simulator_api.h
│ │ ├── pointsensorparameters.cpp
│ │ ├── pointsensorparameters.h
│ │ ├── sensor_line3d.cpp
│ │ ├── sensor_line3d.h
│ │ ├── sensor_odometry.h
│ │ ├── sensor_odometry2d.cpp
│ │ ├── sensor_odometry2d.h
│ │ ├── sensor_odometry3d.cpp
│ │ ├── sensor_odometry3d.h
│ │ ├── sensor_pointxy.cpp
│ │ ├── sensor_pointxy.h
│ │ ├── sensor_pointxy_bearing.cpp
│ │ ├── sensor_pointxy_bearing.h
│ │ ├── sensor_pointxy_offset.cpp
│ │ ├── sensor_pointxy_offset.h
│ │ ├── sensor_pointxyz.cpp
│ │ ├── sensor_pointxyz.h
│ │ ├── sensor_pointxyz_depth.cpp
│ │ ├── sensor_pointxyz_depth.h
│ │ ├── sensor_pointxyz_disparity.cpp
│ │ ├── sensor_pointxyz_disparity.h
│ │ ├── sensor_pose2d.cpp
│ │ ├── sensor_pose2d.h
│ │ ├── sensor_pose3d.cpp
│ │ ├── sensor_pose3d.h
│ │ ├── sensor_pose3d_offset.cpp
│ │ ├── sensor_pose3d_offset.h
│ │ ├── sensor_se3_prior.cpp
│ │ ├── sensor_se3_prior.h
│ │ ├── sensor_segment2d.cpp
│ │ ├── sensor_segment2d.h
│ │ ├── sensor_segment2d_line.cpp
│ │ ├── sensor_segment2d_line.h
│ │ ├── sensor_segment2d_pointline.cpp
│ │ ├── sensor_segment2d_pointline.h
│ │ ├── simulator.cpp
│ │ ├── simulator.h
│ │ ├── simulator2d.h
│ │ ├── simulator2d_base.h
│ │ ├── simulator2d_segment.cpp
│ │ ├── simulator3d.h
│ │ ├── simulator3d_base.h
│ │ ├── simutils.cpp
│ │ ├── simutils.h
│ │ ├── test_simulator2d.cpp
│ │ └── test_simulator3d.cpp
│ ├── g2o_viewer
│ │ ├── CMakeLists.txt
│ │ ├── base_main_window.ui
│ │ ├── base_properties_widget.ui
│ │ ├── g2o_qglviewer.cpp
│ │ ├── g2o_qglviewer.h
│ │ ├── g2o_viewer.cpp
│ │ ├── g2o_viewer_api.h
│ │ ├── gui_hyper_graph_action.cpp
│ │ ├── gui_hyper_graph_action.h
│ │ ├── main_window.cpp
│ │ ├── main_window.h
│ │ ├── properties_widget.cpp
│ │ ├── properties_widget.h
│ │ ├── run_g2o_viewer.cpp
│ │ ├── run_g2o_viewer.h
│ │ ├── stream_redirect.cpp
│ │ ├── stream_redirect.h
│ │ ├── viewer_properties_widget.cpp
│ │ └── viewer_properties_widget.h
│ └── linked_binaries
│ │ └── CMakeLists.txt
├── core
│ ├── CMakeLists.txt
│ ├── base_binary_edge.h
│ ├── base_binary_edge.hpp
│ ├── base_edge.h
│ ├── base_multi_edge.h
│ ├── base_multi_edge.hpp
│ ├── base_unary_edge.h
│ ├── base_unary_edge.hpp
│ ├── base_vertex.h
│ ├── base_vertex.hpp
│ ├── batch_stats.cpp
│ ├── batch_stats.h
│ ├── block_solver.h
│ ├── block_solver.hpp
│ ├── cache.cpp
│ ├── cache.h
│ ├── creators.h
│ ├── eigen_types.h
│ ├── estimate_propagator.cpp
│ ├── estimate_propagator.h
│ ├── factory.cpp
│ ├── factory.h
│ ├── g2o_core_api.h
│ ├── hyper_dijkstra.cpp
│ ├── hyper_dijkstra.h
│ ├── hyper_graph.cpp
│ ├── hyper_graph.h
│ ├── hyper_graph_action.cpp
│ ├── hyper_graph_action.h
│ ├── jacobian_workspace.cpp
│ ├── jacobian_workspace.h
│ ├── linear_solver.h
│ ├── marginal_covariance_cholesky.cpp
│ ├── marginal_covariance_cholesky.h
│ ├── matrix_operations.h
│ ├── matrix_structure.cpp
│ ├── matrix_structure.h
│ ├── openmp_mutex.h
│ ├── optimizable_graph.cpp
│ ├── optimizable_graph.h
│ ├── optimization_algorithm.cpp
│ ├── optimization_algorithm.h
│ ├── optimization_algorithm_dogleg.cpp
│ ├── optimization_algorithm_dogleg.h
│ ├── optimization_algorithm_factory.cpp
│ ├── optimization_algorithm_factory.h
│ ├── optimization_algorithm_gauss_newton.cpp
│ ├── optimization_algorithm_gauss_newton.h
│ ├── optimization_algorithm_levenberg.cpp
│ ├── optimization_algorithm_levenberg.h
│ ├── optimization_algorithm_property.h
│ ├── optimization_algorithm_with_hessian.cpp
│ ├── optimization_algorithm_with_hessian.h
│ ├── parameter.cpp
│ ├── parameter.h
│ ├── parameter_container.cpp
│ ├── parameter_container.h
│ ├── robust_kernel.cpp
│ ├── robust_kernel.h
│ ├── robust_kernel_factory.cpp
│ ├── robust_kernel_factory.h
│ ├── robust_kernel_impl.cpp
│ ├── robust_kernel_impl.h
│ ├── solver.cpp
│ ├── solver.h
│ ├── sparse_block_matrix.h
│ ├── sparse_block_matrix.hpp
│ ├── sparse_block_matrix_ccs.h
│ ├── sparse_block_matrix_diagonal.h
│ ├── sparse_block_matrix_test.cpp
│ ├── sparse_optimizer.cpp
│ ├── sparse_optimizer.h
│ ├── sparse_optimizer_terminate_action.cpp
│ └── sparse_optimizer_terminate_action.h
├── examples
│ ├── CMakeLists.txt
│ ├── ba
│ │ ├── CMakeLists.txt
│ │ └── ba_demo.cpp
│ ├── ba_anchored_inverse_depth
│ │ ├── CMakeLists.txt
│ │ └── ba_anchored_inverse_depth_demo.cpp
│ ├── bal
│ │ ├── CMakeLists.txt
│ │ └── bal_example.cpp
│ ├── calibration_odom_laser
│ │ ├── CMakeLists.txt
│ │ ├── closed_form_calibration.cpp
│ │ ├── closed_form_calibration.h
│ │ ├── edge_se2_pure_calib.cpp
│ │ ├── edge_se2_pure_calib.h
│ │ ├── g2o_calibration_odom_laser_api.h
│ │ ├── gm2dl_io.cpp
│ │ ├── gm2dl_io.h
│ │ ├── motion_information.h
│ │ ├── sclam_helpers.cpp
│ │ ├── sclam_helpers.h
│ │ ├── sclam_laser_calib.cpp
│ │ ├── sclam_odom_laser.cpp
│ │ └── sclam_pure_calibration.cpp
│ ├── data_convert
│ │ ├── CMakeLists.txt
│ │ └── convert_sba_slam3d.cpp
│ ├── data_fitting
│ │ ├── CMakeLists.txt
│ │ ├── circle_fit.cpp
│ │ └── curve_fit.cpp
│ ├── g2o_unfold
│ │ ├── g2o-unfold.cpp
│ │ ├── tools.cpp
│ │ └── tools.h
│ ├── icp
│ │ ├── CMakeLists.txt
│ │ ├── gicp-test1.dat
│ │ ├── gicp_demo.cpp
│ │ └── gicp_sba_demo.cpp
│ ├── interactive_slam
│ │ ├── CMakeLists.txt
│ │ ├── README.txt
│ │ ├── g2o_incremental
│ │ │ ├── CMakeLists.txt
│ │ │ ├── README.txt
│ │ │ ├── g2o_incremental.cpp
│ │ │ ├── g2o_incremental_api.h
│ │ │ ├── graph_optimizer_sparse_incremental.cpp
│ │ │ ├── graph_optimizer_sparse_incremental.h
│ │ │ ├── linear_solver_cholmod_online.h
│ │ │ └── protocol.txt
│ │ ├── g2o_interactive
│ │ │ ├── CMakeLists.txt
│ │ │ ├── fast_output.h
│ │ │ ├── g2o_interactive_api.h
│ │ │ ├── g2o_online.cpp
│ │ │ ├── g2o_slam_interface.cpp
│ │ │ ├── g2o_slam_interface.h
│ │ │ ├── generate_commands.cpp
│ │ │ ├── graph_optimizer_sparse_online.cpp
│ │ │ ├── graph_optimizer_sparse_online.h
│ │ │ ├── protocol.txt
│ │ │ ├── types_online.cpp
│ │ │ ├── types_slam2d_online.h
│ │ │ └── types_slam3d_online.h
│ │ └── slam_parser
│ │ │ ├── CMakeLists.txt
│ │ │ ├── interface
│ │ │ ├── CMakeLists.txt
│ │ │ ├── abstract_slam_interface.h
│ │ │ ├── parser_interface.cpp
│ │ │ ├── parser_interface.h
│ │ │ ├── slam_context_interface.cpp
│ │ │ └── slam_context_interface.h
│ │ │ └── parser
│ │ │ ├── CMakeLists.txt
│ │ │ ├── FlexLexer.h
│ │ │ ├── bison_parser.cpp
│ │ │ ├── bison_parser.h
│ │ │ ├── commands.h
│ │ │ ├── driver.cpp
│ │ │ ├── driver.h
│ │ │ ├── flex_scanner.cpp
│ │ │ ├── grammar.sh
│ │ │ ├── location.hh
│ │ │ ├── parser.yy
│ │ │ ├── position.hh
│ │ │ ├── scanner.h
│ │ │ ├── scanner.l
│ │ │ ├── slam_context.cpp
│ │ │ ├── slam_context.h
│ │ │ ├── stack.hh
│ │ │ └── test_slam_parser.cpp
│ ├── plane_slam
│ │ ├── CMakeLists.txt
│ │ ├── plane_test.cpp
│ │ └── simulator_3d_plane.cpp
│ ├── sba
│ │ ├── CMakeLists.txt
│ │ └── sba_demo.cpp
│ ├── simple_optimize
│ │ ├── CMakeLists.txt
│ │ └── simple_optimize.cpp
│ ├── slam2d
│ │ ├── CMakeLists.txt
│ │ ├── base_main_window.ui
│ │ ├── draw_helpers.cpp
│ │ ├── draw_helpers.h
│ │ ├── main_window.cpp
│ │ ├── main_window.h
│ │ ├── slam2d_g2o.cpp
│ │ ├── slam2d_viewer.cpp
│ │ └── slam2d_viewer.h
│ ├── sphere
│ │ ├── CMakeLists.txt
│ │ └── create_sphere.cpp
│ ├── target
│ │ ├── CMakeLists.txt
│ │ ├── constant_velocity_target.cpp
│ │ ├── continuous_to_discrete.h
│ │ ├── static_target.cpp
│ │ ├── targetTypes3D.hpp
│ │ └── targetTypes6D.hpp
│ └── tutorial_slam2d
│ │ ├── CMakeLists.txt
│ │ ├── edge_se2.cpp
│ │ ├── edge_se2.h
│ │ ├── edge_se2_pointxy.cpp
│ │ ├── edge_se2_pointxy.h
│ │ ├── g2o_tutorial_slam2d_api.h
│ │ ├── parameter_se2_offset.cpp
│ │ ├── parameter_se2_offset.h
│ │ ├── rand.h
│ │ ├── se2.h
│ │ ├── simulator.cpp
│ │ ├── simulator.h
│ │ ├── tutorial_slam2d.cpp
│ │ ├── types_tutorial_slam2d.cpp
│ │ ├── types_tutorial_slam2d.h
│ │ ├── vertex_point_xy.cpp
│ │ ├── vertex_point_xy.h
│ │ ├── vertex_se2.cpp
│ │ └── vertex_se2.h
├── solvers
│ ├── CMakeLists.txt
│ ├── cholmod
│ │ ├── CMakeLists.txt
│ │ ├── linear_solver_cholmod.h
│ │ └── solver_cholmod.cpp
│ ├── csparse
│ │ ├── CMakeLists.txt
│ │ ├── csparse_helper.cpp
│ │ ├── csparse_helper.h
│ │ ├── g2o_csparse_api.h
│ │ ├── g2o_csparse_extension_api.h
│ │ ├── linear_solver_csparse.h
│ │ └── solver_csparse.cpp
│ ├── dense
│ │ ├── CMakeLists.txt
│ │ ├── linear_solver_dense.h
│ │ └── solver_dense.cpp
│ ├── eigen
│ │ ├── CMakeLists.txt
│ │ ├── linear_solver_eigen.h
│ │ └── solver_eigen.cpp
│ ├── pcg
│ │ ├── CMakeLists.txt
│ │ ├── linear_solver_pcg.h
│ │ ├── linear_solver_pcg.hpp
│ │ └── solver_pcg.cpp
│ ├── slam2d_linear
│ │ ├── CMakeLists.txt
│ │ ├── g2o_slam2d_linear_api.h
│ │ ├── slam2d_linear.cpp
│ │ ├── solver_slam2d_linear.cpp
│ │ └── solver_slam2d_linear.h
│ └── structure_only
│ │ ├── CMakeLists.txt
│ │ ├── structure_only.cpp
│ │ └── structure_only_solver.h
├── stuff
│ ├── CMakeLists.txt
│ ├── color_macros.h
│ ├── command_args.cpp
│ ├── command_args.h
│ ├── filesys_tools.cpp
│ ├── filesys_tools.h
│ ├── g2o_stuff_api.h
│ ├── macros.h
│ ├── misc.h
│ ├── opengl_primitives.cpp
│ ├── opengl_primitives.h
│ ├── opengl_wrapper.h
│ ├── os_specific.c
│ ├── os_specific.h
│ ├── property.cpp
│ ├── property.h
│ ├── sampler.cpp
│ ├── sampler.h
│ ├── scoped_pointer.h
│ ├── sparse_helper.cpp
│ ├── sparse_helper.h
│ ├── string_tools.cpp
│ ├── string_tools.h
│ ├── tictoc.cpp
│ ├── tictoc.h
│ ├── timeutil.cpp
│ ├── timeutil.h
│ └── unscented.h
├── types
│ ├── CMakeLists.txt
│ ├── data
│ │ ├── CMakeLists.txt
│ │ ├── data_queue.cpp
│ │ ├── data_queue.h
│ │ ├── g2o_types_data_api.h
│ │ ├── laser_parameters.cpp
│ │ ├── laser_parameters.h
│ │ ├── raw_laser.cpp
│ │ ├── raw_laser.h
│ │ ├── robot_data.cpp
│ │ ├── robot_data.h
│ │ ├── robot_laser.cpp
│ │ ├── robot_laser.h
│ │ ├── types_data.cpp
│ │ ├── types_data.h
│ │ ├── vertex_ellipse.cpp
│ │ ├── vertex_ellipse.h
│ │ ├── vertex_tag.cpp
│ │ └── vertex_tag.h
│ ├── deprecated
│ │ ├── CMakeLists.txt
│ │ └── slam3d
│ │ │ ├── CMakeLists.txt
│ │ │ ├── edge_se3_offset.cpp
│ │ │ ├── edge_se3_offset.h
│ │ │ ├── edge_se3_pointxyz.cpp
│ │ │ ├── edge_se3_pointxyz.h
│ │ │ ├── edge_se3_pointxyz_depth.cpp
│ │ │ ├── edge_se3_pointxyz_depth.h
│ │ │ ├── edge_se3_pointxyz_disparity.cpp
│ │ │ ├── edge_se3_pointxyz_disparity.h
│ │ │ ├── edge_se3_prior.cpp
│ │ │ ├── edge_se3_prior.h
│ │ │ ├── edge_se3_quat.cpp
│ │ │ ├── edge_se3_quat.h
│ │ │ ├── g2o_deprecated_types_slam3d_api.h
│ │ │ ├── parameter_camera.cpp
│ │ │ ├── parameter_camera.h
│ │ │ ├── parameter_se3_offset.cpp
│ │ │ ├── parameter_se3_offset.h
│ │ │ ├── se3quat_gradients.cpp
│ │ │ ├── se3quat_gradients.h
│ │ │ ├── types_slam3d.cpp
│ │ │ ├── types_slam3d.h
│ │ │ ├── vertex_pointxyz.cpp
│ │ │ ├── vertex_pointxyz.h
│ │ │ ├── vertex_se3_quat.cpp
│ │ │ └── vertex_se3_quat.h
│ ├── icp
│ │ ├── CMakeLists.txt
│ │ ├── g2o_types_icp_api.h
│ │ ├── types_icp.cpp
│ │ └── types_icp.h
│ ├── sba
│ │ ├── CMakeLists.txt
│ │ ├── g2o_types_sba_api.h
│ │ ├── sbacam.h
│ │ ├── types_sba.cpp
│ │ ├── types_sba.h
│ │ ├── types_six_dof_expmap.cpp
│ │ └── types_six_dof_expmap.h
│ ├── sclam2d
│ │ ├── CMakeLists.txt
│ │ ├── edge_se2_odom_differential_calib.cpp
│ │ ├── edge_se2_odom_differential_calib.h
│ │ ├── edge_se2_sensor_calib.cpp
│ │ ├── edge_se2_sensor_calib.h
│ │ ├── g2o_types_sclam2d_api.h
│ │ ├── odometry_measurement.cpp
│ │ ├── odometry_measurement.h
│ │ ├── types_sclam2d.cpp
│ │ ├── types_sclam2d.h
│ │ ├── vertex_odom_differential_params.cpp
│ │ └── vertex_odom_differential_params.h
│ ├── sim3
│ │ ├── CMakeLists.txt
│ │ ├── sim3.h
│ │ ├── types_seven_dof_expmap.cpp
│ │ └── types_seven_dof_expmap.h
│ ├── slam2d
│ │ ├── CMakeLists.txt
│ │ ├── edge_pointxy.cpp
│ │ ├── edge_pointxy.h
│ │ ├── edge_se2.cpp
│ │ ├── edge_se2.h
│ │ ├── edge_se2_lotsofxy.cpp
│ │ ├── edge_se2_lotsofxy.h
│ │ ├── edge_se2_offset.cpp
│ │ ├── edge_se2_offset.h
│ │ ├── edge_se2_pointxy.cpp
│ │ ├── edge_se2_pointxy.h
│ │ ├── edge_se2_pointxy_bearing.cpp
│ │ ├── edge_se2_pointxy_bearing.h
│ │ ├── edge_se2_pointxy_calib.cpp
│ │ ├── edge_se2_pointxy_calib.h
│ │ ├── edge_se2_pointxy_offset.cpp
│ │ ├── edge_se2_pointxy_offset.h
│ │ ├── edge_se2_prior.cpp
│ │ ├── edge_se2_prior.h
│ │ ├── edge_se2_twopointsxy.cpp
│ │ ├── edge_se2_twopointsxy.h
│ │ ├── edge_se2_xyprior.cpp
│ │ ├── edge_se2_xyprior.h
│ │ ├── g2o_types_slam2d_api.h
│ │ ├── parameter_se2_offset.cpp
│ │ ├── parameter_se2_offset.h
│ │ ├── se2.h
│ │ ├── types_slam2d.cpp
│ │ ├── types_slam2d.h
│ │ ├── vertex_point_xy.cpp
│ │ ├── vertex_point_xy.h
│ │ ├── vertex_se2.cpp
│ │ └── vertex_se2.h
│ ├── slam2d_addons
│ │ ├── CMakeLists.txt
│ │ ├── edge_line2d.cpp
│ │ ├── edge_line2d.h
│ │ ├── edge_line2d_pointxy.cpp
│ │ ├── edge_line2d_pointxy.h
│ │ ├── edge_se2_line2d.cpp
│ │ ├── edge_se2_line2d.h
│ │ ├── edge_se2_segment2d.cpp
│ │ ├── edge_se2_segment2d.h
│ │ ├── edge_se2_segment2d_line.cpp
│ │ ├── edge_se2_segment2d_line.h
│ │ ├── edge_se2_segment2d_pointLine.cpp
│ │ ├── edge_se2_segment2d_pointLine.h
│ │ ├── g2o_types_slam2d_addons_api.h
│ │ ├── line_2d.h
│ │ ├── types_slam2d_addons.cpp
│ │ ├── types_slam2d_addons.h
│ │ ├── vertex_line2d.cpp
│ │ ├── vertex_line2d.h
│ │ ├── vertex_segment2d.cpp
│ │ └── vertex_segment2d.h
│ ├── slam3d
│ │ ├── CMakeLists.txt
│ │ ├── dquat2mat.cpp
│ │ ├── dquat2mat.h
│ │ ├── dquat2mat.wxm
│ │ ├── dquat2mat_maxima_generated.cpp
│ │ ├── edge_pointxyz.cpp
│ │ ├── edge_pointxyz.h
│ │ ├── edge_se3.cpp
│ │ ├── edge_se3.h
│ │ ├── edge_se3_lotsofxyz.cpp
│ │ ├── edge_se3_lotsofxyz.h
│ │ ├── edge_se3_offset.cpp
│ │ ├── edge_se3_offset.h
│ │ ├── edge_se3_pointxyz.cpp
│ │ ├── edge_se3_pointxyz.h
│ │ ├── edge_se3_pointxyz_depth.cpp
│ │ ├── edge_se3_pointxyz_depth.h
│ │ ├── edge_se3_pointxyz_disparity.cpp
│ │ ├── edge_se3_pointxyz_disparity.h
│ │ ├── edge_se3_prior.cpp
│ │ ├── edge_se3_prior.h
│ │ ├── g2o_types_slam3d_api.h
│ │ ├── isometry3d_gradients.cpp
│ │ ├── isometry3d_gradients.h
│ │ ├── isometry3d_mappings.cpp
│ │ ├── isometry3d_mappings.h
│ │ ├── parameter_camera.cpp
│ │ ├── parameter_camera.h
│ │ ├── parameter_se3_offset.cpp
│ │ ├── parameter_se3_offset.h
│ │ ├── parameter_stereo_camera.cpp
│ │ ├── parameter_stereo_camera.h
│ │ ├── se3_ops.h
│ │ ├── se3_ops.hpp
│ │ ├── se3quat.h
│ │ ├── test_isometry3d_mappings.cpp
│ │ ├── test_mat2quat_jacobian.cpp
│ │ ├── test_slam3d_jacobian.cpp
│ │ ├── types_slam3d.cpp
│ │ ├── types_slam3d.h
│ │ ├── vertex_pointxyz.cpp
│ │ ├── vertex_pointxyz.h
│ │ ├── vertex_se3.cpp
│ │ └── vertex_se3.h
│ └── slam3d_addons
│ │ ├── CMakeLists.txt
│ │ ├── edge_line3d.cpp
│ │ ├── edge_line3d.h
│ │ ├── edge_plane.cpp
│ │ ├── edge_plane.h
│ │ ├── edge_se3_calib.cpp
│ │ ├── edge_se3_calib.h
│ │ ├── edge_se3_euler.cpp
│ │ ├── edge_se3_euler.h
│ │ ├── edge_se3_line.cpp
│ │ ├── edge_se3_line.h
│ │ ├── edge_se3_plane_calib.cpp
│ │ ├── edge_se3_plane_calib.h
│ │ ├── g2o_types_slam3d_addons_api.h
│ │ ├── line3d.cpp
│ │ ├── line3d.h
│ │ ├── line3d_test.cpp
│ │ ├── plane3d.h
│ │ ├── types_slam3d_addons.cpp
│ │ ├── types_slam3d_addons.h
│ │ ├── vertex_line3d.cpp
│ │ ├── vertex_line3d.h
│ │ ├── vertex_plane.cpp
│ │ ├── vertex_plane.h
│ │ ├── vertex_se3_euler.cpp
│ │ └── vertex_se3_euler.h
└── what_is_in_these_directories.txt
└── script
├── android.toolchain.cmake
├── install-deps-linux.sh
└── install-deps-osx.sh
/ORB_SLAM2_modified/Examples/Monocular/mono_kitti:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/Monocular/mono_kitti
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/Monocular/mono_tum:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/Monocular/mono_tum
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/RGB-D/rgbd_cc:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/RGB-D/rgbd_cc
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/RGB-D/rgbd_tum:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/RGB-D/rgbd_tum
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/Mono:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/Mono
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/Pose_transform:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/Pose_transform
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/RGBD:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/RGBD
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/launch/Octomap.launch:
--------------------------------------------------------------------------------
1 |
9 |
10 |
11 |
12 |
13 |
14 |
15 |
16 |
17 |
18 |
19 |
20 |
21 |
22 |
26 |
27 |
28 |
29 |
30 |
31 |
32 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/launch/move_base.launch:
--------------------------------------------------------------------------------
1 |
2 |
3 |
4 |
5 |
6 |
7 |
8 |
9 |
10 |
11 |
12 |
13 |
14 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/launch/transform.launch:
--------------------------------------------------------------------------------
1 |
2 |
3 |
4 |
5 |
6 |
7 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/manifest.xml:
--------------------------------------------------------------------------------
1 |
2 |
3 |
4 | ORB_SLAM2
5 |
6 |
7 | Raul Mur-Artal
8 | GPLv3
9 |
10 |
11 |
12 |
13 |
14 |
15 |
16 |
17 |
18 |
19 |
20 |
21 |
22 |
23 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/orb_octomap:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/orb_octomap
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/params/base_local_planner_params.yaml:
--------------------------------------------------------------------------------
1 | TrajectoryPlannerROS:
2 | max_vel_x: 0.45
3 | min_vel_x: 0.1
4 | max_vel_theta: 1.0
5 | min_in_place_vel_theta: 0.4
6 |
7 | acc_lim_theta: 3.2
8 | acc_lim_x: 2.5
9 | acc_lim_y: 2.5
10 |
11 | holonomic_robot: true
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/params/costmap_common_params.yaml:
--------------------------------------------------------------------------------
1 | map_type: costmap
2 | origin_z: 0.0
3 | z_resolution: 0.2
4 | z_voxels: 2
5 |
6 | obstacle_range: 2.5
7 | raytrace_range: 3.0
8 |
9 | publish_voxel_map: false
10 | transform_tolerance: 0.5
11 | meter_scoring: true
12 |
13 | footprint: [[-0.21, -0.165], [-0.21, 0.165], [0.21, 0.165], [0.21, -0.165]]
14 | footprint_padding: 0.1
15 |
16 | #plugins:
17 | #- {name: obstacles_layer, type: "costmap_2d::ObstacleLayer"}
18 | #- {name: inflater_layer, type: "costmap_2d::InflationLayer"}
19 |
20 | obstacles_layer:
21 | observation_sources: point_cloud_sensor
22 | point_cloud_sensor: {sensor_frame: /map, data_type: PointCloud2, topic: /pclPoint_out, marking: true, clearing: true, min_obstacle_height: 0.15, max_obstacle_height: 1.0}
23 |
24 | inflater_layer:
25 | inflation_radius: 0.05
26 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/params/global_costmap_params.yaml:
--------------------------------------------------------------------------------
1 | global_costmap:
2 | map_topic: /projected_map
3 | global_frame: /map
4 | robot_base_frame: /base_link
5 | update_frequency: 1.0
6 | publish_frequency: 0.5
7 | static_map: true
8 | transform_tolerance: 0.5
9 | resolution: 0.05
10 | inflation_radius: 0.1
11 | cost_scaling_factor: 2.0
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/params/local_costmap_params.yaml:
--------------------------------------------------------------------------------
1 | local_costmap:
2 | global_frame: /odom
3 | robot_base_frame: /base_link
4 | update_frequency: 20.0
5 | publish_frequency: 5.0
6 | width: 10.0
7 | height: 10.0
8 | resolution: 0.05
9 | static_map: false
10 | rolling_window: true
11 | resolution: 0.05
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/params/move_base_params.yaml:
--------------------------------------------------------------------------------
1 | shutdown_costmaps: false
2 |
3 | controller_frequency: 20.0
4 | controller_patience: 15.0
5 |
6 | planner_frequency: 20.0
7 | planner_patience: 5.0
8 |
9 | oscillation_timeout: 0.0
10 | oscillation_distance: 0.5
11 |
12 | recovery_behavior_enabled: true
13 | clearing_rotation_allowed: true
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/visual_octomap:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/ROS/ORB-SLAM2_DENSE/visual_octomap
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Examples/Stereo/stereo_kitti:
--------------------------------------------------------------------------------
https://raw.githubusercontent.com/gaochq/Navigation_using_Octomap/f6b066af063d5daa54fa0477a23b96edede7a3e4/ORB_SLAM2_modified/Examples/Stereo/stereo_kitti
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/LICENSE.txt:
--------------------------------------------------------------------------------
1 | ORB-SLAM2 is released under a GPLv3 license (see License-gpl.txt).
2 | Please see Dependencies.md for a list of all included code and library dependencies which are not property of the authors of ORB-SLAM2.
3 |
4 | For a closed-source version of ORB-SLAM2 for commercial purposes, please contact the authors.
5 |
6 | If you use ORB-SLAM in an academic work, please cite the most relevant publication associated by visiting:
7 | https://github.com/raulmur/ORB_SLAM2
8 |
9 |
10 |
11 |
12 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/ORB_SLAM2_modified.kdev4:
--------------------------------------------------------------------------------
1 | [Project]
2 | Manager=KDevCMakeManager
3 | Name=ORB_SLAM2_modified
4 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Thirdparty/DBoW2/CMakeLists.txt:
--------------------------------------------------------------------------------
1 | cmake_minimum_required(VERSION 2.8)
2 | project(DBoW2)
3 |
4 | set(CMAKE_C_FLAGS "${CMAKE_C_FLAGS} -Wall -O3 -march=native ")
5 | set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -Wall -O3 -march=native")
6 |
7 | set(HDRS_DBOW2
8 | DBoW2/BowVector.h
9 | DBoW2/FORB.h
10 | DBoW2/FClass.h
11 | DBoW2/FeatureVector.h
12 | DBoW2/ScoringObject.h
13 | DBoW2/TemplatedVocabulary.h)
14 | set(SRCS_DBOW2
15 | DBoW2/BowVector.cpp
16 | DBoW2/FORB.cpp
17 | DBoW2/FeatureVector.cpp
18 | DBoW2/ScoringObject.cpp)
19 |
20 | set(HDRS_DUTILS
21 | DUtils/Random.h
22 | DUtils/Timestamp.h)
23 | set(SRCS_DUTILS
24 | DUtils/Random.cpp
25 | DUtils/Timestamp.cpp)
26 |
27 | find_package(OpenCV REQUIRED)
28 |
29 | set(LIBRARY_OUTPUT_PATH ${PROJECT_SOURCE_DIR}/lib)
30 |
31 | include_directories(${OpenCV_INCLUDE_DIRS})
32 | add_library(DBoW2 SHARED ${SRCS_DBOW2} ${SRCS_DUTILS})
33 | target_link_libraries(DBoW2 ${OpenCV_LIBS})
34 |
35 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Thirdparty/DBoW2/DBoW2/FClass.h:
--------------------------------------------------------------------------------
1 | /**
2 | * File: FClass.h
3 | * Date: November 2011
4 | * Author: Dorian Galvez-Lopez
5 | * Description: generic FClass to instantiate templated classes
6 | * License: see the LICENSE.txt file
7 | *
8 | */
9 |
10 | #ifndef __D_T_FCLASS__
11 | #define __D_T_FCLASS__
12 |
13 | #include
14 | #include
15 | #include
16 |
17 | namespace DBoW2 {
18 |
19 | /// Generic class to encapsulate functions to manage descriptors.
20 | /**
21 | * This class must be inherited. Derived classes can be used as the
22 | * parameter F when creating Templated structures
23 | * (TemplatedVocabulary, TemplatedDatabase, ...)
24 | */
25 | class FClass
26 | {
27 | class TDescriptor;
28 | typedef const TDescriptor *pDescriptor;
29 |
30 | /**
31 | * Calculates the mean value of a set of descriptors
32 | * @param descriptors
33 | * @param mean mean descriptor
34 | */
35 | virtual void meanValue(const std::vector &descriptors,
36 | TDescriptor &mean) = 0;
37 |
38 | /**
39 | * Calculates the distance between two descriptors
40 | * @param a
41 | * @param b
42 | * @return distance
43 | */
44 | static double distance(const TDescriptor &a, const TDescriptor &b);
45 |
46 | /**
47 | * Returns a string version of the descriptor
48 | * @param a descriptor
49 | * @return string version
50 | */
51 | static std::string toString(const TDescriptor &a);
52 |
53 | /**
54 | * Returns a descriptor from a string
55 | * @param a descriptor
56 | * @param s string version
57 | */
58 | static void fromString(TDescriptor &a, const std::string &s);
59 |
60 | /**
61 | * Returns a mat with the descriptors in float format
62 | * @param descriptors
63 | * @param mat (out) NxL 32F matrix
64 | */
65 | static void toMat32F(const std::vector &descriptors,
66 | cv::Mat &mat);
67 | };
68 |
69 | } // namespace DBoW2
70 |
71 | #endif
72 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Thirdparty/DBoW2/DBoW2/FORB.h:
--------------------------------------------------------------------------------
1 | /**
2 | * File: FORB.h
3 | * Date: June 2012
4 | * Author: Dorian Galvez-Lopez
5 | * Description: functions for ORB descriptors
6 | * License: see the LICENSE.txt file
7 | *
8 | */
9 |
10 | #ifndef __D_T_F_ORB__
11 | #define __D_T_F_ORB__
12 |
13 | #include
14 | #include
15 | #include
16 |
17 | #include "FClass.h"
18 |
19 | namespace DBoW2 {
20 |
21 | /// Functions to manipulate ORB descriptors
22 | class FORB: protected FClass
23 | {
24 | public:
25 |
26 | /// Descriptor type
27 | typedef cv::Mat TDescriptor; // CV_8U
28 | /// Pointer to a single descriptor
29 | typedef const TDescriptor *pDescriptor;
30 | /// Descriptor length (in bytes)
31 | static const int L;
32 |
33 | /**
34 | * Calculates the mean value of a set of descriptors
35 | * @param descriptors
36 | * @param mean mean descriptor
37 | */
38 | static void meanValue(const std::vector &descriptors,
39 | TDescriptor &mean);
40 |
41 | /**
42 | * Calculates the distance between two descriptors
43 | * @param a
44 | * @param b
45 | * @return distance
46 | */
47 | static int distance(const TDescriptor &a, const TDescriptor &b);
48 |
49 | /**
50 | * Returns a string version of the descriptor
51 | * @param a descriptor
52 | * @return string version
53 | */
54 | static std::string toString(const TDescriptor &a);
55 |
56 | /**
57 | * Returns a descriptor from a string
58 | * @param a descriptor
59 | * @param s string version
60 | */
61 | static void fromString(TDescriptor &a, const std::string &s);
62 |
63 | /**
64 | * Returns a mat with the descriptors in float format
65 | * @param descriptors
66 | * @param mat (out) NxL 32F matrix
67 | */
68 | static void toMat32F(const std::vector &descriptors,
69 | cv::Mat &mat);
70 |
71 | static void toMat8U(const std::vector &descriptors,
72 | cv::Mat &mat);
73 |
74 | };
75 |
76 | } // namespace DBoW2
77 |
78 | #endif
79 |
80 |
--------------------------------------------------------------------------------
/ORB_SLAM2_modified/Thirdparty/DBoW2/DBoW2/FeatureVector.h:
--------------------------------------------------------------------------------
1 | /**
2 | * File: FeatureVector.h
3 | * Date: November 2011
4 | * Author: Dorian Galvez-Lopez
5 | * Description: feature vector
6 | * License: see the LICENSE.txt file
7 | *
8 | */
9 |
10 | #ifndef __D_T_FEATURE_VECTOR__
11 | #define __D_T_FEATURE_VECTOR__
12 |
13 | #include "BowVector.h"
14 | #include