Skip to content

Moveit2 + Gazebo Co-simulation

This section explains how to perform a joint simulation of Agilebot robots using MoveIt 2 and Gazebo. Motion planning is first carried out using MoveIt 2, and the planned trajectory is then sent to Gazebo via an action interface for simulation.

Moveit2+Gazebo Co-simulation

You can combine Moveit2 and Gazebo to create complex simulation scenarios for Agilebot robots. Follow the steps below:


Terminal 1: Launch Gazebo Simulation

First, start the Gazebo simulation in one terminal window:

bash
ros2 launch <robot type>_moveit_config gazebo.launch.py

Example for C5A model:

bash
ros2 launch c5a_moveit_config gazebo.launch.py

Terminal 2: Launch Moveit2 and RViz

Then, start Moveit2 and RViz in another terminal window:

bash
ros2 launch <robot type>_moveit_config gazebo_moveit_rviz.launch.py

Example for C5A model:

bash
ros2 launch c5a_moveit_config gazebo_moveit_rviz.launch.py

This will simultaneously launch:

  • Gazebo simulation with the robot model
  • Moveit2 RViz interface for motion planning

Note:

  • Only C5A robot is currently supported for co-simulation.
  • Support for other collaborative robots is under development.
  • Users can customize configurations using Moveit2 official documentation.