No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

loam_livox package from guyueclass repo

robot_hmi ros1_pyqt5_app class1_ros_qt_demo robot_voice xfei_robot double_arm_demo double_arm_description double_arm_moveit_config double_arm_teach marm_description marm_moveit_config marm_standardfirmata_driver fast_lio livox_ros_driver loam_livox r3live cam_laser_calib pcl_tutorials mbot_description mbot_gazebo mbot_navigation mbot_teleop hector_compressed_map_transport hector_geotiff hector_geotiff_plugins hector_imu_attitude_to_tf hector_imu_tools hector_map_server hector_map_tools hector_mapping hector_marker_drawing hector_nav_msgs hector_slam hector_slam_launch hector_trajectory_server probot_anno_moveit_config probot_demo probot_description probot_anno_ikfast_manipulator_plugin lidar_obstacle_detection qr_tf robot_vision tensorflow_object_detector vision_msgs probot_bringup industrial_core industrial_deprecated industrial_msgs industrial_robot_client industrial_robot_simulator industrial_trajectory_filters industrial_utils simple_message c800_description c800_moveit_config moveit_lerp_motion_planner learning_launch learning_parameter learning_service learning_tf learning_topic limo_base limo_bringup limo_demo limo_description limo_visions ares_description bringup racecar_description turtletrajectory fuzzypid pid_identification pid_tuning pigot_stl_model anymal_b_simple_description laikago_controller laikago_description laikago_gazebo laikago_msgs yobotics_description yobotics_gazebo yobotics_teleop mini_cheetah_urdf gazebo_pkg race_navigation teleop_twist_keyboard webots_controller webots_ros humanoid_msgs humanoid_nav_msgs op3_bringup op3_description op3_gui_demo op3_kinematics_dynamics op3_online_walking_module_msgs op3_walking_module op3_walking_module_msgs op3_webots_controller op3_webots_gui robotis_controller_msgs robotis_framework_common robotis_math

Package Summary

Tags No category tags.
Version 0.0.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/guyuehome/guyueclass.git
VCS Type git
VCS Version main
Last Updated 2024-10-11
Dev Status UNMAINTAINED
CI status No Continuous Integration
Released UNRELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This is an advanced implentation of LOAM. LOAM is described in the following paper: J. Zhang and S. Singh. LOAM: Lidar Odometry and Mapping in Real-time. Robotics: Science and Systems Conference (RSS). Berkeley, CA, July 2014.

Additional Links

No additional links.

Maintainers

  • LinJiarong

Authors

  • Ji Zhang

LOAM-Livox

A robust LiDAR Odometry and Mapping (LOAM) package for Livox-LiDAR

<img src="pics/zym_rotate.gif" width = 45% > <img src="pics/hkust_stair.gif" width = 45% >

Loam-Livox is a robust, low drift, and real time odometry and mapping package for Livox LiDARs, significant low cost and high performance LiDARs that are designed for massive industrials uses. Our package address many key issues: feature extraction and selection in a very limited FOV, robust outliers rejection, moving objects filtering, and motion distortion compensation. In addition, we also integrate other features like parallelable pipeline, point cloud management using cells and maps, loop closure, utilities for maps saving and reload, etc. To know more about the details, please refer to our related paper:)

<img src="pics/loop_4in1.png" width = 100% >

In the development of our package, we reference to LOAM, LOAM_NOTED, and A-LOAM.

Developer: Jiarong Lin

Our related paper: our related papers are now available on arxiv:

  1. Loam_livox: A fast, robust, high-precision LiDAR odometry and mapping package for LiDARs of small FoV
  2. A fast, complete, point cloud based loop closure for LiDAR odometry and mapping

Our related video: our related videos are now available on YouTube (click below images to open):

video video

1. Prerequisites

1.1 Ubuntu and ROS

