All Projects → iris-ua → Iris_lama

iris-ua / Iris_lama

Licence: bsd-3-clause
LaMa - A Localization and Mapping library

Projects that are alternatives of or similar to Iris lama

Door Slam
Distributed, Online, and Outlier Resilient SLAM for Robotic Teams
Stars: ✭ 107 (-50.69%)
Mutual labels:  robotics, slam, mapping, localization
direct lidar odometry
Direct LiDAR Odometry: Fast Localization with Dense Point Clouds
Stars: ✭ 202 (-6.91%)
Mutual labels:  localization, robotics, mapping, slam
Rtabmap
RTAB-Map library and standalone application
Stars: ✭ 1,376 (+534.1%)
Mutual labels:  robotics, slam, mapping, localization
Cartographer
Cartographer is a system that provides real-time simultaneous localization and mapping (SLAM) in 2D and 3D across multiple platforms and sensor configurations.
Stars: ✭ 5,754 (+2551.61%)
Mutual labels:  robotics, slam, mapping, localization
Pythonrobotics
Python sample codes for robotics algorithms.
Stars: ✭ 13,934 (+6321.2%)
Mutual labels:  robotics, slam, mapping, localization
Kimera Vio
Visual Inertial Odometry with SLAM capabilities and 3D Mesh generation.
Stars: ✭ 741 (+241.47%)
Mutual labels:  robotics, slam, mapping, localization
Evo
Python package for the evaluation of odometry and SLAM
Stars: ✭ 1,373 (+532.72%)
Mutual labels:  robotics, slam, mapping
JuliaAutonomy
Julia sample codes for Autonomy, Robotics and Self-Driving Algorithms.
Stars: ✭ 21 (-90.32%)
Mutual labels:  localization, mapping, slam
Awesome Robotic Tooling
Tooling for professional robotic development in C++ and Python with a touch of ROS, autonomous driving and aerospace.
Stars: ✭ 1,876 (+764.52%)
Mutual labels:  robotics, slam, mapping
slam gmapping
Slam Gmapping for ROS2
Stars: ✭ 56 (-74.19%)
Mutual labels:  localization, mapping, slam
ros-vrep-slam
ROS and V-REP for Robot Mapping and Localization
Stars: ✭ 39 (-82.03%)
Mutual labels:  localization, mapping, slam
GA SLAM
🚀 SLAM for autonomous planetary rovers with global localization
Stars: ✭ 40 (-81.57%)
Mutual labels:  localization, mapping, slam
Deep Learning Localization Mapping
A collection of deep learning based localization models
Stars: ✭ 300 (+38.25%)
Mutual labels:  slam, mapping, localization
Floam
Fast LOAM: Fast and Optimized Lidar Odometry And Mapping for indoor/outdoor localization (Lidar SLAM)
Stars: ✭ 326 (+50.23%)
Mutual labels:  robotics, slam, localization
UrbanLoco
UrbanLoco: A Full Sensor Suite Dataset for Mapping and Localization in Urban Scenes
Stars: ✭ 147 (-32.26%)
Mutual labels:  localization, mapping, slam
Dynamic robot localization
Point cloud registration pipeline for robot localization and 3D perception
Stars: ✭ 339 (+56.22%)
Mutual labels:  robotics, mapping, localization
Eao Slam
[IROS 2020] EAO-SLAM: Monocular Semi-Dense Object SLAM Based on Ensemble Data Association
Stars: ✭ 95 (-56.22%)
Mutual labels:  slam, mapping
M Loam
Robust Odometry and Mapping for Multi-LiDAR Systems with Online Extrinsic Calibration
Stars: ✭ 114 (-47.47%)
Mutual labels:  robotics, slam
Se2clam
SE(2)-Constrained Localization and Mapping by Fusing Odometry and Vision (IEEE Transactions on Cybernetics 2019)
Stars: ✭ 116 (-46.54%)
Mutual labels:  robotics, slam
Dl Vision Papers
深度学习和三维视觉相关的论文
Stars: ✭ 123 (-43.32%)
Mutual labels:  slam, localization

LaMa - A Localization and Mapping library.

https://github.com/iris-ua/iris_lama

Build

Developed and maintained by Eurico Pedrosa, University of Aveiro (C) 2019.

Overview

