Skip to content

Commit

Permalink
Update gazebo_usv_dynamics_plugin.cpp (#492)
Browse files Browse the repository at this point in the history
  • Loading branch information
xdwgood authored May 21, 2020
1 parent 4acd679 commit ab527bf
Showing 1 changed file with 2 additions and 5 deletions.
7 changes: 2 additions & 5 deletions src/gazebo_usv_dynamics_plugin.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -247,11 +247,8 @@ void UsvDynamicsPlugin::Update()

// Vehicle frame transform
ignition::math::Quaterniond vq(kEuler.X(), kEuler.Y(), kEuler.Z());
#if GAZEBO_MAJOR_VERSION >= 8
ignition::math::Matrix4 xformV(vq);
#else
ignition::math::Matrix4<double> xformV(vq);
#endif

ignition::math::Matrix4<double> xformV(vq);

// Sum all forces - in body frame
const Eigen::VectorXd kForceSum = kAmassVec + kDvec;
Expand Down

0 comments on commit ab527bf

Please sign in to comment.