Python geometry_msgs.msg.Quaternion() Examples
The following are 30
code examples of geometry_msgs.msg.Quaternion().
You can vote up the ones you like or vote down the ones you don't like,
and go to the original project or source file by following the links above each example.
You may also want to check out all available functions/classes of the module
geometry_msgs.msg
, or try the search function
.
Example #1
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 7 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #2
Source File: pick_and_place_pick_working.py From ROS-Programming-Building-Powerful-Robots with MIT License | 7 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.005)) return p.pose
Example #3
Source File: pick_and_place.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.45 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #4
Source File: control_util.py From visual_foresight with MIT License | 6 votes |
def state_to_pose(xyz, quat): """ :param xyz: desired pose xyz :param quat: quaternion around z angle in [w, x, y, z] format :return: stamped pose """ quat = Quaternion_msg( w=quat[0], x=quat[1], y=quat[2], z=quat[3] ) desired_pose = inverse_kinematics.get_pose_stamped(xyz[0], xyz[1], xyz[2], quat) return desired_pose
Example #5
Source File: control_util.py From visual_foresight with MIT License | 6 votes |
def state_to_pose(xyz, quat): """ :param xyz: desired pose xyz :param quat: quaternion around z angle in [w, x, y, z] format :return: stamped pose """ quat = Quaternion_msg( w=quat[0], x=quat[1], y=quat[2], z=quat[3] ) desired_pose = inverse_kinematics.get_pose_stamped(xyz[0], xyz[1], xyz[2], quat) return desired_pose
Example #6
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.009)) return p.pose
Example #7
Source File: pick_and_place_both_working_good.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.009)) return p.pose
Example #8
Source File: GoalsSequencer.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _CreateMoveBaseGoal(self, goal): ''' Creates an instance of MoveBaseGoal based on a simple goal in the form of a (x,y,theta) tuple ''' x,y,theta = goal moveBaseGoal = MoveBaseGoal() moveBaseGoal.target_pose.header.frame_id = self._GoalFrameId moveBaseGoal.target_pose.header.stamp = rospy.Time.now() moveBaseGoal.target_pose.pose.position.x = x moveBaseGoal.target_pose.pose.position.y = y quaternionArray = tf.transformations.quaternion_about_axis(theta, (0,0,1)) # quaternion_about_axis offers a convenient way for calculating the members of a quaternion. # In order to use it we need to convert it to a Quaternion message structure moveBaseGoal.target_pose.pose.orientation = self.array_to_quaternion(quaternionArray) print(moveBaseGoal) return moveBaseGoal
Example #9
Source File: GoalsSequencer.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _CreateMoveBaseGoal(self, goal): ''' Creates an instance of MoveBaseGoal based on a simple goal in the form of a (x,y,theta) tuple ''' x,y,theta = goal moveBaseGoal = MoveBaseGoal() moveBaseGoal.target_pose.header.frame_id = self._GoalFrameId moveBaseGoal.target_pose.header.stamp = rospy.Time.now() moveBaseGoal.target_pose.pose.position.x = x moveBaseGoal.target_pose.pose.position.y = y quaternionArray = tf.transformations.quaternion_about_axis(theta, (0,0,1)) # quaternion_about_axis offers a convenient way for calculating the members of a quaternion. # In order to use it we need to convert it to a Quaternion message structure moveBaseGoal.target_pose.pose.orientation = self.array_to_quaternion(quaternionArray) print(moveBaseGoal) return moveBaseGoal
Example #10
Source File: pick_and_place_ew.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.4 p.pose.position.y = 0.0 p.pose.position.z = 0.26 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #11
Source File: pick_and_place_ew.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.09)) return p.pose
Example #12
Source File: pick_and_place_pick_working.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #13
Source File: pick_and_place_pick_working.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.005)) return p.pose
Example #14
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #15
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.009)) return p.pose
Example #16
Source File: task_planner.py From AI-Robot-Challenge-Lab with MIT License | 6 votes |
def compute_grasp_pose_offset(self, pose): """ :param pose: :return: """ yrot = tf.transformations.quaternion_from_euler(0, math.pi, 0) cubeorientation = [pose.orientation.x, pose.orientation.y, pose.orientation.z, pose.orientation.w] # oorient = [overhead_orientation.x,overhead_orientation.y,overhead_orientation.z,overhead_orientation.w] # resultingorient = tf.transformations.quaternion_multiply(cubeorientation, tf.transformations.quaternion_conjugate(oorient)) resultingorient = tf.transformations.quaternion_multiply(cubeorientation, yrot) # resultingorient = cubeorientation pose.orientation = Quaternion(x=resultingorient[0], y=resultingorient[1], z=resultingorient[2], w=resultingorient[3]) pose.position.x += 0 pose.position.y += 0 pose.position.z = demo_constants.TABLE_HEIGHT + demo_constants.CUBE_EDGE_LENGTH return pose
Example #17
Source File: pick_and_place.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_grasp_block_(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.09)) return p.pose
Example #18
Source File: pick_and_place_both_working_good.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #19
Source File: pick_and_place_both_working_good.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.009)) return p.pose
Example #20
Source File: pick_and_place_pick_working.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #21
Source File: pick_and_place_pick_working.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.005)) return p.pose
Example #22
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #23
Source File: pick_and_place_working_1.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.01, 0.01, 0.009)) return p.pose
Example #24
Source File: pick_and_place.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.45 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #25
Source File: pick_and_place.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_grasp_block_(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.09)) return p.pose
Example #26
Source File: pick_and_place_both_working_good.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_table(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.5 p.pose.position.y = 0.0 p.pose.position.z = 0.22 q = quaternion_from_euler(0.0, 0.0, numpy.deg2rad(90.0)) p.pose.orientation = Quaternion(*q) # Table size from ~/.gazebo/models/table/model.sdf, using the values # for the surface link. self._scene.add_box(name, p, (0.5, 0.4, 0.02)) return p.pose
Example #27
Source File: pick_and_place_both_working_good.py From ROS-Programming-Building-Powerful-Robots with MIT License | 6 votes |
def _add_coke_can(self, name): p = PoseStamped() p.header.frame_id = self._robot.get_planning_frame() p.header.stamp = rospy.Time.now() p.pose.position.x = 0.25 p.pose.position.y = 0.05 p.pose.position.z = 0.32 q = quaternion_from_euler(0.0, 0.0, 0.0) p.pose.orientation = Quaternion(*q) # Coke can size from ~/.gazebo/models/coke_can/meshes/coke_can.dae, # using the measure tape tool from meshlab. # The box is the bounding box of the coke cylinder. # The values are taken from the cylinder base diameter and height. self._scene.add_box(name, p, (0.03, 0.03, 0.009)) return p.pose
Example #28
Source File: move_base_state.py From generic_flexbe_states with BSD 3-Clause "New" or "Revised" License | 6 votes |
def on_enter(self, userdata): """Create and send action goal""" self._arrived = False self._failed = False # Create and populate action goal goal = MoveBaseGoal() pt = Point(x = userdata.waypoint.x, y = userdata.waypoint.y) qt = transformations.quaternion_from_euler(0, 0, userdata.waypoint.theta) goal.target_pose.pose = Pose(position = pt, orientation = Quaternion(*qt)) goal.target_pose.header.frame_id = "odom" # goal.target_pose.header.stamp.secs = 5.0 # Send the action goal for execution try: self._client.send_goal(self._action_topic, goal) except Exception as e: Logger.logwarn("Unable to send navigation action goal:\n%s" % str(e)) self._failed = True
Example #29
Source File: conversions.py From visual_dynamics with MIT License | 6 votes |
def trans_rot_to_hmat(trans, rot): ''' Converts a rotation and translation to a homogeneous transform. **Args:** **trans (np.array):** Translation (x, y, z). **rot (np.array):** Quaternion (x, y, z, w). **Returns:** H (np.array): 4x4 homogenous transform matrix. ''' H = transformations.quaternion_matrix(rot) H[0:3, 3] = trans return H
Example #30
Source File: estimate_depth.py From baxter_demos with Apache License 2.0 | 6 votes |
def centroid_callback(self, data): self.goal_poses = [] for blob in data.blobs: centroid = (blob.centroid.x, blob.centroid.y) if blob.axis is None or self.camera_model is None: return axis = numpy.concatenate((numpy.array(unmap(blob.axis.points[0])),\ numpy.array(unmap(blob.axis.points[1])))) pos = self.solve_goal_pose(centroid) #Calculate desired orientation theta = self.calculate_angle(axis) quat = tf.transformations.quaternion_from_euler(-pi, 0, theta) self.goal_poses.append( Pose(position=Point(*pos), orientation=Quaternion(*quat))) self.done = True