File tree Expand file tree Collapse file tree 1 file changed +6
-1
lines changed Expand file tree Collapse file tree 1 file changed +6
-1
lines changed Original file line number Diff line number Diff line change 3535
3636/* Authors: Michael Goerner, Luca Lach, Robert Haschke */
3737
38+ #include < chrono>
39+
3840#include < moveit/task_constructor/stages/current_state.h>
3941#include < moveit/task_constructor/storage.h>
4042#include < moveit_msgs/srv/get_planning_scene.hpp>
@@ -47,13 +49,16 @@ namespace moveit {
4749namespace task_constructor {
4850namespace stages {
4951
52+ using namespace std ::chrono_literals;
53+ constexpr std::chrono::duration<double > DEFAULT_TIMEOUT = 3s;
54+
5055static const rclcpp::Logger LOGGER = rclcpp::get_logger(" CurrentState" );
5156
5257CurrentState::CurrentState (const std::string& name) : Generator(name) {
5358 auto & p = properties ();
5459 Property& timeout = p.property (" timeout" );
5560 timeout.setDescription (" max time to wait for get_planning_scene service" );
56- timeout.setValue (- 1.0 );
61+ timeout.setValue (DEFAULT_TIMEOUT. count () );
5762}
5863
5964void CurrentState::init (const moveit::core::RobotModelConstPtr& robot_model) {
You can’t perform that action at this time.
0 commit comments