This project provides a simulation environment for testing a rover connected to a multimodal model. The setup utilizes Gazebo for simulation and ROS 2 for communication.
Make sure you have the following installed:
- Gazebo
- ROS 2 (Jazzy)
- ros_gz_bridge
-
Launch Gazebo
Start the simulation environment with the following command:gz sim building_robot.sdf
-
Start the ROS Bridge
Create a bridge between ROS 2 and Gazebo to facilitate communication. Run the command:ros2 run ros_gz_bridge parameter_bridge /camera_sensor/image_raw@sensor_msgs/msg/[email protected]
-
Subscribe to Camera Feed
Finally, run the ROS node that subscribes to the camera sensor output:ros2 run camera_subscriber camera_subscriber_node
-
Visualize the Output
Use a visualization tool to monitor the camera sensor data published to the topic:rqt_image_view /camera_sensor/image_raw
Feel free to fork the repository and submit pull requests for improvements or new features.
This project is licensed under the MIT License.