2021年开源SLAM算法

article/2025/8/28 2:49:44

1.TANDEM:Tracking and Dense Mapping in Real-time using Deep Multi-view Stereo

慕尼黑工业大学Daniel Cremers团队,实时单目跟踪稠密建图纯视觉SLAM,采用Realsense D455(深度传感器+IMU,但只用RGB)
项目地址:https://vision.in.tum.de/research/vslam/tandem
论文地址:https://arxiv.org/pdf/2111.07418.pdf,https://vision.in.tum.de/_media/spezial/bib/koestler2021tandem.pdf
源码地址:https://github.com/tum-vision/tandem
在这里插入图片描述

2 . Fast Direct Stereo Visual SLAM

明尼苏达大学,快速准确立体视觉SLAM,不依赖于特征探测与匹配。作者从单目DSO扩展到双目系统,通过3D点最小光度误差优化双目配置尺度
项目地址: Interactive Robotics and Vision Lab
论文地址:https://arxiv.org/pdf/2112.01890.pdf
源码地址:https://github.com/IRVLab/direct_stereo_slam
相关工作:Direct Sparse Odometry,A Photometrically Calibrated Benchmark For Monocular Visual Odometry,
https://github.com/JakobEngel/dso

3.GVINS: tightly coupled GNSS-visual-inertial fusion for smooth and consistent state estimation

