Go to the source code of this file.
|
| irex_demo.arm = MoveGroupCommander("manipulator") |
|
| irex_demo.cancel_pub = rospy.Publisher("/move_group/cancel", actionlib_msgs.msg.GoalID); |
|
| irex_demo.g_prev_status = None |
|
bool | irex_demo.g_runnable = False |
|
| irex_demo.LOAD_SCENE_PROG = os.path.join(os.path.dirname(__file__), "..", "bin", "publish_scene_from_text") |
|
| irex_demo.running_pub = rospy.Publisher("/irex_demo_running", std_msgs.msg.Bool); |
|
| irex_demo.SCENE_FILE = os.path.join(os.path.dirname(__file__), "..", "model", "irex_model.scene") |
|
| irex_demo.sub = rospy.Subscriber("/denso_pendant_publisher/status", denso_pendant_publisher.msg.PendantStatus, pendantCB) |
|