00001 """autogenerated by genpy from iri_door_detector/FindADoorResult.msg. Do not edit."""
00002 import sys
00003 python3 = True if sys.hexversion > 0x03000000 else False
00004 import genpy
00005 import struct
00006
00007 import arm_navigation_msgs.msg
00008 import sensor_msgs.msg
00009 import geometry_msgs.msg
00010 import genpy
00011 import std_msgs.msg
00012
00013 class FindADoorResult(genpy.Message):
00014 _md5sum = "5fa7b6c2022d0d722bc2489bda0bb208"
00015 _type = "iri_door_detector/FindADoorResult"
00016 _has_header = False
00017 _full_text = """# ====== DO NOT MODIFY! AUTOGENERATED FROM AN ACTION DEFINITION ======
00018 # Define the result
00019 geometry_msgs/PoseStamped base_poses
00020 arm_navigation_msgs/MotionPlanRequest arm_poses
00021 string planner_service_name
00022 string state
00023
00024 ================================================================================
00025 MSG: geometry_msgs/PoseStamped
00026 # A Pose with reference coordinate frame and timestamp
00027 Header header
00028 Pose pose
00029
00030 ================================================================================
00031 MSG: std_msgs/Header
00032 # Standard metadata for higher-level stamped data types.
00033 # This is generally used to communicate timestamped data
00034 # in a particular coordinate frame.
00035 #
00036 # sequence ID: consecutively increasing ID
00037 uint32 seq
00038 #Two-integer timestamp that is expressed as:
00039 # * stamp.secs: seconds (stamp_secs) since epoch
00040 # * stamp.nsecs: nanoseconds since stamp_secs
00041 # time-handling sugar is provided by the client library
00042 time stamp
00043 #Frame this data is associated with
00044 # 0: no frame
00045 # 1: global frame
00046 string frame_id
00047
00048 ================================================================================
00049 MSG: geometry_msgs/Pose
00050 # A representation of pose in free space, composed of postion and orientation.
00051 Point position
00052 Quaternion orientation
00053
00054 ================================================================================
00055 MSG: geometry_msgs/Point
00056 # This contains the position of a point in free space
00057 float64 x
00058 float64 y
00059 float64 z
00060
00061 ================================================================================
00062 MSG: geometry_msgs/Quaternion
00063 # This represents an orientation in free space in quaternion form.
00064
00065 float64 x
00066 float64 y
00067 float64 z
00068 float64 w
00069
00070 ================================================================================
00071 MSG: arm_navigation_msgs/MotionPlanRequest
00072 # This service contains the definition for a request to the motion
00073 # planner and the output it provides
00074
00075 # Parameters for the workspace that the planner should work inside
00076 arm_navigation_msgs/WorkspaceParameters workspace_parameters
00077
00078 # Starting state updates. If certain joints should be considered
00079 # at positions other than the current ones, these positions should
00080 # be set here
00081 arm_navigation_msgs/RobotState start_state
00082
00083 # The goal state for the model to plan for. The goal is achieved
00084 # if all constraints are satisfied
00085 arm_navigation_msgs/Constraints goal_constraints
00086
00087 # No state at any point along the path in the produced motion plan will violate these constraints
00088 arm_navigation_msgs/Constraints path_constraints
00089
00090 # The name of the motion planner to use. If no name is specified,
00091 # a default motion planner will be used
00092 string planner_id
00093
00094 # The name of the group of joints on which this planner is operating
00095 string group_name
00096
00097 # The number of times this plan is to be computed. Shortest solution
00098 # will be reported.
00099 int32 num_planning_attempts
00100
00101 # The maximum amount of time the motion planner is allowed to plan for
00102 duration allowed_planning_time
00103
00104 # An expected path duration (in seconds) along with an expected discretization of the path allows the planner to determine the discretization of the trajectory that it returns
00105 duration expected_path_duration
00106 duration expected_path_dt
00107
00108 ================================================================================
00109 MSG: arm_navigation_msgs/WorkspaceParameters
00110 # This message contains a set of parameters useful in
00111 # setting up the workspace for planning
00112 arm_navigation_msgs/Shape workspace_region_shape
00113 geometry_msgs/PoseStamped workspace_region_pose
00114
00115
00116 ================================================================================
00117 MSG: arm_navigation_msgs/Shape
00118 byte SPHERE=0
00119 byte BOX=1
00120 byte CYLINDER=2
00121 byte MESH=3
00122
00123 byte type
00124
00125
00126 #### define sphere, box, cylinder ####
00127 # the origin of each shape is considered at the shape's center
00128
00129 # for sphere
00130 # radius := dimensions[0]
00131
00132 # for cylinder
00133 # radius := dimensions[0]
00134 # length := dimensions[1]
00135 # the length is along the Z axis
00136
00137 # for box
00138 # size_x := dimensions[0]
00139 # size_y := dimensions[1]
00140 # size_z := dimensions[2]
00141 float64[] dimensions
00142
00143
00144 #### define mesh ####
00145
00146 # list of triangles; triangle k is defined by tre vertices located
00147 # at indices triangles[3k], triangles[3k+1], triangles[3k+2]
00148 int32[] triangles
00149 geometry_msgs/Point[] vertices
00150
00151 ================================================================================
00152 MSG: arm_navigation_msgs/RobotState
00153 # This message contains information about the robot state, i.e. the positions of its joints and links
00154 sensor_msgs/JointState joint_state
00155 arm_navigation_msgs/MultiDOFJointState multi_dof_joint_state
00156
00157 ================================================================================
00158 MSG: sensor_msgs/JointState
00159 # This is a message that holds data to describe the state of a set of torque controlled joints.
00160 #
00161 # The state of each joint (revolute or prismatic) is defined by:
00162 # * the position of the joint (rad or m),
00163 # * the velocity of the joint (rad/s or m/s) and
00164 # * the effort that is applied in the joint (Nm or N).
00165 #
00166 # Each joint is uniquely identified by its name
00167 # The header specifies the time at which the joint states were recorded. All the joint states
00168 # in one message have to be recorded at the same time.
00169 #
00170 # This message consists of a multiple arrays, one for each part of the joint state.
00171 # The goal is to make each of the fields optional. When e.g. your joints have no
00172 # effort associated with them, you can leave the effort array empty.
00173 #
00174 # All arrays in this message should have the same size, or be empty.
00175 # This is the only way to uniquely associate the joint name with the correct
00176 # states.
00177
00178
00179 Header header
00180
00181 string[] name
00182 float64[] position
00183 float64[] velocity
00184 float64[] effort
00185
00186 ================================================================================
00187 MSG: arm_navigation_msgs/MultiDOFJointState
00188 #A representation of a multi-dof joint state
00189 time stamp
00190 string[] joint_names
00191 string[] frame_ids
00192 string[] child_frame_ids
00193 geometry_msgs/Pose[] poses
00194
00195 ================================================================================
00196 MSG: arm_navigation_msgs/Constraints
00197 # This message contains a list of motion planning constraints.
00198
00199 arm_navigation_msgs/JointConstraint[] joint_constraints
00200 arm_navigation_msgs/PositionConstraint[] position_constraints
00201 arm_navigation_msgs/OrientationConstraint[] orientation_constraints
00202 arm_navigation_msgs/VisibilityConstraint[] visibility_constraints
00203
00204 ================================================================================
00205 MSG: arm_navigation_msgs/JointConstraint
00206 # Constrain the position of a joint to be within a certain bound
00207 string joint_name
00208
00209 # the bound to be achieved is [position - tolerance_below, position + tolerance_above]
00210 float64 position
00211 float64 tolerance_above
00212 float64 tolerance_below
00213
00214 # A weighting factor for this constraint
00215 float64 weight
00216 ================================================================================
00217 MSG: arm_navigation_msgs/PositionConstraint
00218 # This message contains the definition of a position constraint.
00219 Header header
00220
00221 # The robot link this constraint refers to
00222 string link_name
00223
00224 # The offset (in the link frame) for the target point on the link we are planning for
00225 geometry_msgs/Point target_point_offset
00226
00227 # The nominal/target position for the point we are planning for
00228 geometry_msgs/Point position
00229
00230 # The shape of the bounded region that constrains the position of the end-effector
00231 # This region is always centered at the position defined above
00232 arm_navigation_msgs/Shape constraint_region_shape
00233
00234 # The orientation of the bounded region that constrains the position of the end-effector.
00235 # This allows the specification of non-axis aligned constraints
00236 geometry_msgs/Quaternion constraint_region_orientation
00237
00238 # Constraint weighting factor - a weight for this constraint
00239 float64 weight
00240
00241 ================================================================================
00242 MSG: arm_navigation_msgs/OrientationConstraint
00243 # This message contains the definition of an orientation constraint.
00244 Header header
00245
00246 # The robot link this constraint refers to
00247 string link_name
00248
00249 # The type of the constraint
00250 int32 type
00251 int32 LINK_FRAME=0
00252 int32 HEADER_FRAME=1
00253
00254 # The desired orientation of the robot link specified as a quaternion
00255 geometry_msgs/Quaternion orientation
00256
00257 # optional RPY error tolerances specified if
00258 float64 absolute_roll_tolerance
00259 float64 absolute_pitch_tolerance
00260 float64 absolute_yaw_tolerance
00261
00262 # Constraint weighting factor - a weight for this constraint
00263 float64 weight
00264
00265 ================================================================================
00266 MSG: arm_navigation_msgs/VisibilityConstraint
00267 # This message contains the definition of a visibility constraint.
00268 Header header
00269
00270 # The point stamped target that needs to be kept within view of the sensor
00271 geometry_msgs/PointStamped target
00272
00273 # The local pose of the frame in which visibility is to be maintained
00274 # The frame id should represent the robot link to which the sensor is attached
00275 # The visual axis of the sensor is assumed to be along the X axis of this frame
00276 geometry_msgs/PoseStamped sensor_pose
00277
00278 # The deviation (in radians) that will be tolerated
00279 # Constraint error will be measured as the solid angle between the
00280 # X axis of the frame defined above and the vector between the origin
00281 # of the frame defined above and the target location
00282 float64 absolute_tolerance
00283
00284
00285 ================================================================================
00286 MSG: geometry_msgs/PointStamped
00287 # This represents a Point with reference coordinate frame and timestamp
00288 Header header
00289 Point point
00290
00291 """
00292 __slots__ = ['base_poses','arm_poses','planner_service_name','state']
00293 _slot_types = ['geometry_msgs/PoseStamped','arm_navigation_msgs/MotionPlanRequest','string','string']
00294
00295 def __init__(self, *args, **kwds):
00296 """
00297 Constructor. Any message fields that are implicitly/explicitly
00298 set to None will be assigned a default value. The recommend
00299 use is keyword arguments as this is more robust to future message
00300 changes. You cannot mix in-order arguments and keyword arguments.
00301
00302 The available fields are:
00303 base_poses,arm_poses,planner_service_name,state
00304
00305 :param args: complete set of field values, in .msg order
00306 :param kwds: use keyword arguments corresponding to message field names
00307 to set specific fields.
00308 """
00309 if args or kwds:
00310 super(FindADoorResult, self).__init__(*args, **kwds)
00311
00312 if self.base_poses is None:
00313 self.base_poses = geometry_msgs.msg.PoseStamped()
00314 if self.arm_poses is None:
00315 self.arm_poses = arm_navigation_msgs.msg.MotionPlanRequest()
00316 if self.planner_service_name is None:
00317 self.planner_service_name = ''
00318 if self.state is None:
00319 self.state = ''
00320 else:
00321 self.base_poses = geometry_msgs.msg.PoseStamped()
00322 self.arm_poses = arm_navigation_msgs.msg.MotionPlanRequest()
00323 self.planner_service_name = ''
00324 self.state = ''
00325
00326 def _get_types(self):
00327 """
00328 internal API method
00329 """
00330 return self._slot_types
00331
00332 def serialize(self, buff):
00333 """
00334 serialize message into buffer
00335 :param buff: buffer, ``StringIO``
00336 """
00337 try:
00338 _x = self
00339 buff.write(_struct_3I.pack(_x.base_poses.header.seq, _x.base_poses.header.stamp.secs, _x.base_poses.header.stamp.nsecs))
00340 _x = self.base_poses.header.frame_id
00341 length = len(_x)
00342 if python3 or type(_x) == unicode:
00343 _x = _x.encode('utf-8')
00344 length = len(_x)
00345 buff.write(struct.pack('<I%ss'%length, length, _x))
00346 _x = self
00347 buff.write(_struct_7db.pack(_x.base_poses.pose.position.x, _x.base_poses.pose.position.y, _x.base_poses.pose.position.z, _x.base_poses.pose.orientation.x, _x.base_poses.pose.orientation.y, _x.base_poses.pose.orientation.z, _x.base_poses.pose.orientation.w, _x.arm_poses.workspace_parameters.workspace_region_shape.type))
00348 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.dimensions)
00349 buff.write(_struct_I.pack(length))
00350 pattern = '<%sd'%length
00351 buff.write(struct.pack(pattern, *self.arm_poses.workspace_parameters.workspace_region_shape.dimensions))
00352 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.triangles)
00353 buff.write(_struct_I.pack(length))
00354 pattern = '<%si'%length
00355 buff.write(struct.pack(pattern, *self.arm_poses.workspace_parameters.workspace_region_shape.triangles))
00356 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.vertices)
00357 buff.write(_struct_I.pack(length))
00358 for val1 in self.arm_poses.workspace_parameters.workspace_region_shape.vertices:
00359 _x = val1
00360 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00361 _x = self
00362 buff.write(_struct_3I.pack(_x.arm_poses.workspace_parameters.workspace_region_pose.header.seq, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.secs, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.nsecs))
00363 _x = self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id
00364 length = len(_x)
00365 if python3 or type(_x) == unicode:
00366 _x = _x.encode('utf-8')
00367 length = len(_x)
00368 buff.write(struct.pack('<I%ss'%length, length, _x))
00369 _x = self
00370 buff.write(_struct_7d3I.pack(_x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.w, _x.arm_poses.start_state.joint_state.header.seq, _x.arm_poses.start_state.joint_state.header.stamp.secs, _x.arm_poses.start_state.joint_state.header.stamp.nsecs))
00371 _x = self.arm_poses.start_state.joint_state.header.frame_id
00372 length = len(_x)
00373 if python3 or type(_x) == unicode:
00374 _x = _x.encode('utf-8')
00375 length = len(_x)
00376 buff.write(struct.pack('<I%ss'%length, length, _x))
00377 length = len(self.arm_poses.start_state.joint_state.name)
00378 buff.write(_struct_I.pack(length))
00379 for val1 in self.arm_poses.start_state.joint_state.name:
00380 length = len(val1)
00381 if python3 or type(val1) == unicode:
00382 val1 = val1.encode('utf-8')
00383 length = len(val1)
00384 buff.write(struct.pack('<I%ss'%length, length, val1))
00385 length = len(self.arm_poses.start_state.joint_state.position)
00386 buff.write(_struct_I.pack(length))
00387 pattern = '<%sd'%length
00388 buff.write(struct.pack(pattern, *self.arm_poses.start_state.joint_state.position))
00389 length = len(self.arm_poses.start_state.joint_state.velocity)
00390 buff.write(_struct_I.pack(length))
00391 pattern = '<%sd'%length
00392 buff.write(struct.pack(pattern, *self.arm_poses.start_state.joint_state.velocity))
00393 length = len(self.arm_poses.start_state.joint_state.effort)
00394 buff.write(_struct_I.pack(length))
00395 pattern = '<%sd'%length
00396 buff.write(struct.pack(pattern, *self.arm_poses.start_state.joint_state.effort))
00397 _x = self
00398 buff.write(_struct_2I.pack(_x.arm_poses.start_state.multi_dof_joint_state.stamp.secs, _x.arm_poses.start_state.multi_dof_joint_state.stamp.nsecs))
00399 length = len(self.arm_poses.start_state.multi_dof_joint_state.joint_names)
00400 buff.write(_struct_I.pack(length))
00401 for val1 in self.arm_poses.start_state.multi_dof_joint_state.joint_names:
00402 length = len(val1)
00403 if python3 or type(val1) == unicode:
00404 val1 = val1.encode('utf-8')
00405 length = len(val1)
00406 buff.write(struct.pack('<I%ss'%length, length, val1))
00407 length = len(self.arm_poses.start_state.multi_dof_joint_state.frame_ids)
00408 buff.write(_struct_I.pack(length))
00409 for val1 in self.arm_poses.start_state.multi_dof_joint_state.frame_ids:
00410 length = len(val1)
00411 if python3 or type(val1) == unicode:
00412 val1 = val1.encode('utf-8')
00413 length = len(val1)
00414 buff.write(struct.pack('<I%ss'%length, length, val1))
00415 length = len(self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids)
00416 buff.write(_struct_I.pack(length))
00417 for val1 in self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids:
00418 length = len(val1)
00419 if python3 or type(val1) == unicode:
00420 val1 = val1.encode('utf-8')
00421 length = len(val1)
00422 buff.write(struct.pack('<I%ss'%length, length, val1))
00423 length = len(self.arm_poses.start_state.multi_dof_joint_state.poses)
00424 buff.write(_struct_I.pack(length))
00425 for val1 in self.arm_poses.start_state.multi_dof_joint_state.poses:
00426 _v1 = val1.position
00427 _x = _v1
00428 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00429 _v2 = val1.orientation
00430 _x = _v2
00431 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00432 length = len(self.arm_poses.goal_constraints.joint_constraints)
00433 buff.write(_struct_I.pack(length))
00434 for val1 in self.arm_poses.goal_constraints.joint_constraints:
00435 _x = val1.joint_name
00436 length = len(_x)
00437 if python3 or type(_x) == unicode:
00438 _x = _x.encode('utf-8')
00439 length = len(_x)
00440 buff.write(struct.pack('<I%ss'%length, length, _x))
00441 _x = val1
00442 buff.write(_struct_4d.pack(_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight))
00443 length = len(self.arm_poses.goal_constraints.position_constraints)
00444 buff.write(_struct_I.pack(length))
00445 for val1 in self.arm_poses.goal_constraints.position_constraints:
00446 _v3 = val1.header
00447 buff.write(_struct_I.pack(_v3.seq))
00448 _v4 = _v3.stamp
00449 _x = _v4
00450 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00451 _x = _v3.frame_id
00452 length = len(_x)
00453 if python3 or type(_x) == unicode:
00454 _x = _x.encode('utf-8')
00455 length = len(_x)
00456 buff.write(struct.pack('<I%ss'%length, length, _x))
00457 _x = val1.link_name
00458 length = len(_x)
00459 if python3 or type(_x) == unicode:
00460 _x = _x.encode('utf-8')
00461 length = len(_x)
00462 buff.write(struct.pack('<I%ss'%length, length, _x))
00463 _v5 = val1.target_point_offset
00464 _x = _v5
00465 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00466 _v6 = val1.position
00467 _x = _v6
00468 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00469 _v7 = val1.constraint_region_shape
00470 buff.write(_struct_b.pack(_v7.type))
00471 length = len(_v7.dimensions)
00472 buff.write(_struct_I.pack(length))
00473 pattern = '<%sd'%length
00474 buff.write(struct.pack(pattern, *_v7.dimensions))
00475 length = len(_v7.triangles)
00476 buff.write(_struct_I.pack(length))
00477 pattern = '<%si'%length
00478 buff.write(struct.pack(pattern, *_v7.triangles))
00479 length = len(_v7.vertices)
00480 buff.write(_struct_I.pack(length))
00481 for val3 in _v7.vertices:
00482 _x = val3
00483 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00484 _v8 = val1.constraint_region_orientation
00485 _x = _v8
00486 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00487 buff.write(_struct_d.pack(val1.weight))
00488 length = len(self.arm_poses.goal_constraints.orientation_constraints)
00489 buff.write(_struct_I.pack(length))
00490 for val1 in self.arm_poses.goal_constraints.orientation_constraints:
00491 _v9 = val1.header
00492 buff.write(_struct_I.pack(_v9.seq))
00493 _v10 = _v9.stamp
00494 _x = _v10
00495 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00496 _x = _v9.frame_id
00497 length = len(_x)
00498 if python3 or type(_x) == unicode:
00499 _x = _x.encode('utf-8')
00500 length = len(_x)
00501 buff.write(struct.pack('<I%ss'%length, length, _x))
00502 _x = val1.link_name
00503 length = len(_x)
00504 if python3 or type(_x) == unicode:
00505 _x = _x.encode('utf-8')
00506 length = len(_x)
00507 buff.write(struct.pack('<I%ss'%length, length, _x))
00508 buff.write(_struct_i.pack(val1.type))
00509 _v11 = val1.orientation
00510 _x = _v11
00511 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00512 _x = val1
00513 buff.write(_struct_4d.pack(_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight))
00514 length = len(self.arm_poses.goal_constraints.visibility_constraints)
00515 buff.write(_struct_I.pack(length))
00516 for val1 in self.arm_poses.goal_constraints.visibility_constraints:
00517 _v12 = val1.header
00518 buff.write(_struct_I.pack(_v12.seq))
00519 _v13 = _v12.stamp
00520 _x = _v13
00521 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00522 _x = _v12.frame_id
00523 length = len(_x)
00524 if python3 or type(_x) == unicode:
00525 _x = _x.encode('utf-8')
00526 length = len(_x)
00527 buff.write(struct.pack('<I%ss'%length, length, _x))
00528 _v14 = val1.target
00529 _v15 = _v14.header
00530 buff.write(_struct_I.pack(_v15.seq))
00531 _v16 = _v15.stamp
00532 _x = _v16
00533 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00534 _x = _v15.frame_id
00535 length = len(_x)
00536 if python3 or type(_x) == unicode:
00537 _x = _x.encode('utf-8')
00538 length = len(_x)
00539 buff.write(struct.pack('<I%ss'%length, length, _x))
00540 _v17 = _v14.point
00541 _x = _v17
00542 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00543 _v18 = val1.sensor_pose
00544 _v19 = _v18.header
00545 buff.write(_struct_I.pack(_v19.seq))
00546 _v20 = _v19.stamp
00547 _x = _v20
00548 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00549 _x = _v19.frame_id
00550 length = len(_x)
00551 if python3 or type(_x) == unicode:
00552 _x = _x.encode('utf-8')
00553 length = len(_x)
00554 buff.write(struct.pack('<I%ss'%length, length, _x))
00555 _v21 = _v18.pose
00556 _v22 = _v21.position
00557 _x = _v22
00558 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00559 _v23 = _v21.orientation
00560 _x = _v23
00561 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00562 buff.write(_struct_d.pack(val1.absolute_tolerance))
00563 length = len(self.arm_poses.path_constraints.joint_constraints)
00564 buff.write(_struct_I.pack(length))
00565 for val1 in self.arm_poses.path_constraints.joint_constraints:
00566 _x = val1.joint_name
00567 length = len(_x)
00568 if python3 or type(_x) == unicode:
00569 _x = _x.encode('utf-8')
00570 length = len(_x)
00571 buff.write(struct.pack('<I%ss'%length, length, _x))
00572 _x = val1
00573 buff.write(_struct_4d.pack(_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight))
00574 length = len(self.arm_poses.path_constraints.position_constraints)
00575 buff.write(_struct_I.pack(length))
00576 for val1 in self.arm_poses.path_constraints.position_constraints:
00577 _v24 = val1.header
00578 buff.write(_struct_I.pack(_v24.seq))
00579 _v25 = _v24.stamp
00580 _x = _v25
00581 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00582 _x = _v24.frame_id
00583 length = len(_x)
00584 if python3 or type(_x) == unicode:
00585 _x = _x.encode('utf-8')
00586 length = len(_x)
00587 buff.write(struct.pack('<I%ss'%length, length, _x))
00588 _x = val1.link_name
00589 length = len(_x)
00590 if python3 or type(_x) == unicode:
00591 _x = _x.encode('utf-8')
00592 length = len(_x)
00593 buff.write(struct.pack('<I%ss'%length, length, _x))
00594 _v26 = val1.target_point_offset
00595 _x = _v26
00596 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00597 _v27 = val1.position
00598 _x = _v27
00599 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00600 _v28 = val1.constraint_region_shape
00601 buff.write(_struct_b.pack(_v28.type))
00602 length = len(_v28.dimensions)
00603 buff.write(_struct_I.pack(length))
00604 pattern = '<%sd'%length
00605 buff.write(struct.pack(pattern, *_v28.dimensions))
00606 length = len(_v28.triangles)
00607 buff.write(_struct_I.pack(length))
00608 pattern = '<%si'%length
00609 buff.write(struct.pack(pattern, *_v28.triangles))
00610 length = len(_v28.vertices)
00611 buff.write(_struct_I.pack(length))
00612 for val3 in _v28.vertices:
00613 _x = val3
00614 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00615 _v29 = val1.constraint_region_orientation
00616 _x = _v29
00617 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00618 buff.write(_struct_d.pack(val1.weight))
00619 length = len(self.arm_poses.path_constraints.orientation_constraints)
00620 buff.write(_struct_I.pack(length))
00621 for val1 in self.arm_poses.path_constraints.orientation_constraints:
00622 _v30 = val1.header
00623 buff.write(_struct_I.pack(_v30.seq))
00624 _v31 = _v30.stamp
00625 _x = _v31
00626 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00627 _x = _v30.frame_id
00628 length = len(_x)
00629 if python3 or type(_x) == unicode:
00630 _x = _x.encode('utf-8')
00631 length = len(_x)
00632 buff.write(struct.pack('<I%ss'%length, length, _x))
00633 _x = val1.link_name
00634 length = len(_x)
00635 if python3 or type(_x) == unicode:
00636 _x = _x.encode('utf-8')
00637 length = len(_x)
00638 buff.write(struct.pack('<I%ss'%length, length, _x))
00639 buff.write(_struct_i.pack(val1.type))
00640 _v32 = val1.orientation
00641 _x = _v32
00642 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00643 _x = val1
00644 buff.write(_struct_4d.pack(_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight))
00645 length = len(self.arm_poses.path_constraints.visibility_constraints)
00646 buff.write(_struct_I.pack(length))
00647 for val1 in self.arm_poses.path_constraints.visibility_constraints:
00648 _v33 = val1.header
00649 buff.write(_struct_I.pack(_v33.seq))
00650 _v34 = _v33.stamp
00651 _x = _v34
00652 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00653 _x = _v33.frame_id
00654 length = len(_x)
00655 if python3 or type(_x) == unicode:
00656 _x = _x.encode('utf-8')
00657 length = len(_x)
00658 buff.write(struct.pack('<I%ss'%length, length, _x))
00659 _v35 = val1.target
00660 _v36 = _v35.header
00661 buff.write(_struct_I.pack(_v36.seq))
00662 _v37 = _v36.stamp
00663 _x = _v37
00664 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00665 _x = _v36.frame_id
00666 length = len(_x)
00667 if python3 or type(_x) == unicode:
00668 _x = _x.encode('utf-8')
00669 length = len(_x)
00670 buff.write(struct.pack('<I%ss'%length, length, _x))
00671 _v38 = _v35.point
00672 _x = _v38
00673 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00674 _v39 = val1.sensor_pose
00675 _v40 = _v39.header
00676 buff.write(_struct_I.pack(_v40.seq))
00677 _v41 = _v40.stamp
00678 _x = _v41
00679 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00680 _x = _v40.frame_id
00681 length = len(_x)
00682 if python3 or type(_x) == unicode:
00683 _x = _x.encode('utf-8')
00684 length = len(_x)
00685 buff.write(struct.pack('<I%ss'%length, length, _x))
00686 _v42 = _v39.pose
00687 _v43 = _v42.position
00688 _x = _v43
00689 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00690 _v44 = _v42.orientation
00691 _x = _v44
00692 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00693 buff.write(_struct_d.pack(val1.absolute_tolerance))
00694 _x = self.arm_poses.planner_id
00695 length = len(_x)
00696 if python3 or type(_x) == unicode:
00697 _x = _x.encode('utf-8')
00698 length = len(_x)
00699 buff.write(struct.pack('<I%ss'%length, length, _x))
00700 _x = self.arm_poses.group_name
00701 length = len(_x)
00702 if python3 or type(_x) == unicode:
00703 _x = _x.encode('utf-8')
00704 length = len(_x)
00705 buff.write(struct.pack('<I%ss'%length, length, _x))
00706 _x = self
00707 buff.write(_struct_7i.pack(_x.arm_poses.num_planning_attempts, _x.arm_poses.allowed_planning_time.secs, _x.arm_poses.allowed_planning_time.nsecs, _x.arm_poses.expected_path_duration.secs, _x.arm_poses.expected_path_duration.nsecs, _x.arm_poses.expected_path_dt.secs, _x.arm_poses.expected_path_dt.nsecs))
00708 _x = self.planner_service_name
00709 length = len(_x)
00710 if python3 or type(_x) == unicode:
00711 _x = _x.encode('utf-8')
00712 length = len(_x)
00713 buff.write(struct.pack('<I%ss'%length, length, _x))
00714 _x = self.state
00715 length = len(_x)
00716 if python3 or type(_x) == unicode:
00717 _x = _x.encode('utf-8')
00718 length = len(_x)
00719 buff.write(struct.pack('<I%ss'%length, length, _x))
00720 except struct.error as se: self._check_types(se)
00721 except TypeError as te: self._check_types(te)
00722
00723 def deserialize(self, str):
00724 """
00725 unpack serialized message in str into this message instance
00726 :param str: byte array of serialized message, ``str``
00727 """
00728 try:
00729 if self.base_poses is None:
00730 self.base_poses = geometry_msgs.msg.PoseStamped()
00731 if self.arm_poses is None:
00732 self.arm_poses = arm_navigation_msgs.msg.MotionPlanRequest()
00733 end = 0
00734 _x = self
00735 start = end
00736 end += 12
00737 (_x.base_poses.header.seq, _x.base_poses.header.stamp.secs, _x.base_poses.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00738 start = end
00739 end += 4
00740 (length,) = _struct_I.unpack(str[start:end])
00741 start = end
00742 end += length
00743 if python3:
00744 self.base_poses.header.frame_id = str[start:end].decode('utf-8')
00745 else:
00746 self.base_poses.header.frame_id = str[start:end]
00747 _x = self
00748 start = end
00749 end += 57
00750 (_x.base_poses.pose.position.x, _x.base_poses.pose.position.y, _x.base_poses.pose.position.z, _x.base_poses.pose.orientation.x, _x.base_poses.pose.orientation.y, _x.base_poses.pose.orientation.z, _x.base_poses.pose.orientation.w, _x.arm_poses.workspace_parameters.workspace_region_shape.type,) = _struct_7db.unpack(str[start:end])
00751 start = end
00752 end += 4
00753 (length,) = _struct_I.unpack(str[start:end])
00754 pattern = '<%sd'%length
00755 start = end
00756 end += struct.calcsize(pattern)
00757 self.arm_poses.workspace_parameters.workspace_region_shape.dimensions = struct.unpack(pattern, str[start:end])
00758 start = end
00759 end += 4
00760 (length,) = _struct_I.unpack(str[start:end])
00761 pattern = '<%si'%length
00762 start = end
00763 end += struct.calcsize(pattern)
00764 self.arm_poses.workspace_parameters.workspace_region_shape.triangles = struct.unpack(pattern, str[start:end])
00765 start = end
00766 end += 4
00767 (length,) = _struct_I.unpack(str[start:end])
00768 self.arm_poses.workspace_parameters.workspace_region_shape.vertices = []
00769 for i in range(0, length):
00770 val1 = geometry_msgs.msg.Point()
00771 _x = val1
00772 start = end
00773 end += 24
00774 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00775 self.arm_poses.workspace_parameters.workspace_region_shape.vertices.append(val1)
00776 _x = self
00777 start = end
00778 end += 12
00779 (_x.arm_poses.workspace_parameters.workspace_region_pose.header.seq, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.secs, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00780 start = end
00781 end += 4
00782 (length,) = _struct_I.unpack(str[start:end])
00783 start = end
00784 end += length
00785 if python3:
00786 self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id = str[start:end].decode('utf-8')
00787 else:
00788 self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id = str[start:end]
00789 _x = self
00790 start = end
00791 end += 68
00792 (_x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.w, _x.arm_poses.start_state.joint_state.header.seq, _x.arm_poses.start_state.joint_state.header.stamp.secs, _x.arm_poses.start_state.joint_state.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00793 start = end
00794 end += 4
00795 (length,) = _struct_I.unpack(str[start:end])
00796 start = end
00797 end += length
00798 if python3:
00799 self.arm_poses.start_state.joint_state.header.frame_id = str[start:end].decode('utf-8')
00800 else:
00801 self.arm_poses.start_state.joint_state.header.frame_id = str[start:end]
00802 start = end
00803 end += 4
00804 (length,) = _struct_I.unpack(str[start:end])
00805 self.arm_poses.start_state.joint_state.name = []
00806 for i in range(0, length):
00807 start = end
00808 end += 4
00809 (length,) = _struct_I.unpack(str[start:end])
00810 start = end
00811 end += length
00812 if python3:
00813 val1 = str[start:end].decode('utf-8')
00814 else:
00815 val1 = str[start:end]
00816 self.arm_poses.start_state.joint_state.name.append(val1)
00817 start = end
00818 end += 4
00819 (length,) = _struct_I.unpack(str[start:end])
00820 pattern = '<%sd'%length
00821 start = end
00822 end += struct.calcsize(pattern)
00823 self.arm_poses.start_state.joint_state.position = struct.unpack(pattern, str[start:end])
00824 start = end
00825 end += 4
00826 (length,) = _struct_I.unpack(str[start:end])
00827 pattern = '<%sd'%length
00828 start = end
00829 end += struct.calcsize(pattern)
00830 self.arm_poses.start_state.joint_state.velocity = struct.unpack(pattern, str[start:end])
00831 start = end
00832 end += 4
00833 (length,) = _struct_I.unpack(str[start:end])
00834 pattern = '<%sd'%length
00835 start = end
00836 end += struct.calcsize(pattern)
00837 self.arm_poses.start_state.joint_state.effort = struct.unpack(pattern, str[start:end])
00838 _x = self
00839 start = end
00840 end += 8
00841 (_x.arm_poses.start_state.multi_dof_joint_state.stamp.secs, _x.arm_poses.start_state.multi_dof_joint_state.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00842 start = end
00843 end += 4
00844 (length,) = _struct_I.unpack(str[start:end])
00845 self.arm_poses.start_state.multi_dof_joint_state.joint_names = []
00846 for i in range(0, length):
00847 start = end
00848 end += 4
00849 (length,) = _struct_I.unpack(str[start:end])
00850 start = end
00851 end += length
00852 if python3:
00853 val1 = str[start:end].decode('utf-8')
00854 else:
00855 val1 = str[start:end]
00856 self.arm_poses.start_state.multi_dof_joint_state.joint_names.append(val1)
00857 start = end
00858 end += 4
00859 (length,) = _struct_I.unpack(str[start:end])
00860 self.arm_poses.start_state.multi_dof_joint_state.frame_ids = []
00861 for i in range(0, length):
00862 start = end
00863 end += 4
00864 (length,) = _struct_I.unpack(str[start:end])
00865 start = end
00866 end += length
00867 if python3:
00868 val1 = str[start:end].decode('utf-8')
00869 else:
00870 val1 = str[start:end]
00871 self.arm_poses.start_state.multi_dof_joint_state.frame_ids.append(val1)
00872 start = end
00873 end += 4
00874 (length,) = _struct_I.unpack(str[start:end])
00875 self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids = []
00876 for i in range(0, length):
00877 start = end
00878 end += 4
00879 (length,) = _struct_I.unpack(str[start:end])
00880 start = end
00881 end += length
00882 if python3:
00883 val1 = str[start:end].decode('utf-8')
00884 else:
00885 val1 = str[start:end]
00886 self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids.append(val1)
00887 start = end
00888 end += 4
00889 (length,) = _struct_I.unpack(str[start:end])
00890 self.arm_poses.start_state.multi_dof_joint_state.poses = []
00891 for i in range(0, length):
00892 val1 = geometry_msgs.msg.Pose()
00893 _v45 = val1.position
00894 _x = _v45
00895 start = end
00896 end += 24
00897 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00898 _v46 = val1.orientation
00899 _x = _v46
00900 start = end
00901 end += 32
00902 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00903 self.arm_poses.start_state.multi_dof_joint_state.poses.append(val1)
00904 start = end
00905 end += 4
00906 (length,) = _struct_I.unpack(str[start:end])
00907 self.arm_poses.goal_constraints.joint_constraints = []
00908 for i in range(0, length):
00909 val1 = arm_navigation_msgs.msg.JointConstraint()
00910 start = end
00911 end += 4
00912 (length,) = _struct_I.unpack(str[start:end])
00913 start = end
00914 end += length
00915 if python3:
00916 val1.joint_name = str[start:end].decode('utf-8')
00917 else:
00918 val1.joint_name = str[start:end]
00919 _x = val1
00920 start = end
00921 end += 32
00922 (_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight,) = _struct_4d.unpack(str[start:end])
00923 self.arm_poses.goal_constraints.joint_constraints.append(val1)
00924 start = end
00925 end += 4
00926 (length,) = _struct_I.unpack(str[start:end])
00927 self.arm_poses.goal_constraints.position_constraints = []
00928 for i in range(0, length):
00929 val1 = arm_navigation_msgs.msg.PositionConstraint()
00930 _v47 = val1.header
00931 start = end
00932 end += 4
00933 (_v47.seq,) = _struct_I.unpack(str[start:end])
00934 _v48 = _v47.stamp
00935 _x = _v48
00936 start = end
00937 end += 8
00938 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00939 start = end
00940 end += 4
00941 (length,) = _struct_I.unpack(str[start:end])
00942 start = end
00943 end += length
00944 if python3:
00945 _v47.frame_id = str[start:end].decode('utf-8')
00946 else:
00947 _v47.frame_id = str[start:end]
00948 start = end
00949 end += 4
00950 (length,) = _struct_I.unpack(str[start:end])
00951 start = end
00952 end += length
00953 if python3:
00954 val1.link_name = str[start:end].decode('utf-8')
00955 else:
00956 val1.link_name = str[start:end]
00957 _v49 = val1.target_point_offset
00958 _x = _v49
00959 start = end
00960 end += 24
00961 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00962 _v50 = val1.position
00963 _x = _v50
00964 start = end
00965 end += 24
00966 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00967 _v51 = val1.constraint_region_shape
00968 start = end
00969 end += 1
00970 (_v51.type,) = _struct_b.unpack(str[start:end])
00971 start = end
00972 end += 4
00973 (length,) = _struct_I.unpack(str[start:end])
00974 pattern = '<%sd'%length
00975 start = end
00976 end += struct.calcsize(pattern)
00977 _v51.dimensions = struct.unpack(pattern, str[start:end])
00978 start = end
00979 end += 4
00980 (length,) = _struct_I.unpack(str[start:end])
00981 pattern = '<%si'%length
00982 start = end
00983 end += struct.calcsize(pattern)
00984 _v51.triangles = struct.unpack(pattern, str[start:end])
00985 start = end
00986 end += 4
00987 (length,) = _struct_I.unpack(str[start:end])
00988 _v51.vertices = []
00989 for i in range(0, length):
00990 val3 = geometry_msgs.msg.Point()
00991 _x = val3
00992 start = end
00993 end += 24
00994 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00995 _v51.vertices.append(val3)
00996 _v52 = val1.constraint_region_orientation
00997 _x = _v52
00998 start = end
00999 end += 32
01000 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01001 start = end
01002 end += 8
01003 (val1.weight,) = _struct_d.unpack(str[start:end])
01004 self.arm_poses.goal_constraints.position_constraints.append(val1)
01005 start = end
01006 end += 4
01007 (length,) = _struct_I.unpack(str[start:end])
01008 self.arm_poses.goal_constraints.orientation_constraints = []
01009 for i in range(0, length):
01010 val1 = arm_navigation_msgs.msg.OrientationConstraint()
01011 _v53 = val1.header
01012 start = end
01013 end += 4
01014 (_v53.seq,) = _struct_I.unpack(str[start:end])
01015 _v54 = _v53.stamp
01016 _x = _v54
01017 start = end
01018 end += 8
01019 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01020 start = end
01021 end += 4
01022 (length,) = _struct_I.unpack(str[start:end])
01023 start = end
01024 end += length
01025 if python3:
01026 _v53.frame_id = str[start:end].decode('utf-8')
01027 else:
01028 _v53.frame_id = str[start:end]
01029 start = end
01030 end += 4
01031 (length,) = _struct_I.unpack(str[start:end])
01032 start = end
01033 end += length
01034 if python3:
01035 val1.link_name = str[start:end].decode('utf-8')
01036 else:
01037 val1.link_name = str[start:end]
01038 start = end
01039 end += 4
01040 (val1.type,) = _struct_i.unpack(str[start:end])
01041 _v55 = val1.orientation
01042 _x = _v55
01043 start = end
01044 end += 32
01045 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01046 _x = val1
01047 start = end
01048 end += 32
01049 (_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight,) = _struct_4d.unpack(str[start:end])
01050 self.arm_poses.goal_constraints.orientation_constraints.append(val1)
01051 start = end
01052 end += 4
01053 (length,) = _struct_I.unpack(str[start:end])
01054 self.arm_poses.goal_constraints.visibility_constraints = []
01055 for i in range(0, length):
01056 val1 = arm_navigation_msgs.msg.VisibilityConstraint()
01057 _v56 = val1.header
01058 start = end
01059 end += 4
01060 (_v56.seq,) = _struct_I.unpack(str[start:end])
01061 _v57 = _v56.stamp
01062 _x = _v57
01063 start = end
01064 end += 8
01065 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01066 start = end
01067 end += 4
01068 (length,) = _struct_I.unpack(str[start:end])
01069 start = end
01070 end += length
01071 if python3:
01072 _v56.frame_id = str[start:end].decode('utf-8')
01073 else:
01074 _v56.frame_id = str[start:end]
01075 _v58 = val1.target
01076 _v59 = _v58.header
01077 start = end
01078 end += 4
01079 (_v59.seq,) = _struct_I.unpack(str[start:end])
01080 _v60 = _v59.stamp
01081 _x = _v60
01082 start = end
01083 end += 8
01084 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01085 start = end
01086 end += 4
01087 (length,) = _struct_I.unpack(str[start:end])
01088 start = end
01089 end += length
01090 if python3:
01091 _v59.frame_id = str[start:end].decode('utf-8')
01092 else:
01093 _v59.frame_id = str[start:end]
01094 _v61 = _v58.point
01095 _x = _v61
01096 start = end
01097 end += 24
01098 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01099 _v62 = val1.sensor_pose
01100 _v63 = _v62.header
01101 start = end
01102 end += 4
01103 (_v63.seq,) = _struct_I.unpack(str[start:end])
01104 _v64 = _v63.stamp
01105 _x = _v64
01106 start = end
01107 end += 8
01108 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01109 start = end
01110 end += 4
01111 (length,) = _struct_I.unpack(str[start:end])
01112 start = end
01113 end += length
01114 if python3:
01115 _v63.frame_id = str[start:end].decode('utf-8')
01116 else:
01117 _v63.frame_id = str[start:end]
01118 _v65 = _v62.pose
01119 _v66 = _v65.position
01120 _x = _v66
01121 start = end
01122 end += 24
01123 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01124 _v67 = _v65.orientation
01125 _x = _v67
01126 start = end
01127 end += 32
01128 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01129 start = end
01130 end += 8
01131 (val1.absolute_tolerance,) = _struct_d.unpack(str[start:end])
01132 self.arm_poses.goal_constraints.visibility_constraints.append(val1)
01133 start = end
01134 end += 4
01135 (length,) = _struct_I.unpack(str[start:end])
01136 self.arm_poses.path_constraints.joint_constraints = []
01137 for i in range(0, length):
01138 val1 = arm_navigation_msgs.msg.JointConstraint()
01139 start = end
01140 end += 4
01141 (length,) = _struct_I.unpack(str[start:end])
01142 start = end
01143 end += length
01144 if python3:
01145 val1.joint_name = str[start:end].decode('utf-8')
01146 else:
01147 val1.joint_name = str[start:end]
01148 _x = val1
01149 start = end
01150 end += 32
01151 (_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight,) = _struct_4d.unpack(str[start:end])
01152 self.arm_poses.path_constraints.joint_constraints.append(val1)
01153 start = end
01154 end += 4
01155 (length,) = _struct_I.unpack(str[start:end])
01156 self.arm_poses.path_constraints.position_constraints = []
01157 for i in range(0, length):
01158 val1 = arm_navigation_msgs.msg.PositionConstraint()
01159 _v68 = val1.header
01160 start = end
01161 end += 4
01162 (_v68.seq,) = _struct_I.unpack(str[start:end])
01163 _v69 = _v68.stamp
01164 _x = _v69
01165 start = end
01166 end += 8
01167 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01168 start = end
01169 end += 4
01170 (length,) = _struct_I.unpack(str[start:end])
01171 start = end
01172 end += length
01173 if python3:
01174 _v68.frame_id = str[start:end].decode('utf-8')
01175 else:
01176 _v68.frame_id = str[start:end]
01177 start = end
01178 end += 4
01179 (length,) = _struct_I.unpack(str[start:end])
01180 start = end
01181 end += length
01182 if python3:
01183 val1.link_name = str[start:end].decode('utf-8')
01184 else:
01185 val1.link_name = str[start:end]
01186 _v70 = val1.target_point_offset
01187 _x = _v70
01188 start = end
01189 end += 24
01190 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01191 _v71 = val1.position
01192 _x = _v71
01193 start = end
01194 end += 24
01195 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01196 _v72 = val1.constraint_region_shape
01197 start = end
01198 end += 1
01199 (_v72.type,) = _struct_b.unpack(str[start:end])
01200 start = end
01201 end += 4
01202 (length,) = _struct_I.unpack(str[start:end])
01203 pattern = '<%sd'%length
01204 start = end
01205 end += struct.calcsize(pattern)
01206 _v72.dimensions = struct.unpack(pattern, str[start:end])
01207 start = end
01208 end += 4
01209 (length,) = _struct_I.unpack(str[start:end])
01210 pattern = '<%si'%length
01211 start = end
01212 end += struct.calcsize(pattern)
01213 _v72.triangles = struct.unpack(pattern, str[start:end])
01214 start = end
01215 end += 4
01216 (length,) = _struct_I.unpack(str[start:end])
01217 _v72.vertices = []
01218 for i in range(0, length):
01219 val3 = geometry_msgs.msg.Point()
01220 _x = val3
01221 start = end
01222 end += 24
01223 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01224 _v72.vertices.append(val3)
01225 _v73 = val1.constraint_region_orientation
01226 _x = _v73
01227 start = end
01228 end += 32
01229 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01230 start = end
01231 end += 8
01232 (val1.weight,) = _struct_d.unpack(str[start:end])
01233 self.arm_poses.path_constraints.position_constraints.append(val1)
01234 start = end
01235 end += 4
01236 (length,) = _struct_I.unpack(str[start:end])
01237 self.arm_poses.path_constraints.orientation_constraints = []
01238 for i in range(0, length):
01239 val1 = arm_navigation_msgs.msg.OrientationConstraint()
01240 _v74 = val1.header
01241 start = end
01242 end += 4
01243 (_v74.seq,) = _struct_I.unpack(str[start:end])
01244 _v75 = _v74.stamp
01245 _x = _v75
01246 start = end
01247 end += 8
01248 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01249 start = end
01250 end += 4
01251 (length,) = _struct_I.unpack(str[start:end])
01252 start = end
01253 end += length
01254 if python3:
01255 _v74.frame_id = str[start:end].decode('utf-8')
01256 else:
01257 _v74.frame_id = str[start:end]
01258 start = end
01259 end += 4
01260 (length,) = _struct_I.unpack(str[start:end])
01261 start = end
01262 end += length
01263 if python3:
01264 val1.link_name = str[start:end].decode('utf-8')
01265 else:
01266 val1.link_name = str[start:end]
01267 start = end
01268 end += 4
01269 (val1.type,) = _struct_i.unpack(str[start:end])
01270 _v76 = val1.orientation
01271 _x = _v76
01272 start = end
01273 end += 32
01274 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01275 _x = val1
01276 start = end
01277 end += 32
01278 (_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight,) = _struct_4d.unpack(str[start:end])
01279 self.arm_poses.path_constraints.orientation_constraints.append(val1)
01280 start = end
01281 end += 4
01282 (length,) = _struct_I.unpack(str[start:end])
01283 self.arm_poses.path_constraints.visibility_constraints = []
01284 for i in range(0, length):
01285 val1 = arm_navigation_msgs.msg.VisibilityConstraint()
01286 _v77 = val1.header
01287 start = end
01288 end += 4
01289 (_v77.seq,) = _struct_I.unpack(str[start:end])
01290 _v78 = _v77.stamp
01291 _x = _v78
01292 start = end
01293 end += 8
01294 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01295 start = end
01296 end += 4
01297 (length,) = _struct_I.unpack(str[start:end])
01298 start = end
01299 end += length
01300 if python3:
01301 _v77.frame_id = str[start:end].decode('utf-8')
01302 else:
01303 _v77.frame_id = str[start:end]
01304 _v79 = val1.target
01305 _v80 = _v79.header
01306 start = end
01307 end += 4
01308 (_v80.seq,) = _struct_I.unpack(str[start:end])
01309 _v81 = _v80.stamp
01310 _x = _v81
01311 start = end
01312 end += 8
01313 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01314 start = end
01315 end += 4
01316 (length,) = _struct_I.unpack(str[start:end])
01317 start = end
01318 end += length
01319 if python3:
01320 _v80.frame_id = str[start:end].decode('utf-8')
01321 else:
01322 _v80.frame_id = str[start:end]
01323 _v82 = _v79.point
01324 _x = _v82
01325 start = end
01326 end += 24
01327 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01328 _v83 = val1.sensor_pose
01329 _v84 = _v83.header
01330 start = end
01331 end += 4
01332 (_v84.seq,) = _struct_I.unpack(str[start:end])
01333 _v85 = _v84.stamp
01334 _x = _v85
01335 start = end
01336 end += 8
01337 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
01338 start = end
01339 end += 4
01340 (length,) = _struct_I.unpack(str[start:end])
01341 start = end
01342 end += length
01343 if python3:
01344 _v84.frame_id = str[start:end].decode('utf-8')
01345 else:
01346 _v84.frame_id = str[start:end]
01347 _v86 = _v83.pose
01348 _v87 = _v86.position
01349 _x = _v87
01350 start = end
01351 end += 24
01352 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01353 _v88 = _v86.orientation
01354 _x = _v88
01355 start = end
01356 end += 32
01357 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01358 start = end
01359 end += 8
01360 (val1.absolute_tolerance,) = _struct_d.unpack(str[start:end])
01361 self.arm_poses.path_constraints.visibility_constraints.append(val1)
01362 start = end
01363 end += 4
01364 (length,) = _struct_I.unpack(str[start:end])
01365 start = end
01366 end += length
01367 if python3:
01368 self.arm_poses.planner_id = str[start:end].decode('utf-8')
01369 else:
01370 self.arm_poses.planner_id = str[start:end]
01371 start = end
01372 end += 4
01373 (length,) = _struct_I.unpack(str[start:end])
01374 start = end
01375 end += length
01376 if python3:
01377 self.arm_poses.group_name = str[start:end].decode('utf-8')
01378 else:
01379 self.arm_poses.group_name = str[start:end]
01380 _x = self
01381 start = end
01382 end += 28
01383 (_x.arm_poses.num_planning_attempts, _x.arm_poses.allowed_planning_time.secs, _x.arm_poses.allowed_planning_time.nsecs, _x.arm_poses.expected_path_duration.secs, _x.arm_poses.expected_path_duration.nsecs, _x.arm_poses.expected_path_dt.secs, _x.arm_poses.expected_path_dt.nsecs,) = _struct_7i.unpack(str[start:end])
01384 start = end
01385 end += 4
01386 (length,) = _struct_I.unpack(str[start:end])
01387 start = end
01388 end += length
01389 if python3:
01390 self.planner_service_name = str[start:end].decode('utf-8')
01391 else:
01392 self.planner_service_name = str[start:end]
01393 start = end
01394 end += 4
01395 (length,) = _struct_I.unpack(str[start:end])
01396 start = end
01397 end += length
01398 if python3:
01399 self.state = str[start:end].decode('utf-8')
01400 else:
01401 self.state = str[start:end]
01402 return self
01403 except struct.error as e:
01404 raise genpy.DeserializationError(e)
01405
01406
01407 def serialize_numpy(self, buff, numpy):
01408 """
01409 serialize message with numpy array types into buffer
01410 :param buff: buffer, ``StringIO``
01411 :param numpy: numpy python module
01412 """
01413 try:
01414 _x = self
01415 buff.write(_struct_3I.pack(_x.base_poses.header.seq, _x.base_poses.header.stamp.secs, _x.base_poses.header.stamp.nsecs))
01416 _x = self.base_poses.header.frame_id
01417 length = len(_x)
01418 if python3 or type(_x) == unicode:
01419 _x = _x.encode('utf-8')
01420 length = len(_x)
01421 buff.write(struct.pack('<I%ss'%length, length, _x))
01422 _x = self
01423 buff.write(_struct_7db.pack(_x.base_poses.pose.position.x, _x.base_poses.pose.position.y, _x.base_poses.pose.position.z, _x.base_poses.pose.orientation.x, _x.base_poses.pose.orientation.y, _x.base_poses.pose.orientation.z, _x.base_poses.pose.orientation.w, _x.arm_poses.workspace_parameters.workspace_region_shape.type))
01424 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.dimensions)
01425 buff.write(_struct_I.pack(length))
01426 pattern = '<%sd'%length
01427 buff.write(self.arm_poses.workspace_parameters.workspace_region_shape.dimensions.tostring())
01428 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.triangles)
01429 buff.write(_struct_I.pack(length))
01430 pattern = '<%si'%length
01431 buff.write(self.arm_poses.workspace_parameters.workspace_region_shape.triangles.tostring())
01432 length = len(self.arm_poses.workspace_parameters.workspace_region_shape.vertices)
01433 buff.write(_struct_I.pack(length))
01434 for val1 in self.arm_poses.workspace_parameters.workspace_region_shape.vertices:
01435 _x = val1
01436 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01437 _x = self
01438 buff.write(_struct_3I.pack(_x.arm_poses.workspace_parameters.workspace_region_pose.header.seq, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.secs, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.nsecs))
01439 _x = self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id
01440 length = len(_x)
01441 if python3 or type(_x) == unicode:
01442 _x = _x.encode('utf-8')
01443 length = len(_x)
01444 buff.write(struct.pack('<I%ss'%length, length, _x))
01445 _x = self
01446 buff.write(_struct_7d3I.pack(_x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.w, _x.arm_poses.start_state.joint_state.header.seq, _x.arm_poses.start_state.joint_state.header.stamp.secs, _x.arm_poses.start_state.joint_state.header.stamp.nsecs))
01447 _x = self.arm_poses.start_state.joint_state.header.frame_id
01448 length = len(_x)
01449 if python3 or type(_x) == unicode:
01450 _x = _x.encode('utf-8')
01451 length = len(_x)
01452 buff.write(struct.pack('<I%ss'%length, length, _x))
01453 length = len(self.arm_poses.start_state.joint_state.name)
01454 buff.write(_struct_I.pack(length))
01455 for val1 in self.arm_poses.start_state.joint_state.name:
01456 length = len(val1)
01457 if python3 or type(val1) == unicode:
01458 val1 = val1.encode('utf-8')
01459 length = len(val1)
01460 buff.write(struct.pack('<I%ss'%length, length, val1))
01461 length = len(self.arm_poses.start_state.joint_state.position)
01462 buff.write(_struct_I.pack(length))
01463 pattern = '<%sd'%length
01464 buff.write(self.arm_poses.start_state.joint_state.position.tostring())
01465 length = len(self.arm_poses.start_state.joint_state.velocity)
01466 buff.write(_struct_I.pack(length))
01467 pattern = '<%sd'%length
01468 buff.write(self.arm_poses.start_state.joint_state.velocity.tostring())
01469 length = len(self.arm_poses.start_state.joint_state.effort)
01470 buff.write(_struct_I.pack(length))
01471 pattern = '<%sd'%length
01472 buff.write(self.arm_poses.start_state.joint_state.effort.tostring())
01473 _x = self
01474 buff.write(_struct_2I.pack(_x.arm_poses.start_state.multi_dof_joint_state.stamp.secs, _x.arm_poses.start_state.multi_dof_joint_state.stamp.nsecs))
01475 length = len(self.arm_poses.start_state.multi_dof_joint_state.joint_names)
01476 buff.write(_struct_I.pack(length))
01477 for val1 in self.arm_poses.start_state.multi_dof_joint_state.joint_names:
01478 length = len(val1)
01479 if python3 or type(val1) == unicode:
01480 val1 = val1.encode('utf-8')
01481 length = len(val1)
01482 buff.write(struct.pack('<I%ss'%length, length, val1))
01483 length = len(self.arm_poses.start_state.multi_dof_joint_state.frame_ids)
01484 buff.write(_struct_I.pack(length))
01485 for val1 in self.arm_poses.start_state.multi_dof_joint_state.frame_ids:
01486 length = len(val1)
01487 if python3 or type(val1) == unicode:
01488 val1 = val1.encode('utf-8')
01489 length = len(val1)
01490 buff.write(struct.pack('<I%ss'%length, length, val1))
01491 length = len(self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids)
01492 buff.write(_struct_I.pack(length))
01493 for val1 in self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids:
01494 length = len(val1)
01495 if python3 or type(val1) == unicode:
01496 val1 = val1.encode('utf-8')
01497 length = len(val1)
01498 buff.write(struct.pack('<I%ss'%length, length, val1))
01499 length = len(self.arm_poses.start_state.multi_dof_joint_state.poses)
01500 buff.write(_struct_I.pack(length))
01501 for val1 in self.arm_poses.start_state.multi_dof_joint_state.poses:
01502 _v89 = val1.position
01503 _x = _v89
01504 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01505 _v90 = val1.orientation
01506 _x = _v90
01507 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01508 length = len(self.arm_poses.goal_constraints.joint_constraints)
01509 buff.write(_struct_I.pack(length))
01510 for val1 in self.arm_poses.goal_constraints.joint_constraints:
01511 _x = val1.joint_name
01512 length = len(_x)
01513 if python3 or type(_x) == unicode:
01514 _x = _x.encode('utf-8')
01515 length = len(_x)
01516 buff.write(struct.pack('<I%ss'%length, length, _x))
01517 _x = val1
01518 buff.write(_struct_4d.pack(_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight))
01519 length = len(self.arm_poses.goal_constraints.position_constraints)
01520 buff.write(_struct_I.pack(length))
01521 for val1 in self.arm_poses.goal_constraints.position_constraints:
01522 _v91 = val1.header
01523 buff.write(_struct_I.pack(_v91.seq))
01524 _v92 = _v91.stamp
01525 _x = _v92
01526 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01527 _x = _v91.frame_id
01528 length = len(_x)
01529 if python3 or type(_x) == unicode:
01530 _x = _x.encode('utf-8')
01531 length = len(_x)
01532 buff.write(struct.pack('<I%ss'%length, length, _x))
01533 _x = val1.link_name
01534 length = len(_x)
01535 if python3 or type(_x) == unicode:
01536 _x = _x.encode('utf-8')
01537 length = len(_x)
01538 buff.write(struct.pack('<I%ss'%length, length, _x))
01539 _v93 = val1.target_point_offset
01540 _x = _v93
01541 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01542 _v94 = val1.position
01543 _x = _v94
01544 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01545 _v95 = val1.constraint_region_shape
01546 buff.write(_struct_b.pack(_v95.type))
01547 length = len(_v95.dimensions)
01548 buff.write(_struct_I.pack(length))
01549 pattern = '<%sd'%length
01550 buff.write(_v95.dimensions.tostring())
01551 length = len(_v95.triangles)
01552 buff.write(_struct_I.pack(length))
01553 pattern = '<%si'%length
01554 buff.write(_v95.triangles.tostring())
01555 length = len(_v95.vertices)
01556 buff.write(_struct_I.pack(length))
01557 for val3 in _v95.vertices:
01558 _x = val3
01559 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01560 _v96 = val1.constraint_region_orientation
01561 _x = _v96
01562 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01563 buff.write(_struct_d.pack(val1.weight))
01564 length = len(self.arm_poses.goal_constraints.orientation_constraints)
01565 buff.write(_struct_I.pack(length))
01566 for val1 in self.arm_poses.goal_constraints.orientation_constraints:
01567 _v97 = val1.header
01568 buff.write(_struct_I.pack(_v97.seq))
01569 _v98 = _v97.stamp
01570 _x = _v98
01571 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01572 _x = _v97.frame_id
01573 length = len(_x)
01574 if python3 or type(_x) == unicode:
01575 _x = _x.encode('utf-8')
01576 length = len(_x)
01577 buff.write(struct.pack('<I%ss'%length, length, _x))
01578 _x = val1.link_name
01579 length = len(_x)
01580 if python3 or type(_x) == unicode:
01581 _x = _x.encode('utf-8')
01582 length = len(_x)
01583 buff.write(struct.pack('<I%ss'%length, length, _x))
01584 buff.write(_struct_i.pack(val1.type))
01585 _v99 = val1.orientation
01586 _x = _v99
01587 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01588 _x = val1
01589 buff.write(_struct_4d.pack(_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight))
01590 length = len(self.arm_poses.goal_constraints.visibility_constraints)
01591 buff.write(_struct_I.pack(length))
01592 for val1 in self.arm_poses.goal_constraints.visibility_constraints:
01593 _v100 = val1.header
01594 buff.write(_struct_I.pack(_v100.seq))
01595 _v101 = _v100.stamp
01596 _x = _v101
01597 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01598 _x = _v100.frame_id
01599 length = len(_x)
01600 if python3 or type(_x) == unicode:
01601 _x = _x.encode('utf-8')
01602 length = len(_x)
01603 buff.write(struct.pack('<I%ss'%length, length, _x))
01604 _v102 = val1.target
01605 _v103 = _v102.header
01606 buff.write(_struct_I.pack(_v103.seq))
01607 _v104 = _v103.stamp
01608 _x = _v104
01609 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01610 _x = _v103.frame_id
01611 length = len(_x)
01612 if python3 or type(_x) == unicode:
01613 _x = _x.encode('utf-8')
01614 length = len(_x)
01615 buff.write(struct.pack('<I%ss'%length, length, _x))
01616 _v105 = _v102.point
01617 _x = _v105
01618 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01619 _v106 = val1.sensor_pose
01620 _v107 = _v106.header
01621 buff.write(_struct_I.pack(_v107.seq))
01622 _v108 = _v107.stamp
01623 _x = _v108
01624 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01625 _x = _v107.frame_id
01626 length = len(_x)
01627 if python3 or type(_x) == unicode:
01628 _x = _x.encode('utf-8')
01629 length = len(_x)
01630 buff.write(struct.pack('<I%ss'%length, length, _x))
01631 _v109 = _v106.pose
01632 _v110 = _v109.position
01633 _x = _v110
01634 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01635 _v111 = _v109.orientation
01636 _x = _v111
01637 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01638 buff.write(_struct_d.pack(val1.absolute_tolerance))
01639 length = len(self.arm_poses.path_constraints.joint_constraints)
01640 buff.write(_struct_I.pack(length))
01641 for val1 in self.arm_poses.path_constraints.joint_constraints:
01642 _x = val1.joint_name
01643 length = len(_x)
01644 if python3 or type(_x) == unicode:
01645 _x = _x.encode('utf-8')
01646 length = len(_x)
01647 buff.write(struct.pack('<I%ss'%length, length, _x))
01648 _x = val1
01649 buff.write(_struct_4d.pack(_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight))
01650 length = len(self.arm_poses.path_constraints.position_constraints)
01651 buff.write(_struct_I.pack(length))
01652 for val1 in self.arm_poses.path_constraints.position_constraints:
01653 _v112 = val1.header
01654 buff.write(_struct_I.pack(_v112.seq))
01655 _v113 = _v112.stamp
01656 _x = _v113
01657 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01658 _x = _v112.frame_id
01659 length = len(_x)
01660 if python3 or type(_x) == unicode:
01661 _x = _x.encode('utf-8')
01662 length = len(_x)
01663 buff.write(struct.pack('<I%ss'%length, length, _x))
01664 _x = val1.link_name
01665 length = len(_x)
01666 if python3 or type(_x) == unicode:
01667 _x = _x.encode('utf-8')
01668 length = len(_x)
01669 buff.write(struct.pack('<I%ss'%length, length, _x))
01670 _v114 = val1.target_point_offset
01671 _x = _v114
01672 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01673 _v115 = val1.position
01674 _x = _v115
01675 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01676 _v116 = val1.constraint_region_shape
01677 buff.write(_struct_b.pack(_v116.type))
01678 length = len(_v116.dimensions)
01679 buff.write(_struct_I.pack(length))
01680 pattern = '<%sd'%length
01681 buff.write(_v116.dimensions.tostring())
01682 length = len(_v116.triangles)
01683 buff.write(_struct_I.pack(length))
01684 pattern = '<%si'%length
01685 buff.write(_v116.triangles.tostring())
01686 length = len(_v116.vertices)
01687 buff.write(_struct_I.pack(length))
01688 for val3 in _v116.vertices:
01689 _x = val3
01690 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01691 _v117 = val1.constraint_region_orientation
01692 _x = _v117
01693 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01694 buff.write(_struct_d.pack(val1.weight))
01695 length = len(self.arm_poses.path_constraints.orientation_constraints)
01696 buff.write(_struct_I.pack(length))
01697 for val1 in self.arm_poses.path_constraints.orientation_constraints:
01698 _v118 = val1.header
01699 buff.write(_struct_I.pack(_v118.seq))
01700 _v119 = _v118.stamp
01701 _x = _v119
01702 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01703 _x = _v118.frame_id
01704 length = len(_x)
01705 if python3 or type(_x) == unicode:
01706 _x = _x.encode('utf-8')
01707 length = len(_x)
01708 buff.write(struct.pack('<I%ss'%length, length, _x))
01709 _x = val1.link_name
01710 length = len(_x)
01711 if python3 or type(_x) == unicode:
01712 _x = _x.encode('utf-8')
01713 length = len(_x)
01714 buff.write(struct.pack('<I%ss'%length, length, _x))
01715 buff.write(_struct_i.pack(val1.type))
01716 _v120 = val1.orientation
01717 _x = _v120
01718 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01719 _x = val1
01720 buff.write(_struct_4d.pack(_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight))
01721 length = len(self.arm_poses.path_constraints.visibility_constraints)
01722 buff.write(_struct_I.pack(length))
01723 for val1 in self.arm_poses.path_constraints.visibility_constraints:
01724 _v121 = val1.header
01725 buff.write(_struct_I.pack(_v121.seq))
01726 _v122 = _v121.stamp
01727 _x = _v122
01728 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01729 _x = _v121.frame_id
01730 length = len(_x)
01731 if python3 or type(_x) == unicode:
01732 _x = _x.encode('utf-8')
01733 length = len(_x)
01734 buff.write(struct.pack('<I%ss'%length, length, _x))
01735 _v123 = val1.target
01736 _v124 = _v123.header
01737 buff.write(_struct_I.pack(_v124.seq))
01738 _v125 = _v124.stamp
01739 _x = _v125
01740 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01741 _x = _v124.frame_id
01742 length = len(_x)
01743 if python3 or type(_x) == unicode:
01744 _x = _x.encode('utf-8')
01745 length = len(_x)
01746 buff.write(struct.pack('<I%ss'%length, length, _x))
01747 _v126 = _v123.point
01748 _x = _v126
01749 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01750 _v127 = val1.sensor_pose
01751 _v128 = _v127.header
01752 buff.write(_struct_I.pack(_v128.seq))
01753 _v129 = _v128.stamp
01754 _x = _v129
01755 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
01756 _x = _v128.frame_id
01757 length = len(_x)
01758 if python3 or type(_x) == unicode:
01759 _x = _x.encode('utf-8')
01760 length = len(_x)
01761 buff.write(struct.pack('<I%ss'%length, length, _x))
01762 _v130 = _v127.pose
01763 _v131 = _v130.position
01764 _x = _v131
01765 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
01766 _v132 = _v130.orientation
01767 _x = _v132
01768 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
01769 buff.write(_struct_d.pack(val1.absolute_tolerance))
01770 _x = self.arm_poses.planner_id
01771 length = len(_x)
01772 if python3 or type(_x) == unicode:
01773 _x = _x.encode('utf-8')
01774 length = len(_x)
01775 buff.write(struct.pack('<I%ss'%length, length, _x))
01776 _x = self.arm_poses.group_name
01777 length = len(_x)
01778 if python3 or type(_x) == unicode:
01779 _x = _x.encode('utf-8')
01780 length = len(_x)
01781 buff.write(struct.pack('<I%ss'%length, length, _x))
01782 _x = self
01783 buff.write(_struct_7i.pack(_x.arm_poses.num_planning_attempts, _x.arm_poses.allowed_planning_time.secs, _x.arm_poses.allowed_planning_time.nsecs, _x.arm_poses.expected_path_duration.secs, _x.arm_poses.expected_path_duration.nsecs, _x.arm_poses.expected_path_dt.secs, _x.arm_poses.expected_path_dt.nsecs))
01784 _x = self.planner_service_name
01785 length = len(_x)
01786 if python3 or type(_x) == unicode:
01787 _x = _x.encode('utf-8')
01788 length = len(_x)
01789 buff.write(struct.pack('<I%ss'%length, length, _x))
01790 _x = self.state
01791 length = len(_x)
01792 if python3 or type(_x) == unicode:
01793 _x = _x.encode('utf-8')
01794 length = len(_x)
01795 buff.write(struct.pack('<I%ss'%length, length, _x))
01796 except struct.error as se: self._check_types(se)
01797 except TypeError as te: self._check_types(te)
01798
01799 def deserialize_numpy(self, str, numpy):
01800 """
01801 unpack serialized message in str into this message instance using numpy for array types
01802 :param str: byte array of serialized message, ``str``
01803 :param numpy: numpy python module
01804 """
01805 try:
01806 if self.base_poses is None:
01807 self.base_poses = geometry_msgs.msg.PoseStamped()
01808 if self.arm_poses is None:
01809 self.arm_poses = arm_navigation_msgs.msg.MotionPlanRequest()
01810 end = 0
01811 _x = self
01812 start = end
01813 end += 12
01814 (_x.base_poses.header.seq, _x.base_poses.header.stamp.secs, _x.base_poses.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
01815 start = end
01816 end += 4
01817 (length,) = _struct_I.unpack(str[start:end])
01818 start = end
01819 end += length
01820 if python3:
01821 self.base_poses.header.frame_id = str[start:end].decode('utf-8')
01822 else:
01823 self.base_poses.header.frame_id = str[start:end]
01824 _x = self
01825 start = end
01826 end += 57
01827 (_x.base_poses.pose.position.x, _x.base_poses.pose.position.y, _x.base_poses.pose.position.z, _x.base_poses.pose.orientation.x, _x.base_poses.pose.orientation.y, _x.base_poses.pose.orientation.z, _x.base_poses.pose.orientation.w, _x.arm_poses.workspace_parameters.workspace_region_shape.type,) = _struct_7db.unpack(str[start:end])
01828 start = end
01829 end += 4
01830 (length,) = _struct_I.unpack(str[start:end])
01831 pattern = '<%sd'%length
01832 start = end
01833 end += struct.calcsize(pattern)
01834 self.arm_poses.workspace_parameters.workspace_region_shape.dimensions = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01835 start = end
01836 end += 4
01837 (length,) = _struct_I.unpack(str[start:end])
01838 pattern = '<%si'%length
01839 start = end
01840 end += struct.calcsize(pattern)
01841 self.arm_poses.workspace_parameters.workspace_region_shape.triangles = numpy.frombuffer(str[start:end], dtype=numpy.int32, count=length)
01842 start = end
01843 end += 4
01844 (length,) = _struct_I.unpack(str[start:end])
01845 self.arm_poses.workspace_parameters.workspace_region_shape.vertices = []
01846 for i in range(0, length):
01847 val1 = geometry_msgs.msg.Point()
01848 _x = val1
01849 start = end
01850 end += 24
01851 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01852 self.arm_poses.workspace_parameters.workspace_region_shape.vertices.append(val1)
01853 _x = self
01854 start = end
01855 end += 12
01856 (_x.arm_poses.workspace_parameters.workspace_region_pose.header.seq, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.secs, _x.arm_poses.workspace_parameters.workspace_region_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
01857 start = end
01858 end += 4
01859 (length,) = _struct_I.unpack(str[start:end])
01860 start = end
01861 end += length
01862 if python3:
01863 self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id = str[start:end].decode('utf-8')
01864 else:
01865 self.arm_poses.workspace_parameters.workspace_region_pose.header.frame_id = str[start:end]
01866 _x = self
01867 start = end
01868 end += 68
01869 (_x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.position.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.x, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.y, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.z, _x.arm_poses.workspace_parameters.workspace_region_pose.pose.orientation.w, _x.arm_poses.start_state.joint_state.header.seq, _x.arm_poses.start_state.joint_state.header.stamp.secs, _x.arm_poses.start_state.joint_state.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
01870 start = end
01871 end += 4
01872 (length,) = _struct_I.unpack(str[start:end])
01873 start = end
01874 end += length
01875 if python3:
01876 self.arm_poses.start_state.joint_state.header.frame_id = str[start:end].decode('utf-8')
01877 else:
01878 self.arm_poses.start_state.joint_state.header.frame_id = str[start:end]
01879 start = end
01880 end += 4
01881 (length,) = _struct_I.unpack(str[start:end])
01882 self.arm_poses.start_state.joint_state.name = []
01883 for i in range(0, length):
01884 start = end
01885 end += 4
01886 (length,) = _struct_I.unpack(str[start:end])
01887 start = end
01888 end += length
01889 if python3:
01890 val1 = str[start:end].decode('utf-8')
01891 else:
01892 val1 = str[start:end]
01893 self.arm_poses.start_state.joint_state.name.append(val1)
01894 start = end
01895 end += 4
01896 (length,) = _struct_I.unpack(str[start:end])
01897 pattern = '<%sd'%length
01898 start = end
01899 end += struct.calcsize(pattern)
01900 self.arm_poses.start_state.joint_state.position = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01901 start = end
01902 end += 4
01903 (length,) = _struct_I.unpack(str[start:end])
01904 pattern = '<%sd'%length
01905 start = end
01906 end += struct.calcsize(pattern)
01907 self.arm_poses.start_state.joint_state.velocity = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01908 start = end
01909 end += 4
01910 (length,) = _struct_I.unpack(str[start:end])
01911 pattern = '<%sd'%length
01912 start = end
01913 end += struct.calcsize(pattern)
01914 self.arm_poses.start_state.joint_state.effort = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
01915 _x = self
01916 start = end
01917 end += 8
01918 (_x.arm_poses.start_state.multi_dof_joint_state.stamp.secs, _x.arm_poses.start_state.multi_dof_joint_state.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
01919 start = end
01920 end += 4
01921 (length,) = _struct_I.unpack(str[start:end])
01922 self.arm_poses.start_state.multi_dof_joint_state.joint_names = []
01923 for i in range(0, length):
01924 start = end
01925 end += 4
01926 (length,) = _struct_I.unpack(str[start:end])
01927 start = end
01928 end += length
01929 if python3:
01930 val1 = str[start:end].decode('utf-8')
01931 else:
01932 val1 = str[start:end]
01933 self.arm_poses.start_state.multi_dof_joint_state.joint_names.append(val1)
01934 start = end
01935 end += 4
01936 (length,) = _struct_I.unpack(str[start:end])
01937 self.arm_poses.start_state.multi_dof_joint_state.frame_ids = []
01938 for i in range(0, length):
01939 start = end
01940 end += 4
01941 (length,) = _struct_I.unpack(str[start:end])
01942 start = end
01943 end += length
01944 if python3:
01945 val1 = str[start:end].decode('utf-8')
01946 else:
01947 val1 = str[start:end]
01948 self.arm_poses.start_state.multi_dof_joint_state.frame_ids.append(val1)
01949 start = end
01950 end += 4
01951 (length,) = _struct_I.unpack(str[start:end])
01952 self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids = []
01953 for i in range(0, length):
01954 start = end
01955 end += 4
01956 (length,) = _struct_I.unpack(str[start:end])
01957 start = end
01958 end += length
01959 if python3:
01960 val1 = str[start:end].decode('utf-8')
01961 else:
01962 val1 = str[start:end]
01963 self.arm_poses.start_state.multi_dof_joint_state.child_frame_ids.append(val1)
01964 start = end
01965 end += 4
01966 (length,) = _struct_I.unpack(str[start:end])
01967 self.arm_poses.start_state.multi_dof_joint_state.poses = []
01968 for i in range(0, length):
01969 val1 = geometry_msgs.msg.Pose()
01970 _v133 = val1.position
01971 _x = _v133
01972 start = end
01973 end += 24
01974 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
01975 _v134 = val1.orientation
01976 _x = _v134
01977 start = end
01978 end += 32
01979 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
01980 self.arm_poses.start_state.multi_dof_joint_state.poses.append(val1)
01981 start = end
01982 end += 4
01983 (length,) = _struct_I.unpack(str[start:end])
01984 self.arm_poses.goal_constraints.joint_constraints = []
01985 for i in range(0, length):
01986 val1 = arm_navigation_msgs.msg.JointConstraint()
01987 start = end
01988 end += 4
01989 (length,) = _struct_I.unpack(str[start:end])
01990 start = end
01991 end += length
01992 if python3:
01993 val1.joint_name = str[start:end].decode('utf-8')
01994 else:
01995 val1.joint_name = str[start:end]
01996 _x = val1
01997 start = end
01998 end += 32
01999 (_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight,) = _struct_4d.unpack(str[start:end])
02000 self.arm_poses.goal_constraints.joint_constraints.append(val1)
02001 start = end
02002 end += 4
02003 (length,) = _struct_I.unpack(str[start:end])
02004 self.arm_poses.goal_constraints.position_constraints = []
02005 for i in range(0, length):
02006 val1 = arm_navigation_msgs.msg.PositionConstraint()
02007 _v135 = val1.header
02008 start = end
02009 end += 4
02010 (_v135.seq,) = _struct_I.unpack(str[start:end])
02011 _v136 = _v135.stamp
02012 _x = _v136
02013 start = end
02014 end += 8
02015 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02016 start = end
02017 end += 4
02018 (length,) = _struct_I.unpack(str[start:end])
02019 start = end
02020 end += length
02021 if python3:
02022 _v135.frame_id = str[start:end].decode('utf-8')
02023 else:
02024 _v135.frame_id = str[start:end]
02025 start = end
02026 end += 4
02027 (length,) = _struct_I.unpack(str[start:end])
02028 start = end
02029 end += length
02030 if python3:
02031 val1.link_name = str[start:end].decode('utf-8')
02032 else:
02033 val1.link_name = str[start:end]
02034 _v137 = val1.target_point_offset
02035 _x = _v137
02036 start = end
02037 end += 24
02038 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02039 _v138 = val1.position
02040 _x = _v138
02041 start = end
02042 end += 24
02043 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02044 _v139 = val1.constraint_region_shape
02045 start = end
02046 end += 1
02047 (_v139.type,) = _struct_b.unpack(str[start:end])
02048 start = end
02049 end += 4
02050 (length,) = _struct_I.unpack(str[start:end])
02051 pattern = '<%sd'%length
02052 start = end
02053 end += struct.calcsize(pattern)
02054 _v139.dimensions = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
02055 start = end
02056 end += 4
02057 (length,) = _struct_I.unpack(str[start:end])
02058 pattern = '<%si'%length
02059 start = end
02060 end += struct.calcsize(pattern)
02061 _v139.triangles = numpy.frombuffer(str[start:end], dtype=numpy.int32, count=length)
02062 start = end
02063 end += 4
02064 (length,) = _struct_I.unpack(str[start:end])
02065 _v139.vertices = []
02066 for i in range(0, length):
02067 val3 = geometry_msgs.msg.Point()
02068 _x = val3
02069 start = end
02070 end += 24
02071 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02072 _v139.vertices.append(val3)
02073 _v140 = val1.constraint_region_orientation
02074 _x = _v140
02075 start = end
02076 end += 32
02077 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02078 start = end
02079 end += 8
02080 (val1.weight,) = _struct_d.unpack(str[start:end])
02081 self.arm_poses.goal_constraints.position_constraints.append(val1)
02082 start = end
02083 end += 4
02084 (length,) = _struct_I.unpack(str[start:end])
02085 self.arm_poses.goal_constraints.orientation_constraints = []
02086 for i in range(0, length):
02087 val1 = arm_navigation_msgs.msg.OrientationConstraint()
02088 _v141 = val1.header
02089 start = end
02090 end += 4
02091 (_v141.seq,) = _struct_I.unpack(str[start:end])
02092 _v142 = _v141.stamp
02093 _x = _v142
02094 start = end
02095 end += 8
02096 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02097 start = end
02098 end += 4
02099 (length,) = _struct_I.unpack(str[start:end])
02100 start = end
02101 end += length
02102 if python3:
02103 _v141.frame_id = str[start:end].decode('utf-8')
02104 else:
02105 _v141.frame_id = str[start:end]
02106 start = end
02107 end += 4
02108 (length,) = _struct_I.unpack(str[start:end])
02109 start = end
02110 end += length
02111 if python3:
02112 val1.link_name = str[start:end].decode('utf-8')
02113 else:
02114 val1.link_name = str[start:end]
02115 start = end
02116 end += 4
02117 (val1.type,) = _struct_i.unpack(str[start:end])
02118 _v143 = val1.orientation
02119 _x = _v143
02120 start = end
02121 end += 32
02122 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02123 _x = val1
02124 start = end
02125 end += 32
02126 (_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight,) = _struct_4d.unpack(str[start:end])
02127 self.arm_poses.goal_constraints.orientation_constraints.append(val1)
02128 start = end
02129 end += 4
02130 (length,) = _struct_I.unpack(str[start:end])
02131 self.arm_poses.goal_constraints.visibility_constraints = []
02132 for i in range(0, length):
02133 val1 = arm_navigation_msgs.msg.VisibilityConstraint()
02134 _v144 = val1.header
02135 start = end
02136 end += 4
02137 (_v144.seq,) = _struct_I.unpack(str[start:end])
02138 _v145 = _v144.stamp
02139 _x = _v145
02140 start = end
02141 end += 8
02142 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02143 start = end
02144 end += 4
02145 (length,) = _struct_I.unpack(str[start:end])
02146 start = end
02147 end += length
02148 if python3:
02149 _v144.frame_id = str[start:end].decode('utf-8')
02150 else:
02151 _v144.frame_id = str[start:end]
02152 _v146 = val1.target
02153 _v147 = _v146.header
02154 start = end
02155 end += 4
02156 (_v147.seq,) = _struct_I.unpack(str[start:end])
02157 _v148 = _v147.stamp
02158 _x = _v148
02159 start = end
02160 end += 8
02161 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02162 start = end
02163 end += 4
02164 (length,) = _struct_I.unpack(str[start:end])
02165 start = end
02166 end += length
02167 if python3:
02168 _v147.frame_id = str[start:end].decode('utf-8')
02169 else:
02170 _v147.frame_id = str[start:end]
02171 _v149 = _v146.point
02172 _x = _v149
02173 start = end
02174 end += 24
02175 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02176 _v150 = val1.sensor_pose
02177 _v151 = _v150.header
02178 start = end
02179 end += 4
02180 (_v151.seq,) = _struct_I.unpack(str[start:end])
02181 _v152 = _v151.stamp
02182 _x = _v152
02183 start = end
02184 end += 8
02185 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02186 start = end
02187 end += 4
02188 (length,) = _struct_I.unpack(str[start:end])
02189 start = end
02190 end += length
02191 if python3:
02192 _v151.frame_id = str[start:end].decode('utf-8')
02193 else:
02194 _v151.frame_id = str[start:end]
02195 _v153 = _v150.pose
02196 _v154 = _v153.position
02197 _x = _v154
02198 start = end
02199 end += 24
02200 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02201 _v155 = _v153.orientation
02202 _x = _v155
02203 start = end
02204 end += 32
02205 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02206 start = end
02207 end += 8
02208 (val1.absolute_tolerance,) = _struct_d.unpack(str[start:end])
02209 self.arm_poses.goal_constraints.visibility_constraints.append(val1)
02210 start = end
02211 end += 4
02212 (length,) = _struct_I.unpack(str[start:end])
02213 self.arm_poses.path_constraints.joint_constraints = []
02214 for i in range(0, length):
02215 val1 = arm_navigation_msgs.msg.JointConstraint()
02216 start = end
02217 end += 4
02218 (length,) = _struct_I.unpack(str[start:end])
02219 start = end
02220 end += length
02221 if python3:
02222 val1.joint_name = str[start:end].decode('utf-8')
02223 else:
02224 val1.joint_name = str[start:end]
02225 _x = val1
02226 start = end
02227 end += 32
02228 (_x.position, _x.tolerance_above, _x.tolerance_below, _x.weight,) = _struct_4d.unpack(str[start:end])
02229 self.arm_poses.path_constraints.joint_constraints.append(val1)
02230 start = end
02231 end += 4
02232 (length,) = _struct_I.unpack(str[start:end])
02233 self.arm_poses.path_constraints.position_constraints = []
02234 for i in range(0, length):
02235 val1 = arm_navigation_msgs.msg.PositionConstraint()
02236 _v156 = val1.header
02237 start = end
02238 end += 4
02239 (_v156.seq,) = _struct_I.unpack(str[start:end])
02240 _v157 = _v156.stamp
02241 _x = _v157
02242 start = end
02243 end += 8
02244 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02245 start = end
02246 end += 4
02247 (length,) = _struct_I.unpack(str[start:end])
02248 start = end
02249 end += length
02250 if python3:
02251 _v156.frame_id = str[start:end].decode('utf-8')
02252 else:
02253 _v156.frame_id = str[start:end]
02254 start = end
02255 end += 4
02256 (length,) = _struct_I.unpack(str[start:end])
02257 start = end
02258 end += length
02259 if python3:
02260 val1.link_name = str[start:end].decode('utf-8')
02261 else:
02262 val1.link_name = str[start:end]
02263 _v158 = val1.target_point_offset
02264 _x = _v158
02265 start = end
02266 end += 24
02267 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02268 _v159 = val1.position
02269 _x = _v159
02270 start = end
02271 end += 24
02272 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02273 _v160 = val1.constraint_region_shape
02274 start = end
02275 end += 1
02276 (_v160.type,) = _struct_b.unpack(str[start:end])
02277 start = end
02278 end += 4
02279 (length,) = _struct_I.unpack(str[start:end])
02280 pattern = '<%sd'%length
02281 start = end
02282 end += struct.calcsize(pattern)
02283 _v160.dimensions = numpy.frombuffer(str[start:end], dtype=numpy.float64, count=length)
02284 start = end
02285 end += 4
02286 (length,) = _struct_I.unpack(str[start:end])
02287 pattern = '<%si'%length
02288 start = end
02289 end += struct.calcsize(pattern)
02290 _v160.triangles = numpy.frombuffer(str[start:end], dtype=numpy.int32, count=length)
02291 start = end
02292 end += 4
02293 (length,) = _struct_I.unpack(str[start:end])
02294 _v160.vertices = []
02295 for i in range(0, length):
02296 val3 = geometry_msgs.msg.Point()
02297 _x = val3
02298 start = end
02299 end += 24
02300 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02301 _v160.vertices.append(val3)
02302 _v161 = val1.constraint_region_orientation
02303 _x = _v161
02304 start = end
02305 end += 32
02306 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02307 start = end
02308 end += 8
02309 (val1.weight,) = _struct_d.unpack(str[start:end])
02310 self.arm_poses.path_constraints.position_constraints.append(val1)
02311 start = end
02312 end += 4
02313 (length,) = _struct_I.unpack(str[start:end])
02314 self.arm_poses.path_constraints.orientation_constraints = []
02315 for i in range(0, length):
02316 val1 = arm_navigation_msgs.msg.OrientationConstraint()
02317 _v162 = val1.header
02318 start = end
02319 end += 4
02320 (_v162.seq,) = _struct_I.unpack(str[start:end])
02321 _v163 = _v162.stamp
02322 _x = _v163
02323 start = end
02324 end += 8
02325 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02326 start = end
02327 end += 4
02328 (length,) = _struct_I.unpack(str[start:end])
02329 start = end
02330 end += length
02331 if python3:
02332 _v162.frame_id = str[start:end].decode('utf-8')
02333 else:
02334 _v162.frame_id = str[start:end]
02335 start = end
02336 end += 4
02337 (length,) = _struct_I.unpack(str[start:end])
02338 start = end
02339 end += length
02340 if python3:
02341 val1.link_name = str[start:end].decode('utf-8')
02342 else:
02343 val1.link_name = str[start:end]
02344 start = end
02345 end += 4
02346 (val1.type,) = _struct_i.unpack(str[start:end])
02347 _v164 = val1.orientation
02348 _x = _v164
02349 start = end
02350 end += 32
02351 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02352 _x = val1
02353 start = end
02354 end += 32
02355 (_x.absolute_roll_tolerance, _x.absolute_pitch_tolerance, _x.absolute_yaw_tolerance, _x.weight,) = _struct_4d.unpack(str[start:end])
02356 self.arm_poses.path_constraints.orientation_constraints.append(val1)
02357 start = end
02358 end += 4
02359 (length,) = _struct_I.unpack(str[start:end])
02360 self.arm_poses.path_constraints.visibility_constraints = []
02361 for i in range(0, length):
02362 val1 = arm_navigation_msgs.msg.VisibilityConstraint()
02363 _v165 = val1.header
02364 start = end
02365 end += 4
02366 (_v165.seq,) = _struct_I.unpack(str[start:end])
02367 _v166 = _v165.stamp
02368 _x = _v166
02369 start = end
02370 end += 8
02371 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02372 start = end
02373 end += 4
02374 (length,) = _struct_I.unpack(str[start:end])
02375 start = end
02376 end += length
02377 if python3:
02378 _v165.frame_id = str[start:end].decode('utf-8')
02379 else:
02380 _v165.frame_id = str[start:end]
02381 _v167 = val1.target
02382 _v168 = _v167.header
02383 start = end
02384 end += 4
02385 (_v168.seq,) = _struct_I.unpack(str[start:end])
02386 _v169 = _v168.stamp
02387 _x = _v169
02388 start = end
02389 end += 8
02390 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02391 start = end
02392 end += 4
02393 (length,) = _struct_I.unpack(str[start:end])
02394 start = end
02395 end += length
02396 if python3:
02397 _v168.frame_id = str[start:end].decode('utf-8')
02398 else:
02399 _v168.frame_id = str[start:end]
02400 _v170 = _v167.point
02401 _x = _v170
02402 start = end
02403 end += 24
02404 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02405 _v171 = val1.sensor_pose
02406 _v172 = _v171.header
02407 start = end
02408 end += 4
02409 (_v172.seq,) = _struct_I.unpack(str[start:end])
02410 _v173 = _v172.stamp
02411 _x = _v173
02412 start = end
02413 end += 8
02414 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
02415 start = end
02416 end += 4
02417 (length,) = _struct_I.unpack(str[start:end])
02418 start = end
02419 end += length
02420 if python3:
02421 _v172.frame_id = str[start:end].decode('utf-8')
02422 else:
02423 _v172.frame_id = str[start:end]
02424 _v174 = _v171.pose
02425 _v175 = _v174.position
02426 _x = _v175
02427 start = end
02428 end += 24
02429 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
02430 _v176 = _v174.orientation
02431 _x = _v176
02432 start = end
02433 end += 32
02434 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
02435 start = end
02436 end += 8
02437 (val1.absolute_tolerance,) = _struct_d.unpack(str[start:end])
02438 self.arm_poses.path_constraints.visibility_constraints.append(val1)
02439 start = end
02440 end += 4
02441 (length,) = _struct_I.unpack(str[start:end])
02442 start = end
02443 end += length
02444 if python3:
02445 self.arm_poses.planner_id = str[start:end].decode('utf-8')
02446 else:
02447 self.arm_poses.planner_id = str[start:end]
02448 start = end
02449 end += 4
02450 (length,) = _struct_I.unpack(str[start:end])
02451 start = end
02452 end += length
02453 if python3:
02454 self.arm_poses.group_name = str[start:end].decode('utf-8')
02455 else:
02456 self.arm_poses.group_name = str[start:end]
02457 _x = self
02458 start = end
02459 end += 28
02460 (_x.arm_poses.num_planning_attempts, _x.arm_poses.allowed_planning_time.secs, _x.arm_poses.allowed_planning_time.nsecs, _x.arm_poses.expected_path_duration.secs, _x.arm_poses.expected_path_duration.nsecs, _x.arm_poses.expected_path_dt.secs, _x.arm_poses.expected_path_dt.nsecs,) = _struct_7i.unpack(str[start:end])
02461 start = end
02462 end += 4
02463 (length,) = _struct_I.unpack(str[start:end])
02464 start = end
02465 end += length
02466 if python3:
02467 self.planner_service_name = str[start:end].decode('utf-8')
02468 else:
02469 self.planner_service_name = str[start:end]
02470 start = end
02471 end += 4
02472 (length,) = _struct_I.unpack(str[start:end])
02473 start = end
02474 end += length
02475 if python3:
02476 self.state = str[start:end].decode('utf-8')
02477 else:
02478 self.state = str[start:end]
02479 return self
02480 except struct.error as e:
02481 raise genpy.DeserializationError(e)
02482
02483 _struct_I = genpy.struct_I
02484 _struct_7db = struct.Struct("<7db")
02485 _struct_b = struct.Struct("<b")
02486 _struct_d = struct.Struct("<d")
02487 _struct_7i = struct.Struct("<7i")
02488 _struct_2I = struct.Struct("<2I")
02489 _struct_i = struct.Struct("<i")
02490 _struct_3I = struct.Struct("<3I")
02491 _struct_4d = struct.Struct("<4d")
02492 _struct_7d3I = struct.Struct("<7d3I")
02493 _struct_3d = struct.Struct("<3d")