Hello everyone! I want to use a camera on my plane, but I’m new to Gazebo and have been trying it out for about two weeks. Almost all resources focus on drones, but that’s not what I need. I just want to add a camera to my plane and do some image processing (openCV).
For example, u use ROS2 Jazzy
Go to ur model.sdf file
then in sensor sector add something like this
Use this commands
source /opt/ros/jazzy/setup.bash
ros2 run ros_gz_bridge parameter_bridge /yuor_camera123@sensor_msgs/msg/Image@gz.msgs.Image
After that u can use ur virtual camera via code