We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 824bb21 commit 7fb4715Copy full SHA for 7fb4715
tf2_eigen/include/tf2_eigen/tf2_eigen.h
@@ -285,7 +285,7 @@ void doTransform(const Eigen::Quaterniond& t_in,
285
const geometry_msgs::msg::TransformStamped& transform) {
286
Eigen::Quaterniond t;
287
fromMsg(transform.transform.rotation, t);
288
- t_out = t.inverse() * t_in * t;
+ t_out = t * t_in;
289
}
290
291
/** \brief Convert a stamped Eigen Quaterniond type to a QuaternionStamped message.
0 commit comments