3 import roslib; roslib.load_manifest(
'flexbe_mirror')
5 from rospy.exceptions
import ROSInterruptException
6 from flexbe_core
import EventState, JumpableStateMachine
9 from std_msgs.msg
import String, UInt8
14 @author: Philipp Schillinger 19 This state will display its possible outcomes as buttons in the GUI and is designed in a way to be created dynamically. 23 def __init__(self, target_name, target_path, given_outcomes, outcome_autonomy):
27 super(MirrorState, self).
__init__(outcomes=given_outcomes)
36 self.
_pub = ProxyPublisher()
44 if JumpableStateMachine.refresh:
45 JumpableStateMachine.refresh =
False 56 except ROSInterruptException:
57 print 'Interrupted mirror sleep.' 62 self._pub.publish(
'flexbe/behavior_update', String(
"/" +
"/".join(self._target_path.split(
"/")[1:])))
def __init__(self, target_name, target_path, given_outcomes, outcome_autonomy)
def on_enter(self, userdata)
def execute(self, userdata)