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 660175c commit f13ebccCopy full SHA for f13ebcc
‎moveit_plugins/moveit_ros_control_interface/src/controller_manager_plugin.cpp‎
@@ -57,7 +57,8 @@
57
#include <moveit/utils/logger.hpp>
58
59
static const rclcpp::Duration CONTROLLER_INFORMATION_VALIDITY_AGE = rclcpp::Duration::from_seconds(1.0);
60
-static const double SERVICE_CALL_TIMEOUT = 1.0;
+// TODO: Create a ROS parameter allowing to customize this default timeout
61
+static constexpr double SERVICE_CALL_TIMEOUT = 3.0;
62
63
namespace moveit_ros_control_interface
64
{
0 commit comments