Add wind speed for sitl with gazebo

Hi

I changed windVelocityMean in PX4-Autopilot/tools/sitl_gazebo/worlds/windy.world and run the simulation with this command (HEADLESS=1 make px4_sitl gazebo_standard_vtol), but windspeed in QGC displayed about 0. Where is the problem?

@mohammad If you are running make px4_sitl gazebo_standard_vtol it is using empty.world, not windly.world

@Jaeyoung-Lim Can i add wind speed for VTOL plane? What should i do?

@mohammad,

If you want to have some wind effects you are better to add the wind plugins to your model.
You will have more controls parameters.

@AlexandreBorowczyk what is instruction for adding wind plugin? does it affect sideslip angle and measured airspeed?

@AlexandreBorowczyk That won’t work, the wind plugin is a world plugin: https://github.com/PX4/PX4-SITL_gazebo/blob/e5d0d65f9e99c9c69528bc9771f951e027abba0d/include/gazebo_wind_plugin.h#L56

@Jaeyoung-Lim Good catch, I didn’t know it changed!

can you write instruction for add windy world for VTOL ?

Run

make px4_sitl gazebo_standard_vtol__windy