Go to the source code of this file.
Namespaces | |
| hand_position_publisher_example | |
Variables | |
| hand_position_publisher_example.left_pose = geometry_msgs.msg.Pose() | |
| hand_position_publisher_example.left_pose_pub = rospy.Publisher('/sciurus17/hand_pos/left', geometry_msgs.msg.Pose,queue_size=1) | |
| hand_position_publisher_example.listener = tf.TransformListener() | |
| hand_position_publisher_example.rate = rospy.Rate(10.0) | |
| hand_position_publisher_example.right_pose = geometry_msgs.msg.Pose() | |
| hand_position_publisher_example.right_pose_pub = rospy.Publisher('/sciurus17/hand_pos/right', geometry_msgs.msg.Pose,queue_size=1) | |
| hand_position_publisher_example.rot | |
| hand_position_publisher_example.trans | |
| hand_position_publisher_example.w | |
| hand_position_publisher_example.x | |
| hand_position_publisher_example.y | |
| hand_position_publisher_example.z | |