From fa3a021507c6545d6b48fbafa0da92f8b22cb967 Mon Sep 17 00:00:00 2001 From: Bjar Ne Date: Tue, 26 Jan 2021 14:34:28 +0000 Subject: [PATCH] bullet uncrustify format --- tf2_bullet/include/tf2_bullet/tf2_bullet.h | 26 +++++++++++----------- 1 file changed, 13 insertions(+), 13 deletions(-) diff --git a/tf2_bullet/include/tf2_bullet/tf2_bullet.h b/tf2_bullet/include/tf2_bullet/tf2_bullet.h index f5d877783..6e82f34bf 100644 --- a/tf2_bullet/include/tf2_bullet/tf2_bullet.h +++ b/tf2_bullet/include/tf2_bullet/tf2_bullet.h @@ -52,25 +52,25 @@ namespace tf2 { namespace impl { -template <> +template<> struct defaultMessage { using type = geometry_msgs::msg::Point; }; -template <> +template<> struct defaultMessage { using type = geometry_msgs::msg::Quaternion; }; -template <> +template<> struct defaultMessage { using type = geometry_msgs::msg::Transform; }; -template +template struct BulletVectorImpl { /** \brief Convert a stamped Bullet Vector3 type to a PointStamped message. @@ -98,19 +98,19 @@ struct BulletVectorImpl } }; -template <> +template<> struct ImplDetails -: BulletVectorImpl + : BulletVectorImpl { }; -template <> +template<> struct ImplDetails -: BulletVectorImpl + : BulletVectorImpl { }; -template <> +template<> struct ImplDetails { static void toMsg(const btQuaternion & in, geometry_msgs::msg::Quaternion & msg) @@ -127,11 +127,11 @@ struct ImplDetails out[1] = msg.y; out[2] = msg.z; out[3] = msg.w; - if (msg.w < 0) out *= -1; + if (msg.w < 0) {out *= -1;} } }; -template <> +template<> struct ImplDetails { static void fromMsg(geometry_msgs::msg::Transform const & in, btTransform & out) @@ -168,7 +168,7 @@ inline btTransform transformToBullet(const geometry_msgs::msg::TransformStamped * \param t_out The transformed vector, as a timestamped Bullet btVector3 data type. * \param transform The timestamped transform to apply, as a TransformStamped message. */ -template <> +template<> inline void doTransform( const tf2::Stamped & t_in, tf2::Stamped & t_out, const geometry_msgs::msg::TransformStamped & transform) @@ -183,7 +183,7 @@ inline void doTransform( * \param t_out The transformed frame, as a timestamped Bullet btTransform. * \param transform The timestamped transform to apply, as a TransformStamped message. */ -template <> +template<> inline void doTransform( const tf2::Stamped & t_in, tf2::Stamped & t_out, const geometry_msgs::msg::TransformStamped & transform)