Skip to content

Gazebo Sim WindEffects on X500 model #121

@JacopoPan

Description

@JacopoPan

In the wind.sdf world in gz-sim examples (https://github.com/gazebosim/gz-sim/blob/gz-sim10/examples/worlds/wind.sdf), the tag <enable_wind> is introduced at the link level on each link.

In this repo, it is set in the main link of the ground_plane model only.

However, if I add the tag (set to true) to the base link of an x500 model, it does seem to result in a more intuitive behavior (i.e. hover in a non-zero wind field is tilted against the wind):

https://github.com/JacopoPan/aerial-autonomy-stack/blob/main/simulation/simulation_resources/aircraft_models/x500/model.sdf#L3-L10

  <model name='x500'>


    <pose>0 0 .24 0 0 0</pose>
    <self_collide>false</self_collide>
    <static>false</static>
    <link name="base_link">
      <enable_wind>true</enable_wind>
      <inertial>

Are wind effects otherwise applied via the plugins or only used for state estimation with the appropriate sensors?

Metadata

Metadata

Assignees

No one assigned

    Labels

    No labels
    No labels

    Type

    No type

    Projects

    No projects

    Milestone

    No milestone

    Relationships

    None yet

    Development

    No branches or pull requests

    Issue actions