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.

isaac-sim-mobile-robot-rtab-map package from isaac-sim-mobile-robot-rtab-map repo

isaac-sim-mobile-robot-rtab-map

Package Summary

Tags No category tags.
Version 0.0.0
License MIT
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Description Mapping, Navigation, and Simulation with Nvidia Isaac Sim, RTAB-Map, Navigation2 and RViz2
Checkout URI https://github.com/taherfattahi/isaac-sim-mobile-robot-rtab-map.git
VCS Type git
VCS Version master
Last Updated 2025-02-02
Dev Status UNKNOWN
CI status No Continuous Integration
Released UNRELEASED
Tags mapping nvidia slam ros2 rtab-map pathplanning navigation2 rviz2 isaac-sim omniverse
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Mapping, Navigation, and Simulation with RTAB-Map, Navigation2, RViz2, and Isaac Sim

Additional Links

No additional links.

Maintainers

  • taher fattahi

Authors

No additional authors.

Mapping, Navigation, and Simulation with Nvidia Isaac Sim, RTAB-Map, Navigation2 and RViz2

Integration of NVIDIA Isaac Sim, RTAB-Map, Navigation2, and RViz2 for autonomous navigation 🤖

Demo Video

IMAGE

Key Components

  1. Isaac Sim
    • NVIDIA’s Isaac Sim provides simulation environments to test and refine robotic applications in realistic virtual scenarios.
    • Supports physics-based simulation, synthetic data generation, and ROS2 integration for end-to-end testing of navigation and perception systems.
  2. RTAB-Map
    • Real-Time Appearance-Based Mapping (RTAB-Map) is used for simultaneous localization and mapping (SLAM). It supports 2D and 3D mapping using RGB-D sensors, LiDAR, or stereo cameras.
    • Features include loop closure detection, memory management, and real-time map updates, making it ideal for dynamic environments.
  3. Navigation2
    • The Navigation2 (Nav2) stack enables autonomous navigation for mobile robots in complex environments.
    • Includes robust path planning, obstacle avoidance, recovery behaviors, and real-time localization using techniques like AMCL and SLAM integration.
  4. RViz2
    • RViz2 is a 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.

Dependencies and Setup

sudo apt install ros-<distro-name>-rtabmap-ros

sudo apt install ros-<distro-name>-navigation2 sudo apt install ros-<distro-name>-nav2-bringup

Building the Package

After cloning this repository into your workspace’s

``` directory:

```sh
cd <your_ros2_ws>
colcon build
source install/setup.bash

Usage

  1. Isaac Simulation: Open the ros2-turtlebot.usd file located in the isaac-sim folder. Or run this command:
ISAACSIM_PYTHON script/run-sim.py

  1. Rviz2 for Visualization:
ros2 launch isaac-sim-mobile-robot-rtab-map rviz.launch.py

  1. RTAB-Map:
ros2 launch isaac-sim-mobile-robot-rtab-map rtab-map-scan.launch.py

  1. Navigation2:
ros2 launch isaac-sim-mobile-robot-rtab-map navigation2.launch.py

Launch commands individually

  1. Run the Teleop Twist Keyboard:
ros2 run teleop_twist_keyboard teleop_twist_keyboard

  1. RTAB-Map:
ros2 launch rtabmap_demos turtlebot3_scan.launch.py

  1. Initializing the Navigation Stack:
ros2 launch nav2_bringup navigation_launch.py use_sim_time:=True

  1. Opening RViz with Navigation Visualization:
ros2 launch nav2_bringup rviz_launch.py

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.
  • Robot Operating System (ROS 2 Humble)
  • ROS 2 tf2
  • ROS 2 Navigation Framework and System
  • RTAB-Map (Real-Time Appearance-Based Mapping) is a RGB-D, Stereo and Lidar Graph-Based SLAM approach based on an incremental appearance-based loop closure detector
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

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged isaac-sim-mobile-robot-rtab-map 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.