The zm robot is a autonomous mobile robot by 4 mecanum wheel driving under NVIDIA isaac sim. It has two 2D-Lidar, RGB-D camera and Imu sensor. The purpose of this project is to make it easy for people to understand the control method of Omnidirectional Wheel and the establishment of mobile robots in the environment of ROS and NVIDIA isaac sim.
- OS : Ubuntu 22.04 / Windows 10
- CPU : Intel Core i7 (7th Generation) / AMD Ryzen 5
- Cores : 4
- RAM : 32 GB
- Storage : 50GB SSD
- GPU : GeForce RTX 4080
- VRAM : 16GB
- Driver : Linux: 580.65.06 / Windows: 580.88
- ROS Humble under Ubuntu 22.04 LTS
-
Installation NVIDIA Isaac Sim
- NVIDIA Isaac Sim Install - https://docs.isaacsim.omniverse.nvidia.com/5.1.0/installation/download.html
-
Installation ros package.
$ sudo apt-get install ros-humble-ros-gz-sim ros-humble-xacro$ sudo apt-get install -y ros-humble-cartographer-ros$ sudo apt-get install -y ros-humble-navigation2$ sudo apt-get install -y ros-humble-nav2-bringup
- Open zm_robot_flat_grid.usd after launching NVIDIA Isaac Sim.
- This is a zm_robot control using a keyboard.
$ ros2 run zm_robot_teleop zm_robot_teleop_key- The zm_robot simple environment under NVIDIA Isaac Sim.
- The zm_robot create a map at simple room.
$ ros2 launch zm_robot_navigation zm_robot_cartographer.launch.py- Cartographer save map command.
$ ros2 service call /write_state cartographer_ros_msgs/srv/WriteState "{filename : '${HOME}/zm_robot_cartographer_map.pbstream'}"
$ ros2 run nav2_map_server map_saver_cli -f ~/map- The zm_robot navigation using cartographer localization.
$ ros2 launch zm_robot_navigation zm_robot_cartographer_navigation2.launch.py- The zm_robot can do navigation and aviod obstacles at warehouse using programing.
$ ros2 run zm_robot_programing zm_robot_moveThe zm_robot_move.cpp example.
import rclpy
from zm_robot_programing.zm_robot_action import zm_robot_cmd
def main(args=None):
rclpy.init(args=args)
zm_robot = zm_robot_cmd()
zm_robot.move_map(1.0, 1.0, 0.0)
zm_robot.move_map(1.0, 0.0, 0.0)
zm_robot.move_base(-1.0, 0.0, 0.0)
exit(0)
if __name__ == '__main__':
main()| Function | Description |
|---|---|
| zm_robot.move_map(x, y, theta) | zm_robot can move to designated location relative to map. |
| zm_robot.move_base(x, y, theta) | zm_robot can move to designated location relative to base. |
| Topic | Description |
|---|---|
| cmd_vel | zm_robot input to move velocity. |
| joint_states | zm_robot joint status topic. |
| odom | zm_robot odomentry topic. |
| sick_lidar0/scan | sick laser1 Laserscan. |
| sick_lidar1/scan | sick laser2 Laserscan. |
| kinect_v2/color | Kinect V2 RGB image. |
| kinect_v2/depth | Kinect V2 Depth image. |
| imu | zm_robot IMU sensor. |
Click the image below to watch the demo video:
| Branch | Description | File Creation |
|---|---|---|
| ros1-original | zm_robot original version. | July, 2020. |
| ros1 | zm_robot ros1 version for zm_robot programing simply. | July, 2021. |
| ros1-main | zm_robot ros1-main version add safety function . | August, 2021. |
| ros1-pid | zm_robot ros1-pid version using PID controller for zm_robot programing simply. | July, 2021. |
| ros2-foxy | zm_robot ros2 versoin under ROS 2 Foxy environment. | August, 2021. |
| ros2-jazzy | zm_robot ros2 versoin under ROS 2 Jazzy environment. | February, 2025. |
| ros2-isaac-sim | zm_robot ros2 versoin under ROS 2 Humble and NVIDIA isaac sim | December, 2025. |
[1]. turtlebot3_teleop. https://github.com/ROBOTIS-GIT/turtlebot3/tree/master/turtlebot3_teleop
[2]. Isaacsim ROS2 tutorial. https://docs.isaacsim.omniverse.nvidia.com/5.1.0/ros2_tutorials/index.html
[4]. Cartographer ROS2. https://ros2-industrial-workshop.readthedocs.io/en/latest/_source/navigation/ROS2-Cartographer.html
[5]. navigation2. https://github.com/ros-planning/navigation2
This repository is for your reference only. copying, patent application, academic journals are strictly prohibited.
Copyright © 2025 ZM Robotics Software Laboratory.