LaMa is a C++11 software library for robotic localization and mapping developed at the Intelligent Robotics and Systems (IRIS) Laboratory from the University of Aveiro - Portugal. It includes a framework for 3D volumetric grids (for mapping), a localization algorithm based on scan matching and two SLAM solution (an Online SLAM and a Particle Filter SLAM).

The main feature is efficiency. Low computational effort and low memory usage whenever possible. The minimum viable computer to run our localization and SLAM solutions is a Raspberry Pi 3 Model B+.

Build

To build LaMa, clone it from GitHub and use CMake to build.

$ git clone https://github.com/iris-ua/iris_lama
$ cd iris_lama
$ mkdir build
$ cd build
$ cmake ..

Its only dependency is Eigen3. Note: LaMa does not provide any executable. For an example on how to use it, please take a look at our integration with ROS.

Integration with ROS

The source code contains package.xml so that it can be used as a library from external ros packages. We provide ROS nodes to run the localization and the two SLAM solutions. Please go to iris_lama_ros for more information.

Sparse-Dense Mapping (SDM)

Sparse-Dense Mapping (SDM) is a framework for efficient implementation of 3D volumetric grids. Its divides space into small dense patches addressable by a sparse data-structure. To improve memory usage each individual patch can be compressed during live operations using lossless data compression (currently lz4 and Zstandard) with low overhead. It can be a replacement for OctoMap.

Currently it has the following grid maps implemented:

  • Distance Map: It provides the distance to the closest occupied cells in the map. We provide the DynamicDistanceMap which is an implementation of the dynamic Euclidean map proposed by:

    B. Lau, C. Sprunk, and W. Burgard Efficient Grid-Based Spatial Representations for Robot Navigation in Dynamic Environments Robotics and Autonomous Systems, 61 (10), 2013, pp. 1116-1130, Elsevier

  • Occupancy Map: The most common representation of the environment used in robotics. Three (3) variants of the occupancy map are provided: a SimpleOccupancyMap where each cell has a tri-state: free, occupied or unknown: a ProbabilisticOccupancyMap that encodes the occupancy probability of each cell with logods; and a FrequencyOccupancyMap that tracks the number of times a beam hits or traverses (miss) a cell and calculates a hit/miss ratio.

For more information about SDM please read

Eurico Pedrosa, Artur Pereira, Nuno Lau
A Sparse-Dense Approach for Efficient Grid Mapping
2018 IEEE International Conference on Autonomous Robot Systems and Competitions (ICARSC)

Localization based on Scan Matching

We provide a fast scan matching approach to mobile robot localization supported by a continuous likelihood field. It can be used to provide accurate localization for robots equipped with a laser and a not so good odometry. Nevertheless, a good odometry is always recommended.

Eurico Pedrosa, Artur Pereira, Nuno Lau
Efficient Localization Based on Scan Matching with a Continuous Likelihood Field
2017 IEEE International Conference on Autonomous Robot Systems and Competitions (ICARSC)

Online SLAM

For environments without considerable loops this solution can be accurate and very efficient. It can run in real time even on a low-spec computer (we have it running on a turtlebot with a raspberry pi 3B+). It uses our localization algorithm combined with a dynamic likelihood field to incrementally build an occupancy map.

For more information please read

Eurico Pedrosa, Artur Pereira, Nuno Lau
A Non-Linear Least Squares Approach to SLAM using a Dynamic Likelihood Field
Journal of Intelligent & Robotic Systems 93 (3-4), 519-532

Multi-threaded Particle Filter SLAM

This Particle Filter SLAM is a RBPF SLAM like GMapping and it is the extension of the Online SLAM solution to multiple particles with multi-thread support. Our solution is capable of parallelizing both the localization and mapping processes. It uses a thread-pool to manage the number of working threads.

Even without multi-threading, our solutions is a lightweight competitor against the heavyweight GMapping.

For more information please read

Eurico Pedrosa, Artur Pereira, Nuno Lau
Fast Grid SLAM Based on Particle Filter with Scan Matching and Multithreading
2020 IEEE International Conference on Autonomous Robot Systems and Competitions (ICARSC), Ponta Delgada, Portugal, 2020, pp. 194-199, doi: 10.1109/ICARSC49921.2020.9096191.

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].