Variables
hand_position_publisher_example Namespace Reference

Variables

 left_pose = geometry_msgs.msg.Pose()
 
 left_pose_pub = rospy.Publisher('/sciurus17/hand_pos/left', geometry_msgs.msg.Pose,queue_size=1)
 
 listener = tf.TransformListener()
 
 rate = rospy.Rate(10.0)
 
 right_pose = geometry_msgs.msg.Pose()
 
 right_pose_pub = rospy.Publisher('/sciurus17/hand_pos/right', geometry_msgs.msg.Pose,queue_size=1)
 
 rot
 
 trans
 
 w
 
 x
 
 y
 
 z
 

Variable Documentation

◆ left_pose

hand_position_publisher_example.left_pose = geometry_msgs.msg.Pose()

Definition at line 39 of file hand_position_publisher_example.py.

◆ left_pose_pub

hand_position_publisher_example.left_pose_pub = rospy.Publisher('/sciurus17/hand_pos/left', geometry_msgs.msg.Pose,queue_size=1)

Definition at line 28 of file hand_position_publisher_example.py.

◆ listener

hand_position_publisher_example.listener = tf.TransformListener()

Definition at line 26 of file hand_position_publisher_example.py.

◆ rate

hand_position_publisher_example.rate = rospy.Rate(10.0)

Definition at line 31 of file hand_position_publisher_example.py.

◆ right_pose

hand_position_publisher_example.right_pose = geometry_msgs.msg.Pose()

Definition at line 55 of file hand_position_publisher_example.py.

◆ right_pose_pub

hand_position_publisher_example.right_pose_pub = rospy.Publisher('/sciurus17/hand_pos/right', geometry_msgs.msg.Pose,queue_size=1)

Definition at line 29 of file hand_position_publisher_example.py.

◆ rot

hand_position_publisher_example.rot

Definition at line 34 of file hand_position_publisher_example.py.

◆ trans

hand_position_publisher_example.trans

Definition at line 34 of file hand_position_publisher_example.py.

◆ w

hand_position_publisher_example.w

Definition at line 46 of file hand_position_publisher_example.py.

◆ x

hand_position_publisher_example.x

Definition at line 40 of file hand_position_publisher_example.py.

◆ y

hand_position_publisher_example.y

Definition at line 41 of file hand_position_publisher_example.py.

◆ z

hand_position_publisher_example.z

Definition at line 42 of file hand_position_publisher_example.py.



sciurus17_examples
Author(s): Daisuke Sato , Hiroyuki Nomura
autogenerated on Fri Aug 2 2024 08:37:20