香港科技大学沈邵劼团队,之前开源VINS-Mono(https://github.com/HKUST-Aerial-Robotics/VINS-Mono),VINS-Fusion(https://github.com/HKUST-Aerial-Robotics/VINS-Fusion),GVINS是基于GNSS、视觉、惯导紧耦合多传感器融合平滑一致状态估计。

项目地址:https://uav.hkust.edu.hk/
论文地址:https://arxiv.org/pdf/2103.07899.pdf
源码地址:https://github.com/HKUST-Aerial-Robotics/GVINS
资源:http://www.rtklib.com/ 系统框架及VIO部分采用VINS-Mono,相机建模采用camodocal(https://github.com/hengli/camodocal),ceres(http://ceres-solver.org/)优化。
RTKLIB: An Open Source Program Package for GNSS Positioning,An Open Source Program Package for GNSS Positioning

4. ==DSP-SLAM:Object Oriented SLAM with Deep Shape Priors ==

伦敦大学,基于ORB-SLAM2,面向对象语义SLAM 项目地址:https://jingwenwang95.github.io/dsp-slam/

论文地址:https://arxiv.org/pdf/2108.09481v2.pdf
源码地址:https://github.com/JingwenWang95/DSP-SLAM

5.MegBA: A High-Performance and Distributed Library for Large-Scale Bundle Adjustment

爱丁堡大学、旷视科技,大规模BA算法 ,GPU分布式计算项目地址:
论文地址:https://arxiv.org/pdf/2112.01349.pdf,https://arxiv.org/pdf/2112.01349v2.pdf
源码地址:https://github.com/MegviiRobot/MegBA

6.MonoRec : Semi-Supervised Dense Reconstruction in Dynamic Environments from a Single Moving Camera

慕尼黑工业大学Daniel Cremers团队,半监督单目稠密重建纯视觉SLAM
项目地址:https://vision.in.tum.de/research/monorec
论文地址:https://arxiv.org/pdf/2011.11814.pdf
源码地址:https://github.com/Brummi/MonoRec

在这里插入图片描述

7.Range-MCL:Range Image-based LiDAR Localization for Autonomous Vehicles波恩大学 Cyrill Stachniss团队,3D LiDAR户外激光SLAM,采用Passion表面重建和蒙特卡洛定位框架

项目地址:https://www.ipb.uni-bonn.de/research/,https://www.ipb.uni-bonn.de/data-software/
论文地址:https://arxiv.org/pdf/2105.12121.pdf
源码地址:https://github.com/PRBonn/range-mcl

8.MULLS:Versatile LiDAR SLAM via Multi-metric Linear Least SquareETH

苏黎世联邦理工学院、EPFL洛桑联邦理工学院、禾赛科技
激光SLAM项目地址:https://baug.ethz.ch/en/,https://www.hesaitech.com/zh/,https://sti.epfl.ch/
论文地址:https://arxiv.org/pdf/2102.03771,https://arxiv.org/pdf/2102.03771v3
源码地址:https://github.com/YuePanEdward/MULLS

9.LiLi-OM:Towards High-Performance Solid-State-LiDAR-Inertial Odometry and Mapping KIT

德国卡尔斯鲁厄理工学院,实时紧耦合激光雷达惯性里程计SLAM,特征提取参考固态激光雷达 Livox Horizon 与机械激光雷达Velodyne A-LOAM( HKUST-Aerial-Robotics ),可先参考开源VINS-Fusion(https://github.com/HKUST-Aerial-Robotics/VINS-Fusion)和 LIO-mapping(https://github.com/hyye/lio-mapping)。
项目地址: https://isas.iar.kit.edu/
论文地址:https://arxiv.org/pdf/2010.13150.pdf,https://arxiv.org/pdf/2010.13150v3 源码地址:https://github.com/KIT-ISAS/lili-om

10.FAST-LIO2:Fast Direct LiDAR-inertial Odometry FAST-LIO: A Fast, Robust LiDAR-inertial Odometry Package by Tightly-Coupled Iterated Kalman Filter

香港大学张富团队,在FAST-LIO(高效鲁棒性LiDAR、惯性里程库,融合LiDAR特征点和IIMU数据,紧耦合快速EKF迭代)基础上采用ikd-Tree(https://github.com/hku-mars/ikd-Tree)增量建图,原始LiDAR点直接计算里程,支持外部IMU,并支持ARM平台。
项目地址:https://mars.hku.hk/
论文地址:https://arxiv.org/pdf/2107.06829.pdf,https://arxiv.org/pdf/2107.06829v1.pdf,https://arxiv.org/pdf/2010.08196v3.pdf
源码地址:https://github.com/hku-mars/FAST_LIO 相关工作 ikd-Tree: A state-of-art dynamic KD-Tree for 3D kNN search. https://github.com/hku-mars/ikd-TreeIKFOM: A Toolbox for fast and high-precision on-manifold Kalman filter. https://github.com/hku-mars/IKFoM UAV Avoiding Dynamic Obstacles: One of the implementation of FAST-LIO in robot’s planning.https://github.com/hku-mars/dyn_small_obs_avoidance R2LIVE: A high-precision LiDAR-inertial-Vision fusion work using FAST-LIO as LiDAR-inertial front-end.https://github.com/hku-mars/r2live UGV Demo: Model Predictive Control for Trajectory Tracking on Differentiable Manifolds.https://www.youtube.com/watch?v=wikgrQbE6Cs FAST-LIO-SLAM: The integration of FAST-LIO with Scan-Context loop closure module.https://github.com/gisbi-kim/FAST_LIO_SLAM FAST-LIO-LOCALIZATION: The integration of FAST-LIO with Re-localization function module.https://github.com/HViktorTsoi/FAST_LIO_LOCALIZATION

11.R3LIVE:A Robust, Real-time, RGB-colored, LiDAR-Inertial-Visual tightly-coupled state Estimation and mapping package

香港大学张富团队,在R2LIVE(FAST-LIO与VIO)基础上,LiDAR、惯导、视觉多传感器融合SLAM 项目地址:https://mars.hku.hk/
论文地址:https://arxiv.org/pdf/2109.07982.pdf,https://arxiv.org/pdf/2109.07982v1.pdf
源码地址:https://github.com/hku-mars/r3live,
(今天上传源代码) 相关工作
R2LIVE: A robust, real-time tightly-coupled multi-sensor fusion package.https://github.com/hku-mars/r2live
FAST-LIO: A computationally efficient and robust LiDAR-inertial odometry package.https://github.com/hku-mars/FAST_LIO ikd-Tree: A state-of-art dynamic KD-Tree for 3D kNN search.https://github.com/hku-mars/ikd-Tree LOAM-Livox: A robust LiDAR Odometry and Mapping (LOAM) package for Livox-LiDAR.https://github.com/hku-mars/loam_livox openMVS: A library for computer-vision scientists and especially targeted to the Multi-View Stereo reconstruction community.https://github.com/cdcseacave/openMVS VCGlib: An open source, portable, header-only Visualization and Computer Graphics Library.https://github.com/cnr-isti-vclab/vcglib CGAL: A C++ Computational Geometry Algorithms Library.https://www.cgal.org/,https://github.com/CGAL/cgal

12.LVI-SAM:Tightly-coupled Lidar-Visual-Inertial Odometry via Smoothing and Mapping

MIT麻省理工学院TixiaoShan(之前开源LIO-SAM,https://github.com/TixiaoShan/LIO-SAM),激光、视觉、惯性紧耦合多传感器融合SLAM,里程计建图系统层联合LIO-SAM与Vins-Mono优势,依赖与ROS、gtsam、Ceres库。
项目地址:https://git.io/lvi-sam,https://dusp.mit.edu/,https://senseable.mit.edu/,https://www.ams-institute.org/ 论文地址:https://arxiv.org/pdf/2104.10831.pdf,https://arxiv.org/pdf/2104.10831v2.pdf
源码地址:https://github.com/TixiaoShan/LVI-SAM

13. UV-SLAM: Unconstrained Line-based SLAM Using Vanishing Points for Structural Mapping

KAIST韩国科学技术院,采用消隐点实现无约束线特征结构化建图,克服传统线重投影测量模型中仅利用 Plücker坐标线法向量。
项目地址:Urban Robotics Lab论文地址:https://arxiv.org/pdf/2112.13515.pdf
源码地址:https://github.com/url-kaist/UV-SLAM,
源码即将上传 相关研究:Avoiding Degeneracy for Monocular Visual SLAM with Point and Line Features ALVIO: Adaptive Line and Point Feature-Based Visual Inertial Odometry for Robust Localization in Indoor Environments,源码未上传https://github.com/ankh88324/ALVIO

14. Autonomous Navigation System from Simultaneous Localization and Mapping

克拉克森大学, 基于slam室内导航软件架构,应用于智能轮椅
项目地址: 论文地址:https://arxiv.org/pdf/2112.07723.pdf,(OpenVSLAM)https://openvslam-community.readthedocs.io/_/downloads/en/latest/pdf/
源码地址:https://github.com/michealcarac/VSLAM-Mapping

15. MSC-VO: Exploiting Manhattan and Structural Constraints for Visual Odometry

巴利阿里群岛大学,基于RGB-D视觉里程计,融合点与线特征,结构化约束。
项目地址:
论文地址:https://arxiv.org/pdf/2111.03408.pdf
源码地址:GitHub - joanpepcompany/MSC-VO: This repository includes an RGB-D VO system that combines both point and line features and leverages, if exist, structural regularities and the Manhattan axes of the scene.相关工作:

16 reference


http://chatgpt.dhexx.cn/article/gt5VIDwj.shtml

相关文章

激光SLAM技术总结(3)3D激光SLAM算法原理

目录 1. 3D激光SLAM简介 2. 3D激光雷达SLAM 3. 高精度V-LOAM方案 4 发展趋势 1. 3D激光SLAM简介 在 3D 激光 SLAM 领域中, 由 Zhang J 等人提出的LOAM 方案,利用 3D 激光雷达采集数据, 进行基于特征点的扫描匹配, 利用非线性…

实习:slam算法的学习整理

1.odom 2.updata_odom 3.updata_laser updata_landmark 4.resample pf.c 相机的位姿转换是基于世界坐标系的,观察到的路标也会在世界坐标系中不断收敛,若不是计算错误,基本上不会产生漂移。而IMU是自身坐标系标定的,在转换到…

关于slam

什么是SLAM?机器人在未知环境中,要实现智能化需要完成三个任务,第一个是定位(Localization),第二个是建图(Mapping),第三个则是随后的路径规划(Navigation)。 之前地平线的高翔博士用这样一句话概括SLAM的释义。不过实际生活中的…

SLAM介绍

https://blog.csdn.net/tiandijun/article/details/55212968 SLAM 1.  前言 读者朋友们大家好!(很久很久)之前,我们为大家介绍了SLAM的基本概念和方法。相信大家对SLAM,应该有了基本的认识。在忙完一堆写论文、博…

【动态SLAM】快速入门(原理介绍及经典算法)

【动态SLAM】快速入门(原理介绍及经典算法) 0 简介1. 传统视觉SLAM技术的局限2. 常用算法:2.1 基于深度学习的分割方法2.1.1 目标检测(Object Detection)2.1.2 语义分割(INstance Segmentation)…

Visual SLAM算法笔记

MulinB按:最近在学习SLAM算法,这里作为阅读笔记记录和总结一下。这里关注的主要是基于视觉的Visual SLAM或Visual Odometry,也包括一部分图像和IMU融合的Visual-Inertial Odometry相关算法。 注:下文中部分链接指向Google Schola…

一起自学SLAM算法:8.2 Cartographer算法

连载文章,长期更新,欢迎关注: 写在前面 第1章-ROS入门必备知识 第2章-C编程范式 第3章-OpenCV图像处理 第4章-机器人传感器 第5章-机器人主机 第6章-机器人底盘 第7章-SLAM中的数学基础 第8章-激光SLAM系统 8.1 Gmapping算法 8.2 Cartographe…

开源3D激光(视觉)SLAM算法汇总(持续更新)

目录 一、Cartographer 二、hdl_graph_slam 三、LOAM 四、LeGO-LOAM 五、LIO-SAM 六、S-LOAM 七、M-LOAM 八、livox-loam 九、Livox-Mapping 十、LIO-Livox 十一、FAST-LIO2 十二、LVI-SAM 十三、FAST-Livo 十四、R3LIVE 十五、ImMesh 十六、Point-LIO 一、Car…

SLAM | 激光SLAM中开源算法对比

点击上方“AI算法修炼营”,选择加星标或“置顶” 标题以下,全是干货 前面的话 好久没有更新SLAM系列的文章了,前面我们讲到了激光SLAM技术。基于激光雷达的同时定位与地图构建技术(simultaneous localization and mapping&#xf…

激光SLAM算法学习(一)——激光SLAM简介

激光SLAM算法学习(一) 激光SLAM简介 1、SLAM是什么 SLAM是同步定位与地图构建(Simultaneous Localization And Mapping)的缩写,最早由Hugh Durrant-Whyte 和 John J.Leonard提出。SLAM主要用于解决移动机器人在未知环境中运行时定位导航与地…

SLAM算法

一、概述 Simultaneous Localization and Mapping (SLAM)原本是Robotics领域用来做机器人定位的,最早的SLAM算法其实是没有用视觉camera的(Robotics领域一般用Laser Range Finder来做SLAM)。本文主要关注基于camera图像做SLAM的算法&#xf…

SLAM算法(一)即同步定位与地图构建了解

文章目录 一、SLAM 简介二、SLAM 技术简介三、slam算法实现的几个要点有趣的事,Python永远不会缺席培训说明 一、SLAM 简介 SLAM(Simultaneous Localization and Mapping同步定位与地图构建) 是业界公认视觉领域空间定位技术的前沿方向,它主要的作用是让…

盘点机器人常用的几大主流SLAM算法

SLAM可以说是近几年最火的机器人技术之一,也是机器人领域的关键技术。不少同学表示,学了几年还在「爬坑」,甚至感觉「越学越难」。本文通过整理机器人领域常用的SLAM算法架构及特点,希望为大家的方向选择提供一些参考。 01 SLAM是…

一起自学SLAM算法:7.7 典型SLAM算法

连载文章,长期更新,欢迎关注: 写在前面 第1章-ROS入门必备知识 第2章-C编程范式 第3章-OpenCV图像处理 第4章-机器人传感器 第5章-机器人主机 第6章-机器人底盘 第7章-SLAM中的数学基础 7.1 SLAM发展简史 7.2 SLAM中的概率理论 7.3 估计理论 …

slam原理介绍和经典算法

1.传统slam局限性 slam算法假设的环境中的物体都是处于静态或者低运动状态的,然而,现实世界是复杂多变的,因此这种假设对于应用 环境有着严格的限制,同时影响视觉slam系统在实际场景中的应用性。当环境中存在动态物体时&#xff0…

【漫画】程序员系列苏大强版表情包

点击上方“ 程序IT圈 ”,选择“置顶公众号” 关键时刻,第一时间送达! 整理来源于菜鸟要飞 今天抽空给大家收集了一份苏大强版程序员系列表情包,分享给大家,希望你能够喜欢 。下面做个投票,看看你最喜欢哪个…

10 张令人泪牛满面的程序员趣图

(给程序员的那些事加星标,每天看趣图) 0、没事,我已经全部注释掉了 1、好好的现有库你不用,非得造轮子了! 2、HR 和程序员都是如何看简历的? 3、程序员的灾难曲线图 4、用钉钉子解释软件测试 5、…

[转] 程序员才懂的58张图片,哈哈哈哈哈哈哈哈哈哈哈哈哈哈哈

来源:程序员最幽默(ID:humor1024)编译配字 01 Java VS C 02 功能先上了再说 03 高级开发人员作为一个团队进行编程 04 调试CSS 05 高级开发人员重构代码 06 能一个手指完成的绝不用两只手 07 看实习生编码的时候,我的表…

趣图:程序员某场景的样子--开心一笑

几组幽默的图片,真实的解释了程序员在一些特定场景时候的样子…… 往运行服务器上直接上传文件时程序员的样 当老板说项目如果能赶在最后期限前开发完成将会有一笔奖金时程序员的样子 当凌晨3点还在修改bug时程序员的样子 当发现没有按CTRL-S就关闭了文件时程序员的…