diff --git a/.gitignore b/.gitignore
new file mode 100644
index 0000000..b0f3567
--- /dev/null
+++ b/.gitignore
@@ -0,0 +1,4 @@
+build
+Log/*.png
+Log/*.txt
+Log/time.pdf
diff --git a/CMakeLists.txt b/CMakeLists.txt
new file mode 100644
index 0000000..31fe073
--- /dev/null
+++ b/CMakeLists.txt
@@ -0,0 +1,85 @@
+cmake_minimum_required(VERSION 2.8.3)
+project(fast_lio)
+
+SET(CMAKE_BUILD_TYPE "Debug")
+
+ADD_COMPILE_OPTIONS(-std=c++14 )
+ADD_COMPILE_OPTIONS(-std=c++14 )
+set( CMAKE_CXX_FLAGS "-std=c++14 -O3" )
+
+add_definitions(-DROOT_DIR=\"${CMAKE_CURRENT_SOURCE_DIR}/\")
+
+set(CMAKE_C_FLAGS "${CMAKE_C_FLAGS} -fexceptions" )
+set(CMAKE_CXX_STANDARD 14)
+set(CMAKE_CXX_STANDARD_REQUIRED ON)
+set(CMAKE_CXX_EXTENSIONS OFF)
+set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} -std=c++14 -pthread -std=c++0x -std=c++14 -fexceptions")
+
+option(DEPLOY "Deploy on hardware" OFF)
+if(DEPLOY)
+ add_definitions(-DDEPLOY)
+endif(DEPLOY)
+
+find_package(OpenMP QUIET)
+set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} ${OpenMP_CXX_FLAGS}")
+set(CMAKE_C_FLAGS "${CMAKE_C_FLAGS} ${OpenMP_C_FLAGS}")
+
+find_package(PythonLibs REQUIRED)
+find_path(MATPLOTLIB_CPP_INCLUDE_DIRS "matplotlibcpp.h")
+
+find_package(catkin REQUIRED COMPONENTS
+ geometry_msgs
+ nav_msgs
+ sensor_msgs
+ roscpp
+ rospy
+ std_msgs
+ pcl_ros
+ tf
+ livox_ros_driver
+ message_generation
+ eigen_conversions
+)
+
+find_package(Eigen3 REQUIRED)
+find_package(PCL 1.8 REQUIRED)
+find_package(OpenCV REQUIRED)
+
+
+message(Eigen: ${EIGEN3_INCLUDE_DIR})
+
+include_directories(
+ ${catkin_INCLUDE_DIRS}
+ ${EIGEN3_INCLUDE_DIR}
+ ${PCL_INCLUDE_DIRS}
+ ${PYTHON_INCLUDE_DIRS}
+ include)
+
+add_message_files(
+ FILES
+ Pose6D.msg
+ States.msg
+)
+
+generate_messages(
+ DEPENDENCIES
+ geometry_msgs
+)
+
+catkin_package(
+ CATKIN_DEPENDS geometry_msgs nav_msgs roscpp rospy std_msgs message_runtime
+ DEPENDS EIGEN3 PCL OpenCV
+ INCLUDE_DIRS
+)
+
+# add_executable(imu_process src/IMU_Processing.cpp)
+# target_link_libraries(imu_process ${catkin_LIBRARIES} ${PCL_LIBRARIES})
+
+add_executable(loam_feat_extract src/feature_extract.cpp)
+target_link_libraries(loam_feat_extract ${catkin_LIBRARIES} ${PCL_LIBRARIES})
+
+add_executable(loam_laserMapping src/laserMapping.cpp)
+target_link_libraries(loam_laserMapping ${catkin_LIBRARIES} ${PCL_LIBRARIES} ${OpenCV_LIBS} ${PYTHON_LIBRARIES})
+target_include_directories(loam_laserMapping PRIVATE ${PYTHON_INCLUDE_DIRS})
+# target_compile_definitions(loam_laserMapping PRIVATE ROOT_DIR="${CMAKE_CURRENT_SOURCE_DIR}")
+
diff --git a/Log/guide.md b/Log/guide.md
new file mode 100644
index 0000000..a620293
--- /dev/null
+++ b/Log/guide.md
@@ -0,0 +1 @@
+Here saved the debug records which can be drew by the ../tools/plot.py. The record function can be found frm the MACRO: DEBUG_FILE_DIR(name) in common_lib.h.
diff --git a/README.md b/README.md
index e6fa49d..200c2fc 100644
--- a/README.md
+++ b/README.md
@@ -1,2 +1,102 @@
-# FAST_LIO
-A computationally efficient and robust LiDAR-inertial odometry (LIO) package
+## 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;
+4. Robust feature extraction;
+5. Surpports for different FOV.
+
+To know more about the details, please refer to our related paper:)
+
+**Our related paper**: our related papers are now available on arxiv:
+
+[FAST-LIO: A Fast, Robust LiDAR-inertial Odometry Package by Tightly-Coupled Iterated Kalman Filter](https://arxiv.org/abs/2010.05957)
+
+**Our related video**: Commming soon.
+
+
+

+

+
+
+## 1. Prerequisites
+### 1.1 **Ubuntu** and **ROS**
+Ubuntu >= 18.04.
+
+ROS >= Melodic. [ROS Installation](http://wiki.ros.org/ROS/Installation)
+
+### 1.2. **PCL && Eigen && openCV**
+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).
+
+OpenCV >= 3.2, Follow [openCV Installation](https://opencv.org/releases/).
+
+### 1.3. **livox_ros_driver**
+Follow [livox_ros_driver Installation](https://github.com/Livox-SDK/livox_ros_driver).
+
+
+## 2. Build
+Clone the repository and catkin_make:
+
+```
+ cd ~/catkin_ws/src
+ git clone https://github.com/XW-HKU/fast_lio.git
+ cd ..
+ catkin_make
+ source devel/setup.bash
+```
+
+*Remarks:*
+- If you want to save the pcd file please add map_file_path in launch file.
+## 3. Directly run
+### 3.1 For indoor environments and high LiDAR sample rate (20-100hz)
+Connect to your PC to Livox Avia LiDAR by following [Livox-ros-driver installation](https://github.com/Livox-SDK/livox_ros_driver), then
+```
+ ....
+ roslaunch fast_lio mapping_avia.launch
+ roslaunch livox_ros_driver livox_lidar_msg.launch
+
+```
+
+### 3.2 For outdoor environments
+Connect to your PC to Livox Avia LiDAR following [Livox-ros-driver installation](https://github.com/Livox-SDK/livox_ros_driver), then
+```
+ ....
+ roslaunch fast_lio mapping_avia_outdoor.launch
+ roslaunch livox_ros_driver livox_lidar_msg.launch
+
+```
+## 4. Rosbag Example
+### 4.1 Indoor rosbag (Livox Avia LiDAR)
+
+
+
+Download [avia_indoor_quick_shake_example1](https://drive.google.com/file/d/1SWmrwlUD5FlyA-bTr1rakIYx1GxS4xNl/view?usp=sharing) or [avia_indoor_quick_shake_example2](https://drive.google.com/file/d/1wD485CIbzZlNs4z8e20Dv2Q1q-7Gv_AT/view?usp=sharing) and then
+```
+roslaunch fast_lio mapping_avia.launch
+rosbag play YOUR_DOWNLOADED.bag
+```
+
+### 4.2 Outdoor rosbag (Livox Avia LiDAR)
+
+
+
+
+
+Download [avia_hku_main building_mapping](https://drive.google.com/file/d/1GSb9eLQuwqmgI3VWSB5ApEUhOCFG_Sv5/view?usp=sharing) and then
+```
+roslaunch fast_lio mapping_avia_outdoor.launch
+rosbag play YOUR_DOWNLOADED.bag
+```
+
+### 4.3 High-rate rosbag (Livox Avia LiDAR sampled at 100Hz)
+
+Download [high_rate_avia](https://drive.google.com/file/d/1UM6O3PRN3b730ZeuvKKT3yuOLNQuz8Yf/view?usp=sharing) and then
+```
+roslaunch fast_lio mapping_avia.launch
+rosbag play YOUR_DOWNLOADED.bag
+```
+
+## 5.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) and [Loam_Livox](https://github.com/hku-mars/loam_livox).
diff --git a/doc/avia_scan.png b/doc/avia_scan.png
new file mode 100644
index 0000000..694f9cd
Binary files /dev/null and b/doc/avia_scan.png differ
diff --git a/doc/avia_scan2.png b/doc/avia_scan2.png
new file mode 100644
index 0000000..540ce6c
Binary files /dev/null and b/doc/avia_scan2.png differ
diff --git a/doc/results/HKU_HW.png b/doc/results/HKU_HW.png
new file mode 100644
index 0000000..55061fa
Binary files /dev/null and b/doc/results/HKU_HW.png differ
diff --git a/doc/results/HKU_LG_Indoor.png b/doc/results/HKU_LG_Indoor.png
new file mode 100644
index 0000000..3755445
Binary files /dev/null and b/doc/results/HKU_LG_Indoor.png differ
diff --git a/doc/results/HKU_MB_001.png b/doc/results/HKU_MB_001.png
new file mode 100644
index 0000000..87f5e20
Binary files /dev/null and b/doc/results/HKU_MB_001.png differ
diff --git a/doc/results/HKU_MB_002.png b/doc/results/HKU_MB_002.png
new file mode 100644
index 0000000..e891fd1
Binary files /dev/null and b/doc/results/HKU_MB_002.png differ
diff --git a/doc/results/HKU_MB_map.png b/doc/results/HKU_MB_map.png
new file mode 100644
index 0000000..8f8e7b3
Binary files /dev/null and b/doc/results/HKU_MB_map.png differ
diff --git a/doc/results/Screenshot from 2020-10-15 20-33-35.png b/doc/results/Screenshot from 2020-10-15 20-33-35.png
new file mode 100644
index 0000000..6914108
Binary files /dev/null and b/doc/results/Screenshot from 2020-10-15 20-33-35.png differ
diff --git a/doc/results/Screenshot from 2020-10-15 20-35-46.png b/doc/results/Screenshot from 2020-10-15 20-35-46.png
new file mode 100644
index 0000000..9306b61
Binary files /dev/null and b/doc/results/Screenshot from 2020-10-15 20-35-46.png differ
diff --git a/doc/results/Screenshot from 2020-10-15 20-37-48.png b/doc/results/Screenshot from 2020-10-15 20-37-48.png
new file mode 100644
index 0000000..972f8c8
Binary files /dev/null and b/doc/results/Screenshot from 2020-10-15 20-37-48.png differ
diff --git a/doc/results/indoor_loam.png b/doc/results/indoor_loam.png
new file mode 100644
index 0000000..4d8888a
Binary files /dev/null and b/doc/results/indoor_loam.png differ
diff --git a/doc/results/indoor_loam_imu.png b/doc/results/indoor_loam_imu.png
new file mode 100644
index 0000000..3de8f7e
Binary files /dev/null and b/doc/results/indoor_loam_imu.png differ
diff --git a/doc/results/indoor_our.png b/doc/results/indoor_our.png
new file mode 100644
index 0000000..236d074
Binary files /dev/null and b/doc/results/indoor_our.png differ
diff --git a/doc/results/long_corrid.png b/doc/results/long_corrid.png
new file mode 100644
index 0000000..a69887e
Binary files /dev/null and b/doc/results/long_corrid.png differ
diff --git a/doc/results/uav2_path.png b/doc/results/uav2_path.png
new file mode 100644
index 0000000..817c02d
Binary files /dev/null and b/doc/results/uav2_path.png differ
diff --git a/doc/results/uav2_test_map.png b/doc/results/uav2_test_map.png
new file mode 100644
index 0000000..90809fe
Binary files /dev/null and b/doc/results/uav2_test_map.png differ
diff --git a/doc/results/uav_lg.png b/doc/results/uav_lg.png
new file mode 100644
index 0000000..29a0c12
Binary files /dev/null and b/doc/results/uav_lg.png differ
diff --git a/doc/results/uav_lg_0.png b/doc/results/uav_lg_0.png
new file mode 100644
index 0000000..18bad57
Binary files /dev/null and b/doc/results/uav_lg_0.png differ
diff --git a/doc/results/uav_lg_2.png b/doc/results/uav_lg_2.png
new file mode 100644
index 0000000..499b50e
Binary files /dev/null and b/doc/results/uav_lg_2.png differ
diff --git a/include/Exp_mat.h b/include/Exp_mat.h
new file mode 100644
index 0000000..84ba4f8
--- /dev/null
+++ b/include/Exp_mat.h
@@ -0,0 +1,103 @@
+#ifndef EXP_MAT_H
+#define EXP_MAT_H
+
+#include
+#include
+#include
+// #include
+
+#define SKEW_SYM_MATRX(v) 0.0,-v[2],v[1],v[2],0.0,-v[0],-v[1],v[0],0.0
+
+template
+Eigen::Matrix Exp(const Eigen::Matrix &&ang)
+{
+ T ang_norm = ang.norm();
+ Eigen::Matrix Eye3 = Eigen::Matrix::Identity();
+ if (ang_norm > 0.0000001)
+ {
+ Eigen::Matrix r_axis = ang / ang_norm;
+ Eigen::Matrix K;
+ K << SKEW_SYM_MATRX(r_axis);
+ /// Roderigous Tranformation
+ return Eye3 + std::sin(ang_norm) * K + (1.0 - std::cos(ang_norm)) * K * K;
+ }
+ else
+ {
+ return Eye3;
+ }
+}
+
+template
+Eigen::Matrix Exp(const Eigen::Matrix &ang_vel, const Ts &dt)
+{
+ T ang_vel_norm = ang_vel.norm();
+ Eigen::Matrix Eye3 = Eigen::Matrix::Identity();
+
+ if (ang_vel_norm > 0.0000001)
+ {
+ Eigen::Matrix r_axis = ang_vel / ang_vel_norm;
+ Eigen::Matrix K;
+
+ K << SKEW_SYM_MATRX(r_axis);
+
+ T r_ang = ang_vel_norm * dt;
+
+ /// Roderigous Tranformation
+ return Eye3 + std::sin(r_ang) * K + (1.0 - std::cos(r_ang)) * K * K;
+ }
+ else
+ {
+ return Eye3;
+ }
+}
+
+template
+Eigen::Matrix Exp(const T &v1, const T &v2, const T &v3)
+{
+ T &&norm = sqrt(v1 * v1 + v2 * v2 + v3 * v3);
+ Eigen::Matrix Eye3 = Eigen::Matrix::Identity();
+ if (norm > 0.00001)
+ {
+ T r_ang[3] = {v1 / norm, v2 / norm, v3 / norm};
+ Eigen::Matrix K;
+ K << SKEW_SYM_MATRX(r_ang);
+
+ /// Roderigous Tranformation
+ return Eye3 + std::sin(norm) * K + (1.0 - std::cos(norm)) * K * K;
+ }
+ else
+ {
+ return Eye3;
+ }
+}
+
+/* Logrithm of a Rotation Matrix */
+template
+Eigen::Matrix Log(const Eigen::Matrix &R)
+{
+ T &&theta = std::acos(0.5 * (R.trace() - 1));
+ Eigen::Matrix K(R(2,1) - R(1,2), R(0,2) - R(2,0), R(1,0) - R(0,1));
+ return (std::abs(theta) < 0.001) ? (0.5 * K) : (0.5 * theta / std::sin(theta) * K);
+}
+
+// template
+// cv::Mat Exp(const T &v1, const T &v2, const T &v3)
+// {
+
+// T norm = sqrt(v1 * v1 + v2 * v2 + v3 * v3);
+// cv::Mat Eye3 = cv::Mat::eye(3, 3, CV_32F);
+// if (norm > 0.0000001)
+// {
+// T r_ang[3] = {v1 / norm, v2 / norm, v3 / norm};
+// cv::Mat K = (cv::Mat_(3,3) << SKEW_SYM_MATRX(r_ang));
+
+// /// Roderigous Tranformation
+// return Eye3 + std::sin(norm) * K + (1.0 - std::cos(norm)) * K * K;
+// }
+// else
+// {
+// return Eye3;
+// }
+// }
+
+#endif
diff --git a/include/common_lib.h b/include/common_lib.h
new file mode 100644
index 0000000..933e8ee
--- /dev/null
+++ b/include/common_lib.h
@@ -0,0 +1,140 @@
+#ifndef COMMON_LIB_H
+#define COMMON_LIB_H
+
+#include
+#include
+#include
+#include
+#include
+#include
+#include
+#include
+#include
+#include
+
+
+// #define DEBUG_PRINT
+
+#define PI_M (3.14159265358)
+#define G_m_s2 (9.8099) // Gravaty const in GuangDong/China
+#define DIM_OF_STATES (18) // Dimension of states (Let Dim(SO(3)) = 3)
+#define DIM_OF_PROC_N (12) // Dimension of process noise (Let Dim(SO(3)) = 3)
+#define CUBE_LEN (6.0)
+#define LIDAR_SP_LEN (2)
+#define INIT_COV (0.0001)
+
+#define VEC_FROM_ARRAY(v) v[0],v[1],v[2]
+#define MAT_FROM_ARRAY(v) v[0],v[1],v[2],v[3],v[4],v[5],v[6],v[7],v[8]
+#define CONSTRAIN(v,min,max) ((v>min)?((v (mat.data(), mat.data() + mat.rows() * mat.cols())
+
+#define DEBUG_FILE_DIR(name) (std::string(std::string(ROOT_DIR) + "Log/"+ name))
+
+typedef fast_lio::Pose6D Pose6D;
+typedef pcl::PointXYZINormal PointType;
+typedef pcl::PointCloud PointCloudXYZI;
+
+Eigen::Matrix3d Eye3d(Eigen::Matrix3d::Identity());
+Eigen::Matrix3f Eye3f(Eigen::Matrix3f::Identity());
+Eigen::Vector3d Zero3d(0, 0, 0);
+Eigen::Vector3f Zero3f(0, 0, 0);
+// Eigen::Vector3d Lidar_offset_to_IMU(0.05512, 0.02226, 0.0297); // Horizon
+Eigen::Vector3d Lidar_offset_to_IMU(0.04165, 0.02326, -0.0284); // Avia
+
+struct MeasureGroup // Lidar data and imu dates for the curent process
+{
+ MeasureGroup()
+ {
+ this->lidar.reset(new PointCloudXYZI());
+ };
+ double lidar_beg_time;
+ PointCloudXYZI::Ptr lidar;
+ std::deque imu;
+};
+
+struct StatesGroup
+{
+ StatesGroup() {
+ this->rot_end = Eigen::Matrix3d::Identity();
+ this->pos_end = Zero3d;
+ this->vel_end = Zero3d;
+ this->bias_g = Zero3d;
+ this->bias_a = Zero3d;
+ this->gravity = Zero3d;
+ this->cov = Eigen::Matrix::Identity() * INIT_COV;
+ };
+
+ StatesGroup& operator+=(const Eigen::Matrix &state_add)
+ {
+ this->rot_end = this->rot_end * Exp(state_add(0,0), state_add(1,0), state_add(2,0));
+ this->pos_end += state_add.block<3,1>(3,0);
+ this->vel_end += state_add.block<3,1>(6,0);
+ this->bias_g += state_add.block<3,1>(9,0);
+ this->bias_a += state_add.block<3,1>(12,0);
+ this->gravity += state_add.block<3,1>(15,0);
+ return *this;
+ };
+
+ Eigen::Matrix3d rot_end; // the estimated attitude (rotation matrix) at the end lidar point
+ Eigen::Vector3d pos_end; // the estimated position at the end lidar point (world frame)
+ Eigen::Vector3d vel_end; // the estimated velocity at the end lidar point (world frame)
+ Eigen::Vector3d bias_g; // gyroscope bias
+ Eigen::Vector3d bias_a; // accelerator bias
+ Eigen::Vector3d gravity; // the estimated gravity acceleration
+ Eigen::Matrix cov; // states covariance
+};
+
+template
+T rad2deg(T radians)
+{
+ return radians * 180.0 / PI_M;
+}
+
+template
+T deg2rad(T degrees)
+{
+ return degrees * PI_M / 180.0;
+}
+
+template
+auto set_pose6d(const double t, const Eigen::Matrix &a, const Eigen::Matrix &g, \
+ const Eigen::Matrix &v, const Eigen::Matrix &p, const Eigen::Matrix &R)
+{
+ Pose6D rot_kp;
+ rot_kp.offset_time = t;
+ for (int i = 0; i < 3; i++)
+ {
+ rot_kp.acc[i] = a(i);
+ rot_kp.gyr[i] = g(i);
+ rot_kp.vel[i] = v(i);
+ rot_kp.pos[i] = p(i);
+ for (int j = 0; j < 3; j++) rot_kp.rot[i*3+j] = R(i,j);
+ }
+ // Eigen::Map(rot_kp.rot, 3,3) = R;
+ return std::move(rot_kp);
+}
+
+template
+Eigen::Matrix RotMtoEuler(const Eigen::Matrix &rot)
+{
+ T sy = sqrt(rot(0,0)*rot(0,0) + rot(1,0)*rot(1,0));
+ bool singular = sy < 1e-6;
+ T x, y, z;
+ if(!singular)
+ {
+ x = atan2(rot(2, 1), rot(2, 2));
+ y = atan2(-rot(2, 0), sy);
+ z = atan2(rot(1, 0), rot(0, 0));
+ }
+ else
+ {
+ x = atan2(-rot(1, 2), rot(1, 1));
+ y = atan2(-rot(2, 0), sy);
+ z = 0;
+ }
+ Eigen::Matrix ang(x, y, z);
+ return ang;
+}
+
+#endif
diff --git a/include/matplotlibcpp.h b/include/matplotlibcpp.h
new file mode 100644
index 0000000..6855445
--- /dev/null
+++ b/include/matplotlibcpp.h
@@ -0,0 +1,2499 @@
+#pragma once
+
+// Python headers must be included before any system headers, since
+// they define _POSIX_C_SOURCE
+#include
+
+#include
+#include