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