00001 """autogenerated by genpy from iri_wam_cartesian_planning/PosePathRequest.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 geometry_msgs.msg
00008 import std_msgs.msg
00009
00010 class PosePathRequest(genpy.Message):
00011 _md5sum = "7fc2e660c267a5557c9f8ad5ce85acfd"
00012 _type = "iri_wam_cartesian_planning/PosePathRequest"
00013 _has_header = False
00014 _full_text = """geometry_msgs/PoseStamped init_pose
00015 geometry_msgs/PoseStamped goal_pose
00016 int16 states
00017
00018 ================================================================================
00019 MSG: geometry_msgs/PoseStamped
00020 # A Pose with reference coordinate frame and timestamp
00021 Header header
00022 Pose pose
00023
00024 ================================================================================
00025 MSG: std_msgs/Header
00026 # Standard metadata for higher-level stamped data types.
00027 # This is generally used to communicate timestamped data
00028 # in a particular coordinate frame.
00029 #
00030 # sequence ID: consecutively increasing ID
00031 uint32 seq
00032 #Two-integer timestamp that is expressed as:
00033 # * stamp.secs: seconds (stamp_secs) since epoch
00034 # * stamp.nsecs: nanoseconds since stamp_secs
00035 # time-handling sugar is provided by the client library
00036 time stamp
00037 #Frame this data is associated with
00038 # 0: no frame
00039 # 1: global frame
00040 string frame_id
00041
00042 ================================================================================
00043 MSG: geometry_msgs/Pose
00044 # A representation of pose in free space, composed of postion and orientation.
00045 Point position
00046 Quaternion orientation
00047
00048 ================================================================================
00049 MSG: geometry_msgs/Point
00050 # This contains the position of a point in free space
00051 float64 x
00052 float64 y
00053 float64 z
00054
00055 ================================================================================
00056 MSG: geometry_msgs/Quaternion
00057 # This represents an orientation in free space in quaternion form.
00058
00059 float64 x
00060 float64 y
00061 float64 z
00062 float64 w
00063
00064 """
00065 __slots__ = ['init_pose','goal_pose','states']
00066 _slot_types = ['geometry_msgs/PoseStamped','geometry_msgs/PoseStamped','int16']
00067
00068 def __init__(self, *args, **kwds):
00069 """
00070 Constructor. Any message fields that are implicitly/explicitly
00071 set to None will be assigned a default value. The recommend
00072 use is keyword arguments as this is more robust to future message
00073 changes. You cannot mix in-order arguments and keyword arguments.
00074
00075 The available fields are:
00076 init_pose,goal_pose,states
00077
00078 :param args: complete set of field values, in .msg order
00079 :param kwds: use keyword arguments corresponding to message field names
00080 to set specific fields.
00081 """
00082 if args or kwds:
00083 super(PosePathRequest, self).__init__(*args, **kwds)
00084
00085 if self.init_pose is None:
00086 self.init_pose = geometry_msgs.msg.PoseStamped()
00087 if self.goal_pose is None:
00088 self.goal_pose = geometry_msgs.msg.PoseStamped()
00089 if self.states is None:
00090 self.states = 0
00091 else:
00092 self.init_pose = geometry_msgs.msg.PoseStamped()
00093 self.goal_pose = geometry_msgs.msg.PoseStamped()
00094 self.states = 0
00095
00096 def _get_types(self):
00097 """
00098 internal API method
00099 """
00100 return self._slot_types
00101
00102 def serialize(self, buff):
00103 """
00104 serialize message into buffer
00105 :param buff: buffer, ``StringIO``
00106 """
00107 try:
00108 _x = self
00109 buff.write(_struct_3I.pack(_x.init_pose.header.seq, _x.init_pose.header.stamp.secs, _x.init_pose.header.stamp.nsecs))
00110 _x = self.init_pose.header.frame_id
00111 length = len(_x)
00112 if python3 or type(_x) == unicode:
00113 _x = _x.encode('utf-8')
00114 length = len(_x)
00115 buff.write(struct.pack('<I%ss'%length, length, _x))
00116 _x = self
00117 buff.write(_struct_7d3I.pack(_x.init_pose.pose.position.x, _x.init_pose.pose.position.y, _x.init_pose.pose.position.z, _x.init_pose.pose.orientation.x, _x.init_pose.pose.orientation.y, _x.init_pose.pose.orientation.z, _x.init_pose.pose.orientation.w, _x.goal_pose.header.seq, _x.goal_pose.header.stamp.secs, _x.goal_pose.header.stamp.nsecs))
00118 _x = self.goal_pose.header.frame_id
00119 length = len(_x)
00120 if python3 or type(_x) == unicode:
00121 _x = _x.encode('utf-8')
00122 length = len(_x)
00123 buff.write(struct.pack('<I%ss'%length, length, _x))
00124 _x = self
00125 buff.write(_struct_7dh.pack(_x.goal_pose.pose.position.x, _x.goal_pose.pose.position.y, _x.goal_pose.pose.position.z, _x.goal_pose.pose.orientation.x, _x.goal_pose.pose.orientation.y, _x.goal_pose.pose.orientation.z, _x.goal_pose.pose.orientation.w, _x.states))
00126 except struct.error as se: self._check_types(se)
00127 except TypeError as te: self._check_types(te)
00128
00129 def deserialize(self, str):
00130 """
00131 unpack serialized message in str into this message instance
00132 :param str: byte array of serialized message, ``str``
00133 """
00134 try:
00135 if self.init_pose is None:
00136 self.init_pose = geometry_msgs.msg.PoseStamped()
00137 if self.goal_pose is None:
00138 self.goal_pose = geometry_msgs.msg.PoseStamped()
00139 end = 0
00140 _x = self
00141 start = end
00142 end += 12
00143 (_x.init_pose.header.seq, _x.init_pose.header.stamp.secs, _x.init_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00144 start = end
00145 end += 4
00146 (length,) = _struct_I.unpack(str[start:end])
00147 start = end
00148 end += length
00149 if python3:
00150 self.init_pose.header.frame_id = str[start:end].decode('utf-8')
00151 else:
00152 self.init_pose.header.frame_id = str[start:end]
00153 _x = self
00154 start = end
00155 end += 68
00156 (_x.init_pose.pose.position.x, _x.init_pose.pose.position.y, _x.init_pose.pose.position.z, _x.init_pose.pose.orientation.x, _x.init_pose.pose.orientation.y, _x.init_pose.pose.orientation.z, _x.init_pose.pose.orientation.w, _x.goal_pose.header.seq, _x.goal_pose.header.stamp.secs, _x.goal_pose.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00157 start = end
00158 end += 4
00159 (length,) = _struct_I.unpack(str[start:end])
00160 start = end
00161 end += length
00162 if python3:
00163 self.goal_pose.header.frame_id = str[start:end].decode('utf-8')
00164 else:
00165 self.goal_pose.header.frame_id = str[start:end]
00166 _x = self
00167 start = end
00168 end += 58
00169 (_x.goal_pose.pose.position.x, _x.goal_pose.pose.position.y, _x.goal_pose.pose.position.z, _x.goal_pose.pose.orientation.x, _x.goal_pose.pose.orientation.y, _x.goal_pose.pose.orientation.z, _x.goal_pose.pose.orientation.w, _x.states,) = _struct_7dh.unpack(str[start:end])
00170 return self
00171 except struct.error as e:
00172 raise genpy.DeserializationError(e)
00173
00174
00175 def serialize_numpy(self, buff, numpy):
00176 """
00177 serialize message with numpy array types into buffer
00178 :param buff: buffer, ``StringIO``
00179 :param numpy: numpy python module
00180 """
00181 try:
00182 _x = self
00183 buff.write(_struct_3I.pack(_x.init_pose.header.seq, _x.init_pose.header.stamp.secs, _x.init_pose.header.stamp.nsecs))
00184 _x = self.init_pose.header.frame_id
00185 length = len(_x)
00186 if python3 or type(_x) == unicode:
00187 _x = _x.encode('utf-8')
00188 length = len(_x)
00189 buff.write(struct.pack('<I%ss'%length, length, _x))
00190 _x = self
00191 buff.write(_struct_7d3I.pack(_x.init_pose.pose.position.x, _x.init_pose.pose.position.y, _x.init_pose.pose.position.z, _x.init_pose.pose.orientation.x, _x.init_pose.pose.orientation.y, _x.init_pose.pose.orientation.z, _x.init_pose.pose.orientation.w, _x.goal_pose.header.seq, _x.goal_pose.header.stamp.secs, _x.goal_pose.header.stamp.nsecs))
00192 _x = self.goal_pose.header.frame_id
00193 length = len(_x)
00194 if python3 or type(_x) == unicode:
00195 _x = _x.encode('utf-8')
00196 length = len(_x)
00197 buff.write(struct.pack('<I%ss'%length, length, _x))
00198 _x = self
00199 buff.write(_struct_7dh.pack(_x.goal_pose.pose.position.x, _x.goal_pose.pose.position.y, _x.goal_pose.pose.position.z, _x.goal_pose.pose.orientation.x, _x.goal_pose.pose.orientation.y, _x.goal_pose.pose.orientation.z, _x.goal_pose.pose.orientation.w, _x.states))
00200 except struct.error as se: self._check_types(se)
00201 except TypeError as te: self._check_types(te)
00202
00203 def deserialize_numpy(self, str, numpy):
00204 """
00205 unpack serialized message in str into this message instance using numpy for array types
00206 :param str: byte array of serialized message, ``str``
00207 :param numpy: numpy python module
00208 """
00209 try:
00210 if self.init_pose is None:
00211 self.init_pose = geometry_msgs.msg.PoseStamped()
00212 if self.goal_pose is None:
00213 self.goal_pose = geometry_msgs.msg.PoseStamped()
00214 end = 0
00215 _x = self
00216 start = end
00217 end += 12
00218 (_x.init_pose.header.seq, _x.init_pose.header.stamp.secs, _x.init_pose.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00219 start = end
00220 end += 4
00221 (length,) = _struct_I.unpack(str[start:end])
00222 start = end
00223 end += length
00224 if python3:
00225 self.init_pose.header.frame_id = str[start:end].decode('utf-8')
00226 else:
00227 self.init_pose.header.frame_id = str[start:end]
00228 _x = self
00229 start = end
00230 end += 68
00231 (_x.init_pose.pose.position.x, _x.init_pose.pose.position.y, _x.init_pose.pose.position.z, _x.init_pose.pose.orientation.x, _x.init_pose.pose.orientation.y, _x.init_pose.pose.orientation.z, _x.init_pose.pose.orientation.w, _x.goal_pose.header.seq, _x.goal_pose.header.stamp.secs, _x.goal_pose.header.stamp.nsecs,) = _struct_7d3I.unpack(str[start:end])
00232 start = end
00233 end += 4
00234 (length,) = _struct_I.unpack(str[start:end])
00235 start = end
00236 end += length
00237 if python3:
00238 self.goal_pose.header.frame_id = str[start:end].decode('utf-8')
00239 else:
00240 self.goal_pose.header.frame_id = str[start:end]
00241 _x = self
00242 start = end
00243 end += 58
00244 (_x.goal_pose.pose.position.x, _x.goal_pose.pose.position.y, _x.goal_pose.pose.position.z, _x.goal_pose.pose.orientation.x, _x.goal_pose.pose.orientation.y, _x.goal_pose.pose.orientation.z, _x.goal_pose.pose.orientation.w, _x.states,) = _struct_7dh.unpack(str[start:end])
00245 return self
00246 except struct.error as e:
00247 raise genpy.DeserializationError(e)
00248
00249 _struct_I = genpy.struct_I
00250 _struct_7dh = struct.Struct("<7dh")
00251 _struct_3I = struct.Struct("<3I")
00252 _struct_7d3I = struct.Struct("<7d3I")
00253 """autogenerated by genpy from iri_wam_cartesian_planning/PosePathResponse.msg. Do not edit."""
00254 import sys
00255 python3 = True if sys.hexversion > 0x03000000 else False
00256 import genpy
00257 import struct
00258
00259 import geometry_msgs.msg
00260 import std_msgs.msg
00261
00262 class PosePathResponse(genpy.Message):
00263 _md5sum = "691d0e2a78c35a9fa9032d57f54e553a"
00264 _type = "iri_wam_cartesian_planning/PosePathResponse"
00265 _has_header = False
00266 _full_text = """geometry_msgs/PoseStamped[] poses_solution
00267 bool solution_found
00268
00269
00270 ================================================================================
00271 MSG: geometry_msgs/PoseStamped
00272 # A Pose with reference coordinate frame and timestamp
00273 Header header
00274 Pose pose
00275
00276 ================================================================================
00277 MSG: std_msgs/Header
00278 # Standard metadata for higher-level stamped data types.
00279 # This is generally used to communicate timestamped data
00280 # in a particular coordinate frame.
00281 #
00282 # sequence ID: consecutively increasing ID
00283 uint32 seq
00284 #Two-integer timestamp that is expressed as:
00285 # * stamp.secs: seconds (stamp_secs) since epoch
00286 # * stamp.nsecs: nanoseconds since stamp_secs
00287 # time-handling sugar is provided by the client library
00288 time stamp
00289 #Frame this data is associated with
00290 # 0: no frame
00291 # 1: global frame
00292 string frame_id
00293
00294 ================================================================================
00295 MSG: geometry_msgs/Pose
00296 # A representation of pose in free space, composed of postion and orientation.
00297 Point position
00298 Quaternion orientation
00299
00300 ================================================================================
00301 MSG: geometry_msgs/Point
00302 # This contains the position of a point in free space
00303 float64 x
00304 float64 y
00305 float64 z
00306
00307 ================================================================================
00308 MSG: geometry_msgs/Quaternion
00309 # This represents an orientation in free space in quaternion form.
00310
00311 float64 x
00312 float64 y
00313 float64 z
00314 float64 w
00315
00316 """
00317 __slots__ = ['poses_solution','solution_found']
00318 _slot_types = ['geometry_msgs/PoseStamped[]','bool']
00319
00320 def __init__(self, *args, **kwds):
00321 """
00322 Constructor. Any message fields that are implicitly/explicitly
00323 set to None will be assigned a default value. The recommend
00324 use is keyword arguments as this is more robust to future message
00325 changes. You cannot mix in-order arguments and keyword arguments.
00326
00327 The available fields are:
00328 poses_solution,solution_found
00329
00330 :param args: complete set of field values, in .msg order
00331 :param kwds: use keyword arguments corresponding to message field names
00332 to set specific fields.
00333 """
00334 if args or kwds:
00335 super(PosePathResponse, self).__init__(*args, **kwds)
00336
00337 if self.poses_solution is None:
00338 self.poses_solution = []
00339 if self.solution_found is None:
00340 self.solution_found = False
00341 else:
00342 self.poses_solution = []
00343 self.solution_found = False
00344
00345 def _get_types(self):
00346 """
00347 internal API method
00348 """
00349 return self._slot_types
00350
00351 def serialize(self, buff):
00352 """
00353 serialize message into buffer
00354 :param buff: buffer, ``StringIO``
00355 """
00356 try:
00357 length = len(self.poses_solution)
00358 buff.write(_struct_I.pack(length))
00359 for val1 in self.poses_solution:
00360 _v1 = val1.header
00361 buff.write(_struct_I.pack(_v1.seq))
00362 _v2 = _v1.stamp
00363 _x = _v2
00364 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00365 _x = _v1.frame_id
00366 length = len(_x)
00367 if python3 or type(_x) == unicode:
00368 _x = _x.encode('utf-8')
00369 length = len(_x)
00370 buff.write(struct.pack('<I%ss'%length, length, _x))
00371 _v3 = val1.pose
00372 _v4 = _v3.position
00373 _x = _v4
00374 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00375 _v5 = _v3.orientation
00376 _x = _v5
00377 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00378 buff.write(_struct_B.pack(self.solution_found))
00379 except struct.error as se: self._check_types(se)
00380 except TypeError as te: self._check_types(te)
00381
00382 def deserialize(self, str):
00383 """
00384 unpack serialized message in str into this message instance
00385 :param str: byte array of serialized message, ``str``
00386 """
00387 try:
00388 if self.poses_solution is None:
00389 self.poses_solution = None
00390 end = 0
00391 start = end
00392 end += 4
00393 (length,) = _struct_I.unpack(str[start:end])
00394 self.poses_solution = []
00395 for i in range(0, length):
00396 val1 = geometry_msgs.msg.PoseStamped()
00397 _v6 = val1.header
00398 start = end
00399 end += 4
00400 (_v6.seq,) = _struct_I.unpack(str[start:end])
00401 _v7 = _v6.stamp
00402 _x = _v7
00403 start = end
00404 end += 8
00405 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00406 start = end
00407 end += 4
00408 (length,) = _struct_I.unpack(str[start:end])
00409 start = end
00410 end += length
00411 if python3:
00412 _v6.frame_id = str[start:end].decode('utf-8')
00413 else:
00414 _v6.frame_id = str[start:end]
00415 _v8 = val1.pose
00416 _v9 = _v8.position
00417 _x = _v9
00418 start = end
00419 end += 24
00420 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00421 _v10 = _v8.orientation
00422 _x = _v10
00423 start = end
00424 end += 32
00425 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00426 self.poses_solution.append(val1)
00427 start = end
00428 end += 1
00429 (self.solution_found,) = _struct_B.unpack(str[start:end])
00430 self.solution_found = bool(self.solution_found)
00431 return self
00432 except struct.error as e:
00433 raise genpy.DeserializationError(e)
00434
00435
00436 def serialize_numpy(self, buff, numpy):
00437 """
00438 serialize message with numpy array types into buffer
00439 :param buff: buffer, ``StringIO``
00440 :param numpy: numpy python module
00441 """
00442 try:
00443 length = len(self.poses_solution)
00444 buff.write(_struct_I.pack(length))
00445 for val1 in self.poses_solution:
00446 _v11 = val1.header
00447 buff.write(_struct_I.pack(_v11.seq))
00448 _v12 = _v11.stamp
00449 _x = _v12
00450 buff.write(_struct_2I.pack(_x.secs, _x.nsecs))
00451 _x = _v11.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 _v13 = val1.pose
00458 _v14 = _v13.position
00459 _x = _v14
00460 buff.write(_struct_3d.pack(_x.x, _x.y, _x.z))
00461 _v15 = _v13.orientation
00462 _x = _v15
00463 buff.write(_struct_4d.pack(_x.x, _x.y, _x.z, _x.w))
00464 buff.write(_struct_B.pack(self.solution_found))
00465 except struct.error as se: self._check_types(se)
00466 except TypeError as te: self._check_types(te)
00467
00468 def deserialize_numpy(self, str, numpy):
00469 """
00470 unpack serialized message in str into this message instance using numpy for array types
00471 :param str: byte array of serialized message, ``str``
00472 :param numpy: numpy python module
00473 """
00474 try:
00475 if self.poses_solution is None:
00476 self.poses_solution = None
00477 end = 0
00478 start = end
00479 end += 4
00480 (length,) = _struct_I.unpack(str[start:end])
00481 self.poses_solution = []
00482 for i in range(0, length):
00483 val1 = geometry_msgs.msg.PoseStamped()
00484 _v16 = val1.header
00485 start = end
00486 end += 4
00487 (_v16.seq,) = _struct_I.unpack(str[start:end])
00488 _v17 = _v16.stamp
00489 _x = _v17
00490 start = end
00491 end += 8
00492 (_x.secs, _x.nsecs,) = _struct_2I.unpack(str[start:end])
00493 start = end
00494 end += 4
00495 (length,) = _struct_I.unpack(str[start:end])
00496 start = end
00497 end += length
00498 if python3:
00499 _v16.frame_id = str[start:end].decode('utf-8')
00500 else:
00501 _v16.frame_id = str[start:end]
00502 _v18 = val1.pose
00503 _v19 = _v18.position
00504 _x = _v19
00505 start = end
00506 end += 24
00507 (_x.x, _x.y, _x.z,) = _struct_3d.unpack(str[start:end])
00508 _v20 = _v18.orientation
00509 _x = _v20
00510 start = end
00511 end += 32
00512 (_x.x, _x.y, _x.z, _x.w,) = _struct_4d.unpack(str[start:end])
00513 self.poses_solution.append(val1)
00514 start = end
00515 end += 1
00516 (self.solution_found,) = _struct_B.unpack(str[start:end])
00517 self.solution_found = bool(self.solution_found)
00518 return self
00519 except struct.error as e:
00520 raise genpy.DeserializationError(e)
00521
00522 _struct_I = genpy.struct_I
00523 _struct_4d = struct.Struct("<4d")
00524 _struct_B = struct.Struct("<B")
00525 _struct_2I = struct.Struct("<2I")
00526 _struct_3d = struct.Struct("<3d")
00527 class PosePath(object):
00528 _type = 'iri_wam_cartesian_planning/PosePath'
00529 _md5sum = '0f13053a3ebe7ed8e55e72734eb56e6b'
00530 _request_class = PosePathRequest
00531 _response_class = PosePathResponse