ArduPilot / ardupilot_gazebo

Plugins and models for vehicle simulation in Gazebo Sim with ArduPilot SITL controllers
GNU Lesser General Public License v3.0
84 stars 81 forks source link

CameraZoomPlugin is not updating topic camera_info #110

Open srmainwaring opened 1 week ago

srmainwaring commented 1 week ago

Bug report

Issue details

The CameraZoomPlugin does not update the camera intrinsics published in the /world/{world}/model/{model}/link/{link}/sensor/{sensor}/camera_info (gz.msgs.CameraInfo) topic.

Version

Steps to replicate:

gz topic -e -t /world/playpen/model/mount/model/gimbal/link/pitch_link/sensor/camera/camera_info | grep -A12 projection
--
projection {
  p: 205.46962738037109
  p: 0
  p: 320
  p: 0
  p: 0
  p: 205.46965599060059
  p: 240
  p: 0
  p: 0
  p: 0
  p: 1
  p: 0

In another terminal change the zoom setting of the camera:

gz topic -t /model/gimbal/sensor/camera/zoom/cmd_zoom -m gz.msgs.Double -p "data: 4"

Monitor the camera_info topic and notice there is no change to the intrinsic matrix.

Platform [ x ] All [ ] AntennaTracker [ ] Copter [ ] Plane [ ] Rover [ ] Submarine