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/GetPlanningScene.h>
@@ -47,11 +49,14 @@ namespace moveit {
4749namespace task_constructor {
4850namespace stages {
4951
52+ using namespace std ::chrono_literals;
53+ constexpr std::chrono::duration<double > DEFAULT_TIMEOUT = 3s;
54+
5055CurrentState::CurrentState (const std::string& name) : Generator(name) {
5156 auto & p = properties ();
5257 Property& timeout = p.property (" timeout" );
5358 timeout.setDescription (" max time to wait for get_planning_scene service" );
54- timeout.setValue (- 1.0 );
59+ timeout.setValue (DEFAULT_TIMEOUT. count () );
5560}
5661
5762void CurrentState::init (const moveit::core::RobotModelConstPtr& robot_model) {
You can’t perform that action at this time.
0 commit comments