From 58b97bfe78f506090e67e50c87ff1e3aadf5e95b Mon Sep 17 00:00:00 2001 From: =?UTF-8?q?Jos=C3=A9=20Enrique=20Dom=C3=ADnguez?= <jdominguez@iri.upc.edu> Date: Wed, 27 May 2020 11:55:04 +0200 Subject: [PATCH] Type fixed in twist_recovery --- twist_recovery/src/twist_recovery.cpp | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/twist_recovery/src/twist_recovery.cpp b/twist_recovery/src/twist_recovery.cpp index ddf0daf..6fde420 100644 --- a/twist_recovery/src/twist_recovery.cpp +++ b/twist_recovery/src/twist_recovery.cpp @@ -222,7 +222,7 @@ namespace twist_recovery } // Apply algorithm to escape from a lethal obstacle - void RotationalRecovery::escapeFromLethalCost(const geometry_msgs::Pose2D& current_position, geometry_msgs::Twist& twist, const double cost) + void TwistRecovery::escapeFromLethalCost(const geometry_msgs::Pose2D& current_position, geometry_msgs::Twist& twist, const double cost) { double cost_front_1, cost_front_2, cost_front_3 = 0; double cost_back_1, cost_back_2, cost_back_3 = 0; -- GitLab