34 node =
"simple_action_server_deadlock_companion"
36 max_action_duration = 3
42 from actionlib.msg
import TestAction, TestGoal
43 from actionlib_msgs.msg
import GoalStatus
51 random.seed(rospy.get_name() + str(rospy.Time.now().to_sec()))
59 while not rospy.is_shutdown():
64 action_duration = random.uniform(0, Constants.max_action_duration)
65 self.
action_client.wait_for_result(rospy.Duration(action_duration))
68 if state == GoalStatus.ACTIVE
or state == GoalStatus.PENDING:
72 if __name__ ==
'__main__':
73 rospy.init_node(Constants.node)
77 except (KeyboardInterrupt, SystemExit):