By Caian Benedicto
Summary
This video walks through the complete setup and usage of NVIDIA Isaac Sim
with ROS 2
for SLAM
and autonomous navigation
. It covers:
- Cloning and preparing the
Zero-to-SLAM
repository - Updating the system and installing
NVIDIA drivers
andCUDA
- Downloading, installing, and configuring
Omniverse
andIsaac Sim
- Setting up
Nucleus
andCache
servers - Installing and configuring
Podman
for container management - Building and testing the
Zero-to-SLAM ROS 2 container
- Installing and configuring
RQt
andjoystick control tools
- Manually driving a
Turtlebot3
inside Isaac Sim usingjoystick teleoperation
- Configuring Isaac Sim for
ROS 2 integration
and fixingROS 2 bridge visibility
- Importing the
Zero-to-SLAM Omniverse scene
intoNucleus
- Exploring the imported
robot
andAction Graph
setup - Driving the robot manually and publishing
Twist messages
- Running
SLAM
(Simultaneous Localization and Mapping) inside Omniverse - Running
RViz
,Nav2
, andSlam Toolbox
for navigation and map building - Saving, serializing, and reloading
SLAM maps
- Updating the environment dynamically and refining the
SLAM maps
with added obstacles - Running
autonomous navigation
usingNav2 goals
inside Isaac Sim