image indisponivel no topico ros2 do drone x500_gimbal

I’m running the make px4_sitl gz_x500_gimbal command.
When running gz topic -l :
/clock
/gazebo/resource_paths
/gui/camera/pose
/gui/currently_tracked
/gui/track
/model/x500_gimbal_0/command/gimbal_pitch
/model/x500_gimbal_0/command/gimbal_roll
/model/x500_gimbal_0/command/gimbal_yaw
/model/x500_gimbal_0/command/motor_speed
/model/x500_gimbal_0/servo_0
/model/x500_gimbal_0/servo_1
/model/x500_gimbal_0/servo_2
/model/x500_gimbal_0/ servant_3
/model/x500_gimbal_0/servo_4
/model/x500_gimbal_0/servo_5
/model/x500_gimbal_0/servo_6
/model/x500_gimbal_0/servo_7
/sensors/marker
/stats
/world/default/clock
/world/default/dynamic_pose/info
/world/default/model/x500_gimbal_0/link/base_link/sensor/air_pressure_sensor/air_pressure
/world/default/model/x500_gimbal_0/link/base_link/sensor/imu_se nsor/imu
/world/default/model/x500_gimbal_0/link/base_link/sensor/magnetometer_sensor/magnetometer
/world/default/model/x500_gimbal_0/link/base_link/sensor/navsat_sensor/navsat
/world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/camera_info
/world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image
/world/default/model/x500_g imbal_0/link/camera_link/sensor/camera_imu/imu
/world/default/pose/info
/world/default/scene/deletion
/world/default/scene/info
/world/default/state
/world/default/stats
/x500_gimbal_0/command/motor_speed
/world/default/light_config
/world/default/material_color
/world/default/wrench
/world/default/wrench/clear
/world/default/wrench/persistent

I would like Having the topic /world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image in ROS 2

When running ros2 run ros_gz_bridge parameter_bridge /world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image@sensor_msgs/msg/Image[ignition.msgs.Image

I receive the following message:
[INFO] [1754055838.944122247] [ros_gz_bridge]: Creating GZ->ROS Bridge: [/world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image (ignition.msgs.Image) → /world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image (sensor_msgs/msg/Image)] (Lazy 0)

And when running: ros2 topic echo /world/default/model/x500_gimbal_0/link/camera_link/sensor/camera/image

No image is received

Can anyone help me?

I found the solution here