PX4 / PX4-SITL_gazebo-classic

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.

Home Page:http://dev.px4.io/simulation-gazebo.html

Geek Repo:Geek Repo

Github PK Tool:Github PK Tool

check sweep (angle between velI and lift-drag-plane)

mengchaoheng opened this issue · comments

Why does this line use the asin function instead of acos?

  // check sweep (angle between velI and lift-drag-plane)
  double sinSweepAngle = ignition::math::clamp(
      spanwiseI.Dot(velI), minRatio, maxRatio);

  this->sweep = asin(sinSweepAngle);

this->sweep = asin(sinSweepAngle);

@mengchaoheng Why should it use cos?

o, I get it. thanks !