Ubuntu 64-bit 16.04 or 18.04. ROS Kinetic or Melodic. ROS Installation and its additional ROS pacakge:

    sudo apt-get install ros-XXX-cv-bridge ros-XXX-tf ros-XXX-message-filters ros-XXX-image-transport

NOTICE: remember to replace “XXX” on above command as your ROS distributions, for example, if your use ROS-kinetic, the command should be:

    sudo apt-get install ros-kinetic-cv-bridge ros-kinetic-tf ros-kinetic-message-filters ros-kinetic-image-transport

1.2. Ceres Solver

Follow Ceres Installation.

1.3. PCL

Follow PCL Installation.

NOTICE: Recently, we find that the point cloud output form the voxelgrid filter vary form PCL 1.7 and 1.9, and PCL 1.7 leads some failure in some of our examples (issue #28). By this, we strongly recommand you to use update your PCL as version 1.9 if you are using the lower version.

2. Build

Clone the repository and catkin_make:

    cd ~/catkin_ws/src
    git clone https://github.com/hku-mars/loam_livox.git
    cd ../
    catkin_make
    source ~/catkin_ws/devel/setup.bash

3. Directly run

Connect to your PC to Livox LiDAR (mid-40) by following Livox-ros-driver installation, then

    roslaunch loam_livox livox.launch

4. Rosbag Example

4.1. Common rosbag

Download Our recorded rosbag and then

roslaunch loam_livox rosbag.launch
rosbag play YOUR_DOWNLOADED.bag

<img src="pics/CYT_01.png" width=45% > <img src="pics/CYT_02.png" width=45% >
<img src="pics/HKU_ZYM_01.png" width=45% > <img src="pics/HKU_ZYM_02.png" width=45% >

4.1. Large-scale rosbag

For large scale rosbag (For example HKUST_01.bag ), we recommand you launch with bigger line and plane resolution (using rosbag_largescale.launch)

roslaunch loam_livox rosbag_largescale.launch
rosbag play YOUR_DOWNLOADED.bag

<img src="pics/HKUST_01.png" width=45% > <img src="pics/HKUST_02.png" width=45% >

5. Rosbag Example with loop closure enabled

5.1. Loop closure demostration

We provide a rosbag file of small size (named “loop_loop_hku_zym.bag”, Download here) for demostration:

<img src="pics/loop_simple.png" width=45% >
roslaunch loam_livox rosbag_loop_simple.launch
rosbag play YOUR_PATH/loop_simple.bag

5.2. Other examples

<img src="pics/loop_hku_main.png" width=45% > <img src="pics/loop_hku_zym.png" width=45% >

For other example (loop_loop_hku_zym.bag, loop_hku_main.bag), launch with:

roslaunch loam_livox rosbag_loop.launch
rosbag play YOUR_DOWNLOADED.bag

NOTICE: The only difference between launch files “rosbag_loop_simple.launch” and “rosbag_loop.launch” is the minimum number of keyframes (minimum_keyframe_differen) between two candidate frames of loop detection.

6. Our 3D-printable handheld device

To get our following handheld device, please go to another one of our open source reposity, all of the 3D parts are all designed of FDM printable. We also release our solidwork files so that you can freely make your own adjustments.

<img src="pics/handheld.png" width=45% > <img src="pics/system_low_cost.png" width=45% >

7.Acknowledgments

Thanks for LOAM(J. Zhang and S. Singh. LOAM: Lidar Odometry and Mapping in Real-time) LOAM, LOAM_NOTED, and A-LOAM.

8. License

The source code is released under GPLv2 license.

We are still working on improving the performance and reliability of our codes. For any technical issues, please contact me via email Jiarong Lin < ziv.lin.ljr@gmail.com >.

For commercial use, please contact Dr. Fu Zhang < fuzhang@hku.hk >

CHANGELOG
No CHANGELOG found.

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged loam_livox at Robotics Stack Exchange

No version for distro noetic. Known supported distros are highlighted in the buttons above.
No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.