PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.
http://dev.px4.io/simulation-gazebo.html
370 stars 786 forks source link

Heading or yaw command in fixed wing using ROS/Gazebo PX4 #803

Closed joaoalves10 closed 3 years ago

joaoalves10 commented 3 years ago

Hi, i am working on a project which aims to send heading/yaw commands to a fixed wing plane. Right now i am able to send waypoint commands through setpoin_raw/PosistionTarget, however when i try to use the following command: rostopic pub -r 5 /mavros/setpoint_raw/attitude mavros_msgs/AttitudeTarget "header: seq: 0 stamp: {secs: 0, nsecs: 0} frame_id: '' type_mask: 0 orientation: {x: 0.0, y: 0.0, z: 0.0, w: 0.0} body_rate: {x: 0.0, y: 0.0, z: 0.0} thrust: 0.0" i do not know what to put in the type_mask and the other parameters to control the heading or yaw. For example, i have the plane flying a certain heading, how can i command it to change its current heding? If anyone knows how it is done, or could show me an example of the command i would be grateful.

Jaeyoung-Lim commented 3 years ago

Closing as duplicate of https://github.com/PX4/PX4-SITL_gazebo/issues/806