From 0ec08560fe2eab92352ff43c422230aca8c9e2a6 Mon Sep 17 00:00:00 2001 From: Tae Young Kim Date: Tue, 25 Jul 2023 14:46:35 +0900 Subject: [PATCH] Add submodule and organize folders --- .gitmodules | 7 +- CMakeLists.txt => FAST_LIO/CMakeLists.txt | 0 LICENSE => FAST_LIO/LICENSE | 0 .../Log}/fast_lio_time_log_analysis.m | 0 {Log => FAST_LIO/Log}/guide.md | 0 {Log => FAST_LIO/Log}/plot.py | 0 {PCD => FAST_LIO/PCD}/1 | 0 FAST_LIO/README.md | 178 ++++++++++++++++++ {config => FAST_LIO/config}/avia.yaml | 0 {config => FAST_LIO/config}/horizon.yaml | 0 {config => FAST_LIO/config}/mid360.yaml | 0 {config => FAST_LIO/config}/ouster64.yaml | 0 {config => FAST_LIO/config}/velodyne.yaml | 0 {doc => FAST_LIO/doc}/Fast_LIO_2.pdf | Bin {doc => FAST_LIO/doc}/avia_scan.png | Bin {doc => FAST_LIO/doc}/avia_scan2.png | Bin {doc => FAST_LIO/doc}/overview_fastlio2.svg | 0 {doc => FAST_LIO/doc}/real_exp_2.png | Bin {doc => FAST_LIO/doc}/real_experiment2.gif | Bin {doc => FAST_LIO/doc}/results/HKU_HW.png | Bin .../doc}/results/HKU_LG_Indoor.png | Bin {doc => FAST_LIO/doc}/results/HKU_MB_001.png | Bin {doc => FAST_LIO/doc}/results/HKU_MB_002.png | Bin {doc => FAST_LIO/doc}/results/HKU_MB_map.png | Bin .../Screenshot from 2020-10-15 20-33-35.png | Bin .../Screenshot from 2020-10-15 20-35-46.png | Bin .../Screenshot from 2020-10-15 20-37-48.png | Bin {doc => FAST_LIO/doc}/results/indoor_loam.png | Bin .../doc}/results/indoor_loam_imu.png | Bin {doc => FAST_LIO/doc}/results/indoor_our.png | Bin {doc => FAST_LIO/doc}/results/long_corrid.png | Bin {doc => FAST_LIO/doc}/results/uav2_path.png | Bin .../doc}/results/uav2_test_map.png | Bin {doc => FAST_LIO/doc}/results/uav_lg.png | Bin {doc => FAST_LIO/doc}/results/uav_lg_0.png | Bin {doc => FAST_LIO/doc}/results/uav_lg_2.png | Bin {doc => FAST_LIO/doc}/uav01.jpg | Bin {doc => FAST_LIO/doc}/uav_ground.pdf | Bin {doc => FAST_LIO/doc}/uav_system.png | Bin {doc => FAST_LIO/doc}/ulhkwh_fastlio.gif | Bin {include => FAST_LIO/include}/Exp_mat.h | 0 .../IKFoM_toolkit/esekfom/esekfom.hpp | 0 .../include}/IKFoM_toolkit/esekfom/util.hpp | 0 .../IKFoM_toolkit/mtk/build_manifold.hpp | 0 .../IKFoM_toolkit/mtk/src/SubManifold.hpp | 0 .../IKFoM_toolkit/mtk/src/mtkmath.hpp | 0 .../IKFoM_toolkit/mtk/src/vectview.hpp | 0 .../include}/IKFoM_toolkit/mtk/startIdx.hpp | 0 .../include}/IKFoM_toolkit/mtk/types/S2.hpp | 0 .../include}/IKFoM_toolkit/mtk/types/SOn.hpp | 0 .../include}/IKFoM_toolkit/mtk/types/vect.hpp | 0 .../mtk/types/wrapped_cv_mat.hpp | 0 {include => FAST_LIO/include}/common_lib.h | 0 {include => FAST_LIO/include}/ikd-Tree | 0 {include => FAST_LIO/include}/matplotlibcpp.h | 0 {include => FAST_LIO/include}/so3_math.h | 0 {include => FAST_LIO/include}/use-ikfom.hpp | 0 .../launch}/gdb_debug_example.launch | 0 {launch => FAST_LIO/launch}/mapping.launch.py | 0 .../launch}/mapping_avia.launch | 0 .../launch}/mapping_horizon.launch | 0 .../launch}/mapping_ouster64.launch | 0 .../launch}/mapping_velodyne.launch | 0 {msg => FAST_LIO/msg}/Pose6D.msg | 0 package.xml => FAST_LIO/package.xml | 0 {rviz => FAST_LIO/rviz}/fastlio.rviz | 0 {rviz_cfg => FAST_LIO/rviz_cfg}/.gitignore | 0 .../rviz_cfg}/loam_livox.rviz | 0 {src => FAST_LIO/src}/IMU_Processing.hpp | 0 {src => FAST_LIO/src}/laserMapping.cpp | 0 {src => FAST_LIO/src}/preprocess.cpp | 0 {src => FAST_LIO/src}/preprocess.h | 0 livox_ros_driver2 | 1 + 73 files changed, 184 insertions(+), 2 deletions(-) rename CMakeLists.txt => FAST_LIO/CMakeLists.txt (100%) rename LICENSE => FAST_LIO/LICENSE (100%) rename {Log => FAST_LIO/Log}/fast_lio_time_log_analysis.m (100%) rename {Log => FAST_LIO/Log}/guide.md (100%) rename {Log => FAST_LIO/Log}/plot.py (100%) rename {PCD => FAST_LIO/PCD}/1 (100%) create mode 100644 FAST_LIO/README.md rename {config => FAST_LIO/config}/avia.yaml (100%) rename {config => FAST_LIO/config}/horizon.yaml (100%) rename {config => FAST_LIO/config}/mid360.yaml (100%) rename {config => FAST_LIO/config}/ouster64.yaml (100%) rename {config => FAST_LIO/config}/velodyne.yaml (100%) rename {doc => FAST_LIO/doc}/Fast_LIO_2.pdf (100%) rename {doc => FAST_LIO/doc}/avia_scan.png (100%) rename {doc => FAST_LIO/doc}/avia_scan2.png (100%) rename {doc => FAST_LIO/doc}/overview_fastlio2.svg (100%) rename {doc => FAST_LIO/doc}/real_exp_2.png (100%) rename {doc => FAST_LIO/doc}/real_experiment2.gif (100%) rename {doc => FAST_LIO/doc}/results/HKU_HW.png (100%) rename {doc => FAST_LIO/doc}/results/HKU_LG_Indoor.png (100%) rename {doc => FAST_LIO/doc}/results/HKU_MB_001.png (100%) rename {doc => FAST_LIO/doc}/results/HKU_MB_002.png (100%) rename {doc => FAST_LIO/doc}/results/HKU_MB_map.png (100%) rename {doc => FAST_LIO/doc}/results/Screenshot from 2020-10-15 20-33-35.png (100%) rename {doc => FAST_LIO/doc}/results/Screenshot from 2020-10-15 20-35-46.png (100%) rename {doc => FAST_LIO/doc}/results/Screenshot from 2020-10-15 20-37-48.png (100%) rename {doc => FAST_LIO/doc}/results/indoor_loam.png (100%) rename {doc => FAST_LIO/doc}/results/indoor_loam_imu.png (100%) rename {doc => FAST_LIO/doc}/results/indoor_our.png (100%) rename {doc => FAST_LIO/doc}/results/long_corrid.png (100%) rename {doc => FAST_LIO/doc}/results/uav2_path.png (100%) rename {doc => FAST_LIO/doc}/results/uav2_test_map.png (100%) rename {doc => FAST_LIO/doc}/results/uav_lg.png (100%) rename {doc => FAST_LIO/doc}/results/uav_lg_0.png (100%) rename {doc => FAST_LIO/doc}/results/uav_lg_2.png (100%) rename {doc => FAST_LIO/doc}/uav01.jpg (100%) rename {doc => FAST_LIO/doc}/uav_ground.pdf (100%) rename {doc => FAST_LIO/doc}/uav_system.png (100%) rename {doc => FAST_LIO/doc}/ulhkwh_fastlio.gif (100%) rename {include => FAST_LIO/include}/Exp_mat.h (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/esekfom/esekfom.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/esekfom/util.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/build_manifold.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/src/SubManifold.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/src/mtkmath.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/src/vectview.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/startIdx.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/types/S2.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/types/SOn.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/types/vect.hpp (100%) rename {include => FAST_LIO/include}/IKFoM_toolkit/mtk/types/wrapped_cv_mat.hpp (100%) rename {include => FAST_LIO/include}/common_lib.h (100%) rename {include => FAST_LIO/include}/ikd-Tree (100%) rename {include => FAST_LIO/include}/matplotlibcpp.h (100%) rename {include => FAST_LIO/include}/so3_math.h (100%) rename {include => FAST_LIO/include}/use-ikfom.hpp (100%) rename {launch => FAST_LIO/launch}/gdb_debug_example.launch (100%) rename {launch => FAST_LIO/launch}/mapping.launch.py (100%) rename {launch => FAST_LIO/launch}/mapping_avia.launch (100%) rename {launch => FAST_LIO/launch}/mapping_horizon.launch (100%) rename {launch => FAST_LIO/launch}/mapping_ouster64.launch (100%) rename {launch => FAST_LIO/launch}/mapping_velodyne.launch (100%) rename {msg => FAST_LIO/msg}/Pose6D.msg (100%) rename package.xml => FAST_LIO/package.xml (100%) rename {rviz => FAST_LIO/rviz}/fastlio.rviz (100%) rename {rviz_cfg => FAST_LIO/rviz_cfg}/.gitignore (100%) rename {rviz_cfg => FAST_LIO/rviz_cfg}/loam_livox.rviz (100%) rename {src => FAST_LIO/src}/IMU_Processing.hpp (100%) rename {src => FAST_LIO/src}/laserMapping.cpp (100%) rename {src => FAST_LIO/src}/preprocess.cpp (100%) rename {src => FAST_LIO/src}/preprocess.h (100%) create mode 160000 livox_ros_driver2 diff --git a/.gitmodules b/.gitmodules index b8a0efaf..eaf82ec4 100644 --- a/.gitmodules +++ b/.gitmodules @@ -1,4 +1,7 @@ -[submodule "include/ikd-Tree"] - path = include/ikd-Tree +[submodule "livox_ros_driver2"] + path = livox_ros_driver2 + url = https://github.com/Livox-SDK/livox_ros_driver2.git +[submodule "FAST_LIO/include/ikd-Tree"] + path = FAST_LIO/include/ikd-Tree url = https://github.com/hku-mars/ikd-Tree.git branch = fast_lio diff --git a/CMakeLists.txt b/FAST_LIO/CMakeLists.txt similarity index 100% rename from CMakeLists.txt rename to FAST_LIO/CMakeLists.txt diff --git a/LICENSE b/FAST_LIO/LICENSE similarity index 100% rename from LICENSE rename to FAST_LIO/LICENSE diff --git a/Log/fast_lio_time_log_analysis.m b/FAST_LIO/Log/fast_lio_time_log_analysis.m similarity index 100% rename from Log/fast_lio_time_log_analysis.m rename to FAST_LIO/Log/fast_lio_time_log_analysis.m diff --git a/Log/guide.md b/FAST_LIO/Log/guide.md similarity index 100% rename from Log/guide.md rename to FAST_LIO/Log/guide.md diff --git a/Log/plot.py b/FAST_LIO/Log/plot.py similarity index 100% rename from Log/plot.py rename to FAST_LIO/Log/plot.py diff --git a/PCD/1 b/FAST_LIO/PCD/1 similarity index 100% rename from PCD/1 rename to FAST_LIO/PCD/1 diff --git a/FAST_LIO/README.md b/FAST_LIO/README.md new file mode 100644 index 00000000..5c2df1a3 --- /dev/null +++ b/FAST_LIO/README.md @@ -0,0 +1,178 @@ +> Maintainer: Yunlong Feng + +## Related Works and Extended Application + +**SLAM:** + +1. [ikd-Tree](https://github.com/hku-mars/ikd-Tree): A state-of-art dynamic KD-Tree for 3D kNN search. +2. [R2LIVE](https://github.com/hku-mars/r2live): A high-precision LiDAR-inertial-Vision fusion work using FAST-LIO as LiDAR-inertial front-end. +3. [LI_Init](https://github.com/hku-mars/LiDAR_IMU_Init): A robust, real-time LiDAR-IMU extrinsic initialization and synchronization package.. +4. [FAST-LIO-LOCALIZATION](https://github.com/HViktorTsoi/FAST_LIO_LOCALIZATION): The integration of FAST-LIO with **Re-localization** function module. + +**Control and Plan:** + +1. [IKFOM](https://github.com/hku-mars/IKFoM): A Toolbox for fast and high-precision on-manifold Kalman filter. +2. [UAV Avoiding Dynamic Obstacles](https://github.com/hku-mars/dyn_small_obs_avoidance): One of the implementation of FAST-LIO in robot's planning. +3. [UGV Demo](https://www.youtube.com/watch?v=wikgrQbE6Cs): Model Predictive Control for Trajectory Tracking on Differentiable Manifolds. +4. [Bubble Planner](https://arxiv.org/abs/2202.12177): Planning High-speed Smooth Quadrotor Trajectories using Receding Corridors. + + + +## FAST-LIO +**FAST-LIO** (Fast LiDAR-Inertial Odometry) is a computationally efficient and robust LiDAR-inertial odometry package. It fuses LiDAR feature points with IMU data using a tightly-coupled iterated extended Kalman filter to allow robust navigation in fast-motion, noisy or cluttered environments where degeneration occurs. Our package address many key issues: +1. Fast iterated Kalman filter for odometry optimization; +2. Automaticaly initialized at most steady environments; +3. Parallel KD-Tree Search to decrease the computation; + +## FAST-LIO 2.0 (2021-07-05 Update) + + +
+ + +
+ +**Related video:** [FAST-LIO2](https://youtu.be/2OvjGnxszf8), [FAST-LIO1](https://youtu.be/iYCY6T79oNU) + +**Pipeline:** +
+ +
+ +**New Features:** +1. Incremental mapping using [ikd-Tree](https://github.com/hku-mars/ikd-Tree), achieve faster speed and over 100Hz LiDAR rate. +2. Direct odometry (scan to map) on Raw LiDAR points (feature extraction can be disabled), achieving better accuracy. +3. Since no requirements for feature extraction, FAST-LIO2 can support many types of LiDAR including spinning (Velodyne, Ouster) and solid-state (Livox Avia, Horizon, MID-70) LiDARs, and can be easily extended to support more LiDARs. +4. Support external IMU. +5. Support ARM-based platforms including Khadas VIM3, Nivida TX2, Raspberry Pi 4B(8G RAM). + +**Related papers**: + +[FAST-LIO2: Fast Direct LiDAR-inertial Odometry](doc/Fast_LIO_2.pdf) + +[FAST-LIO: A Fast, Robust LiDAR-inertial Odometry Package by Tightly-Coupled Iterated Kalman Filter](https://arxiv.org/abs/2010.08196) + +**Contributors** + +[Wei Xu 徐威](https://github.com/XW-HKU),[Yixi Cai 蔡逸熙](https://github.com/Ecstasy-EC),[Dongjiao He 贺东娇](https://github.com/Joanna-HE),[Fangcheng Zhu 朱方程](https://github.com/zfc-zfc),[Jiarong Lin 林家荣](https://github.com/ziv-lin),[Zheng Liu 刘政](https://github.com/Zale-Liu), [Borong Yuan](https://github.com/borongyuan) + + + +## 1. Prerequisites +### 1.1 **Ubuntu** and **ROS** +**Ubuntu >= 20.04** + +The **default from apt** PCL and Eigen is enough for FAST-LIO to work normally. + +ROS >= Foxy (Recommend to use ROS-Humble). [ROS Installation](https://docs.ros.org/en/humble/Installation.html) + +### 1.2. **PCL && Eigen** +PCL >= 1.8, Follow [PCL Installation](http://www.pointclouds.org/downloads/linux.html). + +Eigen >= 3.3.4, Follow [Eigen Installation](http://eigen.tuxfamily.org/index.php?title=Main_Page). + +### 1.3. **livox_ros_driver2** +Follow [livox_ros_driver2 Installation](https://github.com/Livox-SDK/livox_ros_driver2). + +*Remarks:* +- Since the FAST-LIO must support Livox serials LiDAR firstly, so the **livox_ros_driver** must be installed and **sourced** before run any FAST-LIO luanch file. +- How to source? The easiest way is add the line ``` source $Licox_ros_driver_dir$/devel/setup.bash ``` to the end of file ``` ~/.bashrc ```, where ``` $Licox_ros_driver_dir$ ``` is the directory of the livox ros driver workspace (should be the ``` ws_livox ``` directory if you completely followed the livox official document). + + +## 2. Build +Clone the repository and colcon build: + +```bash + cd /src + git clone https://github.com/hku-mars/FAST_LIO.git --recursive + cd .. + colcon build --symlink-install + . ./install/setup.bash # use setup.zsh if use zsh +``` +- Remember to source the livox_ros_driver before build (follow 1.3 **livox_ros_driver**) +- If you want to use a custom build of PCL, add the following line to ~/.bashrc +```export PCL_ROOT={CUSTOM_PCL_PATH}``` +## 3. Directly run +Noted: + +A. Please make sure the IMU and LiDAR are **Synchronized**, that's important. + +B. The warning message "Failed to find match for field 'time'." means the timestamps of each LiDAR points are missed in the rosbag file. That is important for the forward propagation and backwark propagation. + +C. We recommend to set the **extrinsic_est_en** to false if the extrinsic is give. As for the extrinsic initiallization, please refer to our recent work: [**Robust and Online LiDAR-inertial Initialization**](https://arxiv.org/abs/2202.11006). + +### 3.1 For Avia +Connect to your PC to Livox Avia LiDAR by following [Livox-ros-driver2 installation](https://github.com/Livox-SDK/livox_ros_driver2), then +```bash + cd + . install/setup.bash # use setup.zsh if use zsh + ros2 launch fast_lio mapping.launch.py + ros2 launch livox_ros_driver2 msg_MID360_launch.py +``` +- For livox serials, FAST-LIO only support the data collected by the ``` livox_lidar_msg.launch ``` since only its ``` livox_ros_driver2/CustomMsg ``` data structure produces the timestamp of each LiDAR point which is very important for the motion undistortion. ``` livox_lidar.launch ``` can not produce it right now. +- If you want to change the frame rate, please modify the **publish_freq** parameter in the [livox_lidar_msg.launch](https://github.com/Livox-SDK/livox_ros_driver/blob/master/livox_ros_driver2/launch/livox_lidar_msg.launch) of [Livox-ros-driver](https://github.com/Livox-SDK/livox_ros_driver2) before make the livox_ros_driver pakage. + +### 3.2 For Livox serials with external IMU + +mapping_avia.launch theratically supports mid-70, mid-40 or other livox serial LiDAR, but need to setup some parameters befor run: + +Edit ``` config/avia.yaml ``` to set the below parameters: + +1. LiDAR point cloud topic name: ``` lid_topic ``` +2. IMU topic name: ``` imu_topic ``` +3. Translational extrinsic: ``` extrinsic_T ``` +4. Rotational extrinsic: ``` extrinsic_R ``` (only support rotation matrix) +- The extrinsic parameters in FAST-LIO is defined as the LiDAR's pose (position and rotation matrix) in IMU body frame (i.e. the IMU is the base frame). They can be found in the official manual. +- FAST-LIO produces a very simple software time sync for livox LiDAR, set parameter ```time_sync_en``` to ture to turn on. But turn on **ONLY IF external time synchronization is really not possible**, since the software time sync cannot make sure accuracy. + +### 3.4 PCD file save + +Set ``` pcd_save_enable ``` in launchfile to ``` 1 ```. All the scans (in global frame) will be accumulated and saved to the file ``` FAST_LIO/PCD/scans.pcd ``` after the FAST-LIO is terminated. ```pcl_viewer scans.pcd``` can visualize the point clouds. + +*Tips for pcl_viewer:* +- change what to visualize/color by pressing keyboard 1,2,3,4,5 when pcl_viewer is running. +``` + 1 is all random + 2 is X values + 3 is Y values + 4 is Z values + 5 is intensity +``` + +## 4. Rosbag Example +### 4.1 Livox Avia Rosbag +
+ + + +Files: Can be downloaded from [google drive](https://drive.google.com/drive/folders/1YL5MQVYgAM8oAWUm7e3OGXZBPKkanmY1?usp=sharing) **!!!This ros1 bag should be convert to ros2!!!** + +Run: +```bash +ros2 launch fast_lio mapping.launch.py config_path:= +ros2 bag play + +``` + +### 4.2 Velodyne HDL-32E Rosbag + +**NCLT Dataset**: Original bin file can be found [here](http://robots.engin.umich.edu/nclt/). + +We produce [Rosbag Files](https://drive.google.com/drive/folders/1VBK5idI1oyW0GC_I_Hxh63aqam3nocNK?usp=sharing) and [a python script](https://drive.google.com/file/d/1leh7DxbHx29DyS1NJkvEfeNJoccxH7XM/view) to generate Rosbag files: ```python3 sensordata_to_rosbag_fastlio.py bin_file_dir bag_name.bag``` **!!!This ros1 bag should be convert to ros2!!!** + +## 5.Implementation on UAV +In order to validate the robustness and computational efficiency of FAST-LIO in actual mobile robots, we build a small-scale quadrotor which can carry a Livox Avia LiDAR with 70 degree FoV and a DJI Manifold 2-C onboard computer with a 1.8 GHz Intel i7-8550U CPU and 8 G RAM, as shown in below. + +The main structure of this UAV is 3d printed (Aluminum or PLA), the .stl file will be open-sourced in the future. + +
+ + +
+ +## 6.Acknowledgments + +Thanks for LOAM(J. Zhang and S. Singh. LOAM: Lidar Odometry and Mapping in Real-time), [Livox_Mapping](https://github.com/Livox-SDK/livox_mapping), [LINS](https://github.com/ChaoqinRobotics/LINS---LiDAR-inertial-SLAM) and [Loam_Livox](https://github.com/hku-mars/loam_livox). diff --git a/config/avia.yaml b/FAST_LIO/config/avia.yaml similarity index 100% rename from config/avia.yaml rename to FAST_LIO/config/avia.yaml diff --git a/config/horizon.yaml b/FAST_LIO/config/horizon.yaml similarity index 100% rename from config/horizon.yaml rename to FAST_LIO/config/horizon.yaml diff --git a/config/mid360.yaml b/FAST_LIO/config/mid360.yaml similarity index 100% rename from config/mid360.yaml rename to FAST_LIO/config/mid360.yaml diff --git a/config/ouster64.yaml b/FAST_LIO/config/ouster64.yaml similarity index 100% rename from config/ouster64.yaml rename to FAST_LIO/config/ouster64.yaml diff --git a/config/velodyne.yaml b/FAST_LIO/config/velodyne.yaml similarity index 100% rename from config/velodyne.yaml rename to FAST_LIO/config/velodyne.yaml diff --git a/doc/Fast_LIO_2.pdf b/FAST_LIO/doc/Fast_LIO_2.pdf similarity index 100% rename from doc/Fast_LIO_2.pdf rename to FAST_LIO/doc/Fast_LIO_2.pdf diff --git a/doc/avia_scan.png b/FAST_LIO/doc/avia_scan.png similarity index 100% rename from doc/avia_scan.png rename to FAST_LIO/doc/avia_scan.png diff --git a/doc/avia_scan2.png b/FAST_LIO/doc/avia_scan2.png similarity index 100% rename from doc/avia_scan2.png rename to FAST_LIO/doc/avia_scan2.png diff --git a/doc/overview_fastlio2.svg b/FAST_LIO/doc/overview_fastlio2.svg similarity index 100% rename from doc/overview_fastlio2.svg rename to FAST_LIO/doc/overview_fastlio2.svg diff --git a/doc/real_exp_2.png b/FAST_LIO/doc/real_exp_2.png similarity index 100% rename from doc/real_exp_2.png rename to FAST_LIO/doc/real_exp_2.png diff --git a/doc/real_experiment2.gif b/FAST_LIO/doc/real_experiment2.gif similarity index 100% rename from doc/real_experiment2.gif rename to FAST_LIO/doc/real_experiment2.gif diff --git a/doc/results/HKU_HW.png b/FAST_LIO/doc/results/HKU_HW.png similarity index 100% rename from doc/results/HKU_HW.png rename to FAST_LIO/doc/results/HKU_HW.png diff --git a/doc/results/HKU_LG_Indoor.png b/FAST_LIO/doc/results/HKU_LG_Indoor.png similarity index 100% rename from doc/results/HKU_LG_Indoor.png rename to FAST_LIO/doc/results/HKU_LG_Indoor.png diff --git a/doc/results/HKU_MB_001.png b/FAST_LIO/doc/results/HKU_MB_001.png similarity index 100% rename from doc/results/HKU_MB_001.png rename to FAST_LIO/doc/results/HKU_MB_001.png diff --git a/doc/results/HKU_MB_002.png b/FAST_LIO/doc/results/HKU_MB_002.png similarity index 100% rename from doc/results/HKU_MB_002.png rename to FAST_LIO/doc/results/HKU_MB_002.png diff --git a/doc/results/HKU_MB_map.png b/FAST_LIO/doc/results/HKU_MB_map.png similarity index 100% rename from doc/results/HKU_MB_map.png rename to FAST_LIO/doc/results/HKU_MB_map.png diff --git a/doc/results/Screenshot from 2020-10-15 20-33-35.png b/FAST_LIO/doc/results/Screenshot from 2020-10-15 20-33-35.png similarity index 100% rename from doc/results/Screenshot from 2020-10-15 20-33-35.png rename to FAST_LIO/doc/results/Screenshot from 2020-10-15 20-33-35.png diff --git a/doc/results/Screenshot from 2020-10-15 20-35-46.png b/FAST_LIO/doc/results/Screenshot from 2020-10-15 20-35-46.png similarity index 100% rename from doc/results/Screenshot from 2020-10-15 20-35-46.png rename to FAST_LIO/doc/results/Screenshot from 2020-10-15 20-35-46.png diff --git a/doc/results/Screenshot from 2020-10-15 20-37-48.png b/FAST_LIO/doc/results/Screenshot from 2020-10-15 20-37-48.png similarity index 100% rename from doc/results/Screenshot from 2020-10-15 20-37-48.png rename to FAST_LIO/doc/results/Screenshot from 2020-10-15 20-37-48.png diff --git a/doc/results/indoor_loam.png b/FAST_LIO/doc/results/indoor_loam.png similarity index 100% rename from doc/results/indoor_loam.png rename to FAST_LIO/doc/results/indoor_loam.png diff --git a/doc/results/indoor_loam_imu.png b/FAST_LIO/doc/results/indoor_loam_imu.png similarity index 100% rename from doc/results/indoor_loam_imu.png rename to FAST_LIO/doc/results/indoor_loam_imu.png diff --git a/doc/results/indoor_our.png b/FAST_LIO/doc/results/indoor_our.png similarity index 100% rename from doc/results/indoor_our.png rename to FAST_LIO/doc/results/indoor_our.png diff --git a/doc/results/long_corrid.png b/FAST_LIO/doc/results/long_corrid.png similarity index 100% rename from doc/results/long_corrid.png rename to FAST_LIO/doc/results/long_corrid.png diff --git a/doc/results/uav2_path.png b/FAST_LIO/doc/results/uav2_path.png similarity index 100% rename from doc/results/uav2_path.png rename to FAST_LIO/doc/results/uav2_path.png diff --git a/doc/results/uav2_test_map.png b/FAST_LIO/doc/results/uav2_test_map.png similarity index 100% rename from doc/results/uav2_test_map.png rename to FAST_LIO/doc/results/uav2_test_map.png diff --git a/doc/results/uav_lg.png b/FAST_LIO/doc/results/uav_lg.png similarity index 100% rename from doc/results/uav_lg.png rename to FAST_LIO/doc/results/uav_lg.png diff --git a/doc/results/uav_lg_0.png b/FAST_LIO/doc/results/uav_lg_0.png similarity index 100% rename from doc/results/uav_lg_0.png rename to FAST_LIO/doc/results/uav_lg_0.png diff --git a/doc/results/uav_lg_2.png b/FAST_LIO/doc/results/uav_lg_2.png similarity index 100% rename from doc/results/uav_lg_2.png rename to FAST_LIO/doc/results/uav_lg_2.png diff --git a/doc/uav01.jpg b/FAST_LIO/doc/uav01.jpg similarity index 100% rename from doc/uav01.jpg rename to FAST_LIO/doc/uav01.jpg diff --git a/doc/uav_ground.pdf b/FAST_LIO/doc/uav_ground.pdf similarity index 100% rename from doc/uav_ground.pdf rename to FAST_LIO/doc/uav_ground.pdf diff --git a/doc/uav_system.png b/FAST_LIO/doc/uav_system.png similarity index 100% rename from doc/uav_system.png rename to FAST_LIO/doc/uav_system.png diff --git a/doc/ulhkwh_fastlio.gif b/FAST_LIO/doc/ulhkwh_fastlio.gif similarity index 100% rename from doc/ulhkwh_fastlio.gif rename to FAST_LIO/doc/ulhkwh_fastlio.gif diff --git a/include/Exp_mat.h b/FAST_LIO/include/Exp_mat.h similarity index 100% rename from include/Exp_mat.h rename to FAST_LIO/include/Exp_mat.h diff --git a/include/IKFoM_toolkit/esekfom/esekfom.hpp b/FAST_LIO/include/IKFoM_toolkit/esekfom/esekfom.hpp similarity index 100% rename from include/IKFoM_toolkit/esekfom/esekfom.hpp rename to FAST_LIO/include/IKFoM_toolkit/esekfom/esekfom.hpp diff --git a/include/IKFoM_toolkit/esekfom/util.hpp b/FAST_LIO/include/IKFoM_toolkit/esekfom/util.hpp similarity index 100% rename from include/IKFoM_toolkit/esekfom/util.hpp rename to FAST_LIO/include/IKFoM_toolkit/esekfom/util.hpp diff --git a/include/IKFoM_toolkit/mtk/build_manifold.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/build_manifold.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/build_manifold.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/build_manifold.hpp diff --git a/include/IKFoM_toolkit/mtk/src/SubManifold.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/src/SubManifold.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/src/SubManifold.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/src/SubManifold.hpp diff --git a/include/IKFoM_toolkit/mtk/src/mtkmath.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/src/mtkmath.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/src/mtkmath.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/src/mtkmath.hpp diff --git a/include/IKFoM_toolkit/mtk/src/vectview.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/src/vectview.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/src/vectview.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/src/vectview.hpp diff --git a/include/IKFoM_toolkit/mtk/startIdx.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/startIdx.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/startIdx.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/startIdx.hpp diff --git a/include/IKFoM_toolkit/mtk/types/S2.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/types/S2.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/types/S2.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/types/S2.hpp diff --git a/include/IKFoM_toolkit/mtk/types/SOn.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/types/SOn.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/types/SOn.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/types/SOn.hpp diff --git a/include/IKFoM_toolkit/mtk/types/vect.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/types/vect.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/types/vect.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/types/vect.hpp diff --git a/include/IKFoM_toolkit/mtk/types/wrapped_cv_mat.hpp b/FAST_LIO/include/IKFoM_toolkit/mtk/types/wrapped_cv_mat.hpp similarity index 100% rename from include/IKFoM_toolkit/mtk/types/wrapped_cv_mat.hpp rename to FAST_LIO/include/IKFoM_toolkit/mtk/types/wrapped_cv_mat.hpp diff --git a/include/common_lib.h b/FAST_LIO/include/common_lib.h similarity index 100% rename from include/common_lib.h rename to FAST_LIO/include/common_lib.h diff --git a/include/ikd-Tree b/FAST_LIO/include/ikd-Tree similarity index 100% rename from include/ikd-Tree rename to FAST_LIO/include/ikd-Tree diff --git a/include/matplotlibcpp.h b/FAST_LIO/include/matplotlibcpp.h similarity index 100% rename from include/matplotlibcpp.h rename to FAST_LIO/include/matplotlibcpp.h diff --git a/include/so3_math.h b/FAST_LIO/include/so3_math.h similarity index 100% rename from include/so3_math.h rename to FAST_LIO/include/so3_math.h diff --git a/include/use-ikfom.hpp b/FAST_LIO/include/use-ikfom.hpp similarity index 100% rename from include/use-ikfom.hpp rename to FAST_LIO/include/use-ikfom.hpp diff --git a/launch/gdb_debug_example.launch b/FAST_LIO/launch/gdb_debug_example.launch similarity index 100% rename from launch/gdb_debug_example.launch rename to FAST_LIO/launch/gdb_debug_example.launch diff --git a/launch/mapping.launch.py b/FAST_LIO/launch/mapping.launch.py similarity index 100% rename from launch/mapping.launch.py rename to FAST_LIO/launch/mapping.launch.py diff --git a/launch/mapping_avia.launch b/FAST_LIO/launch/mapping_avia.launch similarity index 100% rename from launch/mapping_avia.launch rename to FAST_LIO/launch/mapping_avia.launch diff --git a/launch/mapping_horizon.launch b/FAST_LIO/launch/mapping_horizon.launch similarity index 100% rename from launch/mapping_horizon.launch rename to FAST_LIO/launch/mapping_horizon.launch diff --git a/launch/mapping_ouster64.launch b/FAST_LIO/launch/mapping_ouster64.launch similarity index 100% rename from launch/mapping_ouster64.launch rename to FAST_LIO/launch/mapping_ouster64.launch diff --git a/launch/mapping_velodyne.launch b/FAST_LIO/launch/mapping_velodyne.launch similarity index 100% rename from launch/mapping_velodyne.launch rename to FAST_LIO/launch/mapping_velodyne.launch diff --git a/msg/Pose6D.msg b/FAST_LIO/msg/Pose6D.msg similarity index 100% rename from msg/Pose6D.msg rename to FAST_LIO/msg/Pose6D.msg diff --git a/package.xml b/FAST_LIO/package.xml similarity index 100% rename from package.xml rename to FAST_LIO/package.xml diff --git a/rviz/fastlio.rviz b/FAST_LIO/rviz/fastlio.rviz similarity index 100% rename from rviz/fastlio.rviz rename to FAST_LIO/rviz/fastlio.rviz diff --git a/rviz_cfg/.gitignore b/FAST_LIO/rviz_cfg/.gitignore similarity index 100% rename from rviz_cfg/.gitignore rename to FAST_LIO/rviz_cfg/.gitignore diff --git a/rviz_cfg/loam_livox.rviz b/FAST_LIO/rviz_cfg/loam_livox.rviz similarity index 100% rename from rviz_cfg/loam_livox.rviz rename to FAST_LIO/rviz_cfg/loam_livox.rviz diff --git a/src/IMU_Processing.hpp b/FAST_LIO/src/IMU_Processing.hpp similarity index 100% rename from src/IMU_Processing.hpp rename to FAST_LIO/src/IMU_Processing.hpp diff --git a/src/laserMapping.cpp b/FAST_LIO/src/laserMapping.cpp similarity index 100% rename from src/laserMapping.cpp rename to FAST_LIO/src/laserMapping.cpp diff --git a/src/preprocess.cpp b/FAST_LIO/src/preprocess.cpp similarity index 100% rename from src/preprocess.cpp rename to FAST_LIO/src/preprocess.cpp diff --git a/src/preprocess.h b/FAST_LIO/src/preprocess.h similarity index 100% rename from src/preprocess.h rename to FAST_LIO/src/preprocess.h diff --git a/livox_ros_driver2 b/livox_ros_driver2 new file mode 160000 index 00000000..bf4d062a --- /dev/null +++ b/livox_ros_driver2 @@ -0,0 +1 @@ +Subproject commit bf4d062a2ac4030272be6fe1ee1505a4eb2ffdcb