Functions | |
def | demo () |
def | pendantCB (msg) |
Variables | |
arm = MoveGroupCommander("manipulator") | |
cancel_pub = rospy.Publisher("/move_group/cancel", actionlib_msgs.msg.GoalID); | |
g_prev_status = None | |
bool | g_runnable = False |
LOAD_SCENE_PROG = os.path.join(os.path.dirname(__file__), "..", "bin", "publish_scene_from_text") | |
running_pub = rospy.Publisher("/irex_demo_running", std_msgs.msg.Bool); | |
SCENE_FILE = os.path.join(os.path.dirname(__file__), "..", "model", "irex_model.scene") | |
sub = rospy.Subscriber("/denso_pendant_publisher/status", denso_pendant_publisher.msg.PendantStatus, pendantCB) | |
def irex_demo.demo | ( | ) |
Definition at line 46 of file irex_demo.py.
def irex_demo.pendantCB | ( | msg | ) |
Definition at line 20 of file irex_demo.py.
irex_demo.arm = MoveGroupCommander("manipulator") |
Definition at line 37 of file irex_demo.py.
irex_demo.cancel_pub = rospy.Publisher("/move_group/cancel", actionlib_msgs.msg.GoalID); |
Definition at line 40 of file irex_demo.py.
irex_demo.g_prev_status = None |
Definition at line 18 of file irex_demo.py.
bool irex_demo.g_runnable = False |
Definition at line 16 of file irex_demo.py.
irex_demo.LOAD_SCENE_PROG = os.path.join(os.path.dirname(__file__), "..", "bin", "publish_scene_from_text") |
Definition at line 44 of file irex_demo.py.
irex_demo.running_pub = rospy.Publisher("/irex_demo_running", std_msgs.msg.Bool); |
Definition at line 38 of file irex_demo.py.
irex_demo.SCENE_FILE = os.path.join(os.path.dirname(__file__), "..", "model", "irex_model.scene") |
Definition at line 43 of file irex_demo.py.
irex_demo.sub = rospy.Subscriber("/denso_pendant_publisher/status", denso_pendant_publisher.msg.PendantStatus, pendantCB) |
Definition at line 36 of file irex_demo.py.