All Projects → KIT-ISAS → Lili Om

KIT-ISAS / Lili Om

Licence: gpl-3.0
LiLi-OM is a tightly-coupled, keyframe-based LiDAR-inertial odometry and mapping system for both solid-state-LiDAR and conventional LiDARs.

Projects that are alternatives of or similar to Lili Om

Mask rcnn ros
The ROS Package of Mask R-CNN for Object Detection and Segmentation
Stars: ✭ 53 (-66.67%)
Mutual labels:  ros, slam
Mrpt slam
ROS wrappers for SLAM algorithms in MRPT
Stars: ✭ 84 (-47.17%)
Mutual labels:  ros, slam
Loam velodyne
Laser Odometry and Mapping (Loam) is a realtime method for state estimation and mapping using a 3D lidar.
Stars: ✭ 1,135 (+613.84%)
Mutual labels:  ros, slam
Tf Pose Estimation
Deep Pose Estimation implemented using Tensorflow with Custom Architectures for fast inference.
Stars: ✭ 3,856 (+2325.16%)
Mutual labels:  ros, pose-estimation
Turtlebot3 simulations
Simulations for TurtleBot3
Stars: ✭ 104 (-34.59%)
Mutual labels:  ros, slam
Turtlebot3
ROS packages for Turtlebot3
Stars: ✭ 673 (+323.27%)
Mutual labels:  ros, slam
Ros Openpose
CMU's OpenPose for ROS
Stars: ✭ 81 (-49.06%)
Mutual labels:  ros, pose-estimation
Se2lam
(ICRA 2019) Visual-Odometric On-SE(2) Localization and Mapping
Stars: ✭ 285 (+79.25%)
Mutual labels:  ros, slam
Evo
Python package for the evaluation of odometry and SLAM
Stars: ✭ 1,373 (+763.52%)
Mutual labels:  ros, slam
Eao Slam
[IROS 2020] EAO-SLAM: Monocular Semi-Dense Object SLAM Based on Ensemble Data Association
Stars: ✭ 95 (-40.25%)
Mutual labels:  slam, pose-estimation
Interactive slam
Interactive Map Correction for 3D Graph SLAM
Stars: ✭ 372 (+133.96%)
Mutual labels:  ros, slam
Se2clam
SE(2)-Constrained Localization and Mapping by Fusing Odometry and Vision (IEEE Transactions on Cybernetics 2019)
Stars: ✭ 116 (-27.04%)
Mutual labels:  ros, slam
Semantic slam
Real time semantic slam in ROS with a hand held RGB-D camera
Stars: ✭ 317 (+99.37%)
Mutual labels:  ros, slam
Hdl graph slam
3D LIDAR-based Graph SLAM
Stars: ✭ 945 (+494.34%)
Mutual labels:  ros, slam
Orb slam 2 ros
A ROS implementation of ORB_SLAM2
Stars: ✭ 294 (+84.91%)
Mutual labels:  ros, slam
Lego Loam
LeGO-LOAM: Lightweight and Ground-Optimized Lidar Odometry and Mapping on Variable Terrain
Stars: ✭ 1,138 (+615.72%)
Mutual labels:  ros, slam
Camlasercalibratool
Extrinsic Calibration of a Camera and 2d Laser
Stars: ✭ 277 (+74.21%)
Mutual labels:  ros, slam
Zed Ros Wrapper
ROS wrapper for the ZED SDK
Stars: ✭ 284 (+78.62%)
Mutual labels:  ros, slam
Awesome Visual Slam
📚 The list of vision-based SLAM / Visual Odometry open source, blogs, and papers
Stars: ✭ 1,336 (+740.25%)
Mutual labels:  ros, 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 (+1079.87%)
Mutual labels:  ros, slam

LiLi-OM (LIvox LiDAR-Inertial Odometry and Mapping)

-- Towards High-Performance Solid-State-LiDAR-Inertial Odometry and Mapping

This is the code repository of LiLi-OM, a real-time tightly-coupled LiDAR-inertial odometry and mapping system for solid-state LiDAR (Livox Horizon) and conventional LiDARs (e.g., Velodyne). It has two variants as shown in the folder:

  • LiLi-OM, for Livox Horizon with a newly proposed feature extraction module,
  • LiLi-OM-ROT, for conventional LiDARs of spinning mechanism with feature extraction module similar to LOAM.

Both variants exploit the same backend module, which is proposed to directly fuse LiDAR and (preintegrated) IMU measurements based on a keyframe-based sliding window optimization. Detailed information can be found in the paper below and on Youtube.

drawing

drawing

BibTex Citation

Thank you for citing our LiLi-OM paper if you use any of this code:

@article{arXiv20_Li,
 author = {Kailai Li and Meng Li and Uwe D. Hanebeck},
 journal = {arXiv preprint arXiv:2010.13150},
 month = {October},
 title = {Towards High-Performance Solid-State-LiDAR-Inertial Odometry and Mapping},
 url = {https://arxiv.org/abs/2010.13150},
 year = {2020}
}

The work has been accepted to IEEE Robotics and Automation Letters (RA-L).

Data sets

We provide data sets recorded by Livox Horizon (10 Hz) and Xsens MTi-670 (200 Hz)

Download from isas-server or OneDrive

Dependency

System dependencies (tested on Ubuntu 18.04/20.04)

  • ROS (tested with Melodic/Noetic)
  • gtsam (GTSAM 4.0)
  • ceres (Ceres Solver 2.0)

In ROS workspce:

Compilation

Compile with catkin_tools:

cd ~/catkin_ws/src
git clone https://github.com/KIT-ISAS/lili-om
cd ..
catkin build livox_ros_driver
catkin build lili_om
catkin build lili_om_rot

Usage

  1. Run a launch file for lili_om or lili_om_rot
  2. Play the bag file
  • Example for running lili_om (Livox Horizon):
roslaunch lili_om run_fr_iosb.launch
rosbag play FR_IOSB_Short.bag -r 1.0 --clock --pause
  • Example for running lili_om_rot (spinning LiDAR like the Velodyne HDL-64E in FR_IOSB data set):
roslaunch lili_om_rot run_fr_iosb.launch
rosbag play FR_IOSB_Short_64.bag -r 1.0 --clock --pause
  • Example for running lili_om using the internal IMU of Livox Horizon:
roslaunch lili_om run_fr_iosb_internal_imu.launch
rosbag play FR_IOSB_Short.bag -r 1.0 --clock --pause --topics /livox/lidar /livox/imu

For live test or own recorded data sets, the system should start at a stationary state.

Contributors

Meng Li (Email: [email protected])

Kailai Li (Email: [email protected])

kamibukuro5656

Credits

We hereby recommend reading VINS-Fusion and LIO-mapping for reference.

License

The source code is released under GPLv3 license.

We are constantly working on improving our code. For any technical issues or commercial use, please contact Kailai Li < [email protected] > with Intelligent Sensor-Actuator-Systems Lab (ISAS), Karlsruhe Institute of Technology (KIT).

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].