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.
-
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.
- NVIDIA Isaac Sim: Refer to the official installation guide.
- ROS 2: Ensure ROS 2 Humble is installed.
- MOLA Framework: Follow the MOLA installation instructions.
After cloning this repository into your workspace’s src directory:
- Clone the Repository:
git clone https://github.com/taherfattahi/isaac-sim-3d-lidar-odometry-mapping
- Build the Package:
cd isaac-sim-3d-lidar-odometry-mapping
colcon build
source install/setup.bash
- 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
- Run MOLA LiDAR Odometry:
ros2 launch mola_lidar_odometry ros2-lidar-odometry.launch.py lidar_topic_name:=/point_cloud
- Run the Teleop Twist Keyboard:
ros2 run teleop_twist_keyboard teleop_twist_keyboard
Contributions are welcome. If you find a bug or have a feature request, please open an issue or submit a pull request.
- 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