Skip to content

Nvidia Isaac Sim with MOLA to enable advanced 3D LiDAR odometry and mapping

License

Notifications You must be signed in to change notification settings

taherfattahi/isaac-sim-3d-lidar-odometry-mapping

Folders and files

NameName
Last commit message
Last commit date

Latest commit

 

History

6 Commits
 
 
 
 
 
 
 
 
 
 
 
 
 
 

Repository files navigation

Isaac Sim 3D LiDAR Odometry and Mapping with MOLA

Integrating Nvidia Isaac Sim with the Modular Optimization framework for Localization and mapping (MOLA) enables advanced 3D LiDAR odometry and mapping. This combination allows for the simulation, testing, and validation of LiDAR-based SLAM algorithms within a virtual environment.

Demo Video

IMAGE

Features

  • 3D LiDAR Odometry: Accurate motion estimation using MOLA's LiDAR odometry component.

  • Mapping: Real-time 3D map generation of simulated environments.

  • Isaac Sim: Utilization of NVIDIA Isaac Sim for realistic sensor data simulation.

  • ROS 2 Integration: Seamless communication between simulation and MOLA components via ROS 2.

  • RViz2: Powerful visualization tool in the ROS2 ecosystem, offering real-time rendering of robot states, sensor data, maps, and navigation goals. Facilitates debugging and system diagnostics with an intuitive GUI.

Prerequisites

Installation

After cloning this repository into your workspace’s src directory:

  1. Clone the Repository:
git clone https://github.com/taherfattahi/isaac-sim-3d-lidar-odometry-mapping
  1. Build the Package:
cd isaac-sim-3d-lidar-odometry-mapping
colcon build
source install/setup.bash

Usage

  1. Launch Isaac Sim: Open the ros2-carter.usd file located in the isaac-sim folder. Or run this command:
ISAACSIM_PYTHON script/run-sim.py
  1. Run MOLA LiDAR Odometry:
ros2 launch mola_lidar_odometry ros2-lidar-odometry.launch.py lidar_topic_name:=/point_cloud
  1. Run the Teleop Twist Keyboard:
ros2 run teleop_twist_keyboard teleop_twist_keyboard

Contributing

Contributions are welcome. If you find a bug or have a feature request, please open an issue or submit a pull request.

Resources

  • Nvidia Isaac Sim robotics developer simulation platform and reference application is designed to help developers design, simulate, test, and train AI-based robots and autonomous machines in a physically based virtual environment.
  • Modular Optimization framework for Localization and mapping MOLA
  • Robot Operating System ROS 2 Humble
  • ROS 2 tf2

About

Nvidia Isaac Sim with MOLA to enable advanced 3D LiDAR odometry and mapping

Topics

Resources

License

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published