interactive_arm_control.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 '''Node to control robot's arms using interactive markers'''
00003 
00004 # ######################################################################
00005 # Imports
00006 # ######################################################################
00007 
00008 # Core ROS imports come first.
00009 import rospy
00010 
00011 # ROS builtins
00012 from tf import TransformListener
00013 
00014 # Local
00015 from fetch_arm_control.arm import Arm
00016 from fetch_arm_control.arm_control_marker import ArmControlMarker
00017 
00018 if __name__ == '__main__':
00019 
00020     # Register as a ROS node.
00021     rospy.init_node('fetch_arm_interaction', anonymous=True)
00022 
00023     # Run the system
00024     tf_listener = TransformListener()
00025     arm = Arm(tf_listener)
00026     marker = ArmControlMarker(arm)
00027     rospy.spin()


fetch_arm_control
Author(s): Sarah Elliott
autogenerated on Thu Jun 6 2019 18:27:17