Functions | Variables
irex_demo_noteaching Namespace Reference

Functions

def demo ()
 

Variables

 _len_cut = len(_path_rosroot)-len('/share/ros')
 
 _path_rosroot = rospy.get_ros_root()
 
 _path_rosroot_top = _path_rosroot[:_len_cut]
 
 _rospack = RosPack()
 
 arm = MoveGroupCommander("manipulator")
 
 cancel_pub = rospy.Publisher("/move_group/cancel", actionlib_msgs.msg.GoalID);
 
string LOAD_SCENE_PROG = _path_rosroot_top+'/lib/vs060/publish_scene_from_text'
 
 running_pub = rospy.Publisher("/irex_demo_running", std_msgs.msg.Bool);
 
string SCENE_FILE = _rospack.get_path('vs060')+'/model/irex_model.scene'
 

Function Documentation

def irex_demo_noteaching.demo ( )

Definition at line 79 of file irex_demo_noteaching.py.

Variable Documentation

irex_demo_noteaching._len_cut = len(_path_rosroot)-len('/share/ros')
private

Definition at line 72 of file irex_demo_noteaching.py.

irex_demo_noteaching._path_rosroot = rospy.get_ros_root()
private

Definition at line 71 of file irex_demo_noteaching.py.

irex_demo_noteaching._path_rosroot_top = _path_rosroot[:_len_cut]
private

Definition at line 73 of file irex_demo_noteaching.py.

irex_demo_noteaching._rospack = RosPack()
private

Definition at line 69 of file irex_demo_noteaching.py.

irex_demo_noteaching.arm = MoveGroupCommander("manipulator")

Definition at line 63 of file irex_demo_noteaching.py.

irex_demo_noteaching.cancel_pub = rospy.Publisher("/move_group/cancel", actionlib_msgs.msg.GoalID);

Definition at line 66 of file irex_demo_noteaching.py.

string irex_demo_noteaching.LOAD_SCENE_PROG = _path_rosroot_top+'/lib/vs060/publish_scene_from_text'

Definition at line 74 of file irex_demo_noteaching.py.

irex_demo_noteaching.running_pub = rospy.Publisher("/irex_demo_running", std_msgs.msg.Bool);

Definition at line 64 of file irex_demo_noteaching.py.

string irex_demo_noteaching.SCENE_FILE = _rospack.get_path('vs060')+'/model/irex_model.scene'

Definition at line 70 of file irex_demo_noteaching.py.



vs060
Author(s): Ryohei Ueda
autogenerated on Mon Jun 10 2019 13:13:22