Skip to content

Commit

Permalink
Copter: use 3DoF gimbal
Browse files Browse the repository at this point in the history
Signed-off-by: Rhys Mainwaring <[email protected]>
  • Loading branch information
srmainwaring committed Nov 4, 2024
1 parent f289bad commit 6da292a
Showing 1 changed file with 3 additions and 2 deletions.
5 changes: 3 additions & 2 deletions ardupilot_gz_bringup/config/iris_bridge.yaml
Original file line number Diff line number Diff line change
Expand Up @@ -24,13 +24,14 @@
ros_type_name: "tf2_msgs/msg/TFMessage"
gz_type_name: "gz.msgs.Pose_V"
direction: GZ_TO_ROS

- ros_topic_name: "camera/image"
gz_topic_name: "/world/map/model/iris/link/tilt_link/sensor/camera/image"
gz_topic_name: "/world/map/model/iris/link/pitch_link/sensor/camera/image"
ros_type_name: "sensor_msgs/msg/Image"
gz_type_name: "gz.msgs.Image"
direction: GZ_TO_ROS
- ros_topic_name: "camera/camera_info"
gz_topic_name: "/world/map/model/iris/link/tilt_link/sensor/camera/camera_info"
gz_topic_name: "/world/map/model/iris/link/pitch_link/sensor/camera/camera_info"
ros_type_name: "sensor_msgs/msg/CameraInfo"
gz_type_name: "gz.msgs.CameraInfo"
direction: GZ_TO_ROS
Expand Down

0 comments on commit 6da292a

Please sign in to comment.