00001 """autogenerated by genmsg_py from ConfigAction.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import interval_intersection.msg
00006 import roslib.rostime
00007 import actionlib_msgs.msg
00008 import std_msgs.msg
00009
00010 class ConfigAction(roslib.message.Message):
00011 _md5sum = "daf4f3168538603bba58f6ea42d51314"
00012 _type = "interval_intersection/ConfigAction"
00013 _has_header = False
00014 _full_text = """
00015 ConfigActionGoal action_goal
00016 ConfigActionResult action_result
00017 ConfigActionFeedback action_feedback
00018
00019 ================================================================================
00020 MSG: interval_intersection/ConfigActionGoal
00021
00022 Header header
00023 actionlib_msgs/GoalID goal_id
00024 ConfigGoal goal
00025
00026 ================================================================================
00027 MSG: std_msgs/Header
00028 # Standard metadata for higher-level stamped data types.
00029 # This is generally used to communicate timestamped data
00030 # in a particular coordinate frame.
00031 #
00032 # sequence ID: consecutively increasing ID
00033 uint32 seq
00034 #Two-integer timestamp that is expressed as:
00035 # * stamp.secs: seconds (stamp_secs) since epoch
00036 # * stamp.nsecs: nanoseconds since stamp_secs
00037 # time-handling sugar is provided by the client library
00038 time stamp
00039 #Frame this data is associated with
00040 # 0: no frame
00041 # 1: global frame
00042 string frame_id
00043
00044 ================================================================================
00045 MSG: actionlib_msgs/GoalID
00046 # The stamp should store the time at which this goal was requested.
00047 # It is used by an action server when it tries to preempt all
00048 # goals that were requested before a certain time
00049 time stamp
00050
00051 # The id provides a way to associate feedback and
00052 # result message with specific goal requests. The id
00053 # specified must be unique.
00054 string id
00055
00056
00057 ================================================================================
00058 MSG: interval_intersection/ConfigGoal
00059 string[] topics
00060
00061 ================================================================================
00062 MSG: interval_intersection/ConfigActionResult
00063
00064 Header header
00065 actionlib_msgs/GoalStatus status
00066 ConfigResult result
00067
00068 ================================================================================
00069 MSG: actionlib_msgs/GoalStatus
00070 GoalID goal_id
00071 uint8 status
00072 uint8 PENDING = 0 # The goal has yet to be processed by the action server
00073 uint8 ACTIVE = 1 # The goal is currently being processed by the action server
00074 uint8 PREEMPTED = 2 # The goal received a cancel request after it started executing
00075 # and has since completed its execution (Terminal State)
00076 uint8 SUCCEEDED = 3 # The goal was achieved successfully by the action server (Terminal State)
00077 uint8 ABORTED = 4 # The goal was aborted during execution by the action server due
00078 # to some failure (Terminal State)
00079 uint8 REJECTED = 5 # The goal was rejected by the action server without being processed,
00080 # because the goal was unattainable or invalid (Terminal State)
00081 uint8 PREEMPTING = 6 # The goal received a cancel request after it started executing
00082 # and has not yet completed execution
00083 uint8 RECALLING = 7 # The goal received a cancel request before it started executing,
00084 # but the action server has not yet confirmed that the goal is canceled
00085 uint8 RECALLED = 8 # The goal received a cancel request before it started executing
00086 # and was successfully cancelled (Terminal State)
00087 uint8 LOST = 9 # An action client can determine that a goal is LOST. This should not be
00088 # sent over the wire by an action server
00089
00090 #Allow for the user to associate a string with GoalStatus for debugging
00091 string text
00092
00093
00094 ================================================================================
00095 MSG: interval_intersection/ConfigResult
00096
00097 ================================================================================
00098 MSG: interval_intersection/ConfigActionFeedback
00099
00100 Header header
00101 actionlib_msgs/GoalStatus status
00102 ConfigFeedback feedback
00103
00104 ================================================================================
00105 MSG: interval_intersection/ConfigFeedback
00106
00107 """
00108 __slots__ = ['action_goal','action_result','action_feedback']
00109 _slot_types = ['interval_intersection/ConfigActionGoal','interval_intersection/ConfigActionResult','interval_intersection/ConfigActionFeedback']
00110
00111 def __init__(self, *args, **kwds):
00112 """
00113 Constructor. Any message fields that are implicitly/explicitly
00114 set to None will be assigned a default value. The recommend
00115 use is keyword arguments as this is more robust to future message
00116 changes. You cannot mix in-order arguments and keyword arguments.
00117
00118 The available fields are:
00119 action_goal,action_result,action_feedback
00120
00121 @param args: complete set of field values, in .msg order
00122 @param kwds: use keyword arguments corresponding to message field names
00123 to set specific fields.
00124 """
00125 if args or kwds:
00126 super(ConfigAction, self).__init__(*args, **kwds)
00127
00128 if self.action_goal is None:
00129 self.action_goal = interval_intersection.msg.ConfigActionGoal()
00130 if self.action_result is None:
00131 self.action_result = interval_intersection.msg.ConfigActionResult()
00132 if self.action_feedback is None:
00133 self.action_feedback = interval_intersection.msg.ConfigActionFeedback()
00134 else:
00135 self.action_goal = interval_intersection.msg.ConfigActionGoal()
00136 self.action_result = interval_intersection.msg.ConfigActionResult()
00137 self.action_feedback = interval_intersection.msg.ConfigActionFeedback()
00138
00139 def _get_types(self):
00140 """
00141 internal API method
00142 """
00143 return self._slot_types
00144
00145 def serialize(self, buff):
00146 """
00147 serialize message into buffer
00148 @param buff: buffer
00149 @type buff: StringIO
00150 """
00151 try:
00152 _x = self
00153 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00154 _x = self.action_goal.header.frame_id
00155 length = len(_x)
00156 buff.write(struct.pack('<I%ss'%length, length, _x))
00157 _x = self
00158 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00159 _x = self.action_goal.goal_id.id
00160 length = len(_x)
00161 buff.write(struct.pack('<I%ss'%length, length, _x))
00162 length = len(self.action_goal.goal.topics)
00163 buff.write(_struct_I.pack(length))
00164 for val1 in self.action_goal.goal.topics:
00165 length = len(val1)
00166 buff.write(struct.pack('<I%ss'%length, length, val1))
00167 _x = self
00168 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00169 _x = self.action_result.header.frame_id
00170 length = len(_x)
00171 buff.write(struct.pack('<I%ss'%length, length, _x))
00172 _x = self
00173 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00174 _x = self.action_result.status.goal_id.id
00175 length = len(_x)
00176 buff.write(struct.pack('<I%ss'%length, length, _x))
00177 buff.write(_struct_B.pack(self.action_result.status.status))
00178 _x = self.action_result.status.text
00179 length = len(_x)
00180 buff.write(struct.pack('<I%ss'%length, length, _x))
00181 _x = self
00182 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00183 _x = self.action_feedback.header.frame_id
00184 length = len(_x)
00185 buff.write(struct.pack('<I%ss'%length, length, _x))
00186 _x = self
00187 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00188 _x = self.action_feedback.status.goal_id.id
00189 length = len(_x)
00190 buff.write(struct.pack('<I%ss'%length, length, _x))
00191 buff.write(_struct_B.pack(self.action_feedback.status.status))
00192 _x = self.action_feedback.status.text
00193 length = len(_x)
00194 buff.write(struct.pack('<I%ss'%length, length, _x))
00195 except struct.error, se: self._check_types(se)
00196 except TypeError, te: self._check_types(te)
00197
00198 def deserialize(self, str):
00199 """
00200 unpack serialized message in str into this message instance
00201 @param str: byte array of serialized message
00202 @type str: str
00203 """
00204 try:
00205 if self.action_goal is None:
00206 self.action_goal = interval_intersection.msg.ConfigActionGoal()
00207 if self.action_result is None:
00208 self.action_result = interval_intersection.msg.ConfigActionResult()
00209 if self.action_feedback is None:
00210 self.action_feedback = interval_intersection.msg.ConfigActionFeedback()
00211 end = 0
00212 _x = self
00213 start = end
00214 end += 12
00215 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00216 start = end
00217 end += 4
00218 (length,) = _struct_I.unpack(str[start:end])
00219 start = end
00220 end += length
00221 self.action_goal.header.frame_id = str[start:end]
00222 _x = self
00223 start = end
00224 end += 8
00225 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00226 start = end
00227 end += 4
00228 (length,) = _struct_I.unpack(str[start:end])
00229 start = end
00230 end += length
00231 self.action_goal.goal_id.id = str[start:end]
00232 start = end
00233 end += 4
00234 (length,) = _struct_I.unpack(str[start:end])
00235 self.action_goal.goal.topics = []
00236 for i in xrange(0, length):
00237 start = end
00238 end += 4
00239 (length,) = _struct_I.unpack(str[start:end])
00240 start = end
00241 end += length
00242 val1 = str[start:end]
00243 self.action_goal.goal.topics.append(val1)
00244 _x = self
00245 start = end
00246 end += 12
00247 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00248 start = end
00249 end += 4
00250 (length,) = _struct_I.unpack(str[start:end])
00251 start = end
00252 end += length
00253 self.action_result.header.frame_id = str[start:end]
00254 _x = self
00255 start = end
00256 end += 8
00257 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00258 start = end
00259 end += 4
00260 (length,) = _struct_I.unpack(str[start:end])
00261 start = end
00262 end += length
00263 self.action_result.status.goal_id.id = str[start:end]
00264 start = end
00265 end += 1
00266 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00267 start = end
00268 end += 4
00269 (length,) = _struct_I.unpack(str[start:end])
00270 start = end
00271 end += length
00272 self.action_result.status.text = str[start:end]
00273 _x = self
00274 start = end
00275 end += 12
00276 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00277 start = end
00278 end += 4
00279 (length,) = _struct_I.unpack(str[start:end])
00280 start = end
00281 end += length
00282 self.action_feedback.header.frame_id = str[start:end]
00283 _x = self
00284 start = end
00285 end += 8
00286 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00287 start = end
00288 end += 4
00289 (length,) = _struct_I.unpack(str[start:end])
00290 start = end
00291 end += length
00292 self.action_feedback.status.goal_id.id = str[start:end]
00293 start = end
00294 end += 1
00295 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00296 start = end
00297 end += 4
00298 (length,) = _struct_I.unpack(str[start:end])
00299 start = end
00300 end += length
00301 self.action_feedback.status.text = str[start:end]
00302 return self
00303 except struct.error, e:
00304 raise roslib.message.DeserializationError(e)
00305
00306
00307 def serialize_numpy(self, buff, numpy):
00308 """
00309 serialize message with numpy array types into buffer
00310 @param buff: buffer
00311 @type buff: StringIO
00312 @param numpy: numpy python module
00313 @type numpy module
00314 """
00315 try:
00316 _x = self
00317 buff.write(_struct_3I.pack(_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs))
00318 _x = self.action_goal.header.frame_id
00319 length = len(_x)
00320 buff.write(struct.pack('<I%ss'%length, length, _x))
00321 _x = self
00322 buff.write(_struct_2I.pack(_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs))
00323 _x = self.action_goal.goal_id.id
00324 length = len(_x)
00325 buff.write(struct.pack('<I%ss'%length, length, _x))
00326 length = len(self.action_goal.goal.topics)
00327 buff.write(_struct_I.pack(length))
00328 for val1 in self.action_goal.goal.topics:
00329 length = len(val1)
00330 buff.write(struct.pack('<I%ss'%length, length, val1))
00331 _x = self
00332 buff.write(_struct_3I.pack(_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs))
00333 _x = self.action_result.header.frame_id
00334 length = len(_x)
00335 buff.write(struct.pack('<I%ss'%length, length, _x))
00336 _x = self
00337 buff.write(_struct_2I.pack(_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs))
00338 _x = self.action_result.status.goal_id.id
00339 length = len(_x)
00340 buff.write(struct.pack('<I%ss'%length, length, _x))
00341 buff.write(_struct_B.pack(self.action_result.status.status))
00342 _x = self.action_result.status.text
00343 length = len(_x)
00344 buff.write(struct.pack('<I%ss'%length, length, _x))
00345 _x = self
00346 buff.write(_struct_3I.pack(_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs))
00347 _x = self.action_feedback.header.frame_id
00348 length = len(_x)
00349 buff.write(struct.pack('<I%ss'%length, length, _x))
00350 _x = self
00351 buff.write(_struct_2I.pack(_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs))
00352 _x = self.action_feedback.status.goal_id.id
00353 length = len(_x)
00354 buff.write(struct.pack('<I%ss'%length, length, _x))
00355 buff.write(_struct_B.pack(self.action_feedback.status.status))
00356 _x = self.action_feedback.status.text
00357 length = len(_x)
00358 buff.write(struct.pack('<I%ss'%length, length, _x))
00359 except struct.error, se: self._check_types(se)
00360 except TypeError, te: self._check_types(te)
00361
00362 def deserialize_numpy(self, str, numpy):
00363 """
00364 unpack serialized message in str into this message instance using numpy for array types
00365 @param str: byte array of serialized message
00366 @type str: str
00367 @param numpy: numpy python module
00368 @type numpy: module
00369 """
00370 try:
00371 if self.action_goal is None:
00372 self.action_goal = interval_intersection.msg.ConfigActionGoal()
00373 if self.action_result is None:
00374 self.action_result = interval_intersection.msg.ConfigActionResult()
00375 if self.action_feedback is None:
00376 self.action_feedback = interval_intersection.msg.ConfigActionFeedback()
00377 end = 0
00378 _x = self
00379 start = end
00380 end += 12
00381 (_x.action_goal.header.seq, _x.action_goal.header.stamp.secs, _x.action_goal.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00382 start = end
00383 end += 4
00384 (length,) = _struct_I.unpack(str[start:end])
00385 start = end
00386 end += length
00387 self.action_goal.header.frame_id = str[start:end]
00388 _x = self
00389 start = end
00390 end += 8
00391 (_x.action_goal.goal_id.stamp.secs, _x.action_goal.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00392 start = end
00393 end += 4
00394 (length,) = _struct_I.unpack(str[start:end])
00395 start = end
00396 end += length
00397 self.action_goal.goal_id.id = str[start:end]
00398 start = end
00399 end += 4
00400 (length,) = _struct_I.unpack(str[start:end])
00401 self.action_goal.goal.topics = []
00402 for i in xrange(0, length):
00403 start = end
00404 end += 4
00405 (length,) = _struct_I.unpack(str[start:end])
00406 start = end
00407 end += length
00408 val1 = str[start:end]
00409 self.action_goal.goal.topics.append(val1)
00410 _x = self
00411 start = end
00412 end += 12
00413 (_x.action_result.header.seq, _x.action_result.header.stamp.secs, _x.action_result.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00414 start = end
00415 end += 4
00416 (length,) = _struct_I.unpack(str[start:end])
00417 start = end
00418 end += length
00419 self.action_result.header.frame_id = str[start:end]
00420 _x = self
00421 start = end
00422 end += 8
00423 (_x.action_result.status.goal_id.stamp.secs, _x.action_result.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00424 start = end
00425 end += 4
00426 (length,) = _struct_I.unpack(str[start:end])
00427 start = end
00428 end += length
00429 self.action_result.status.goal_id.id = str[start:end]
00430 start = end
00431 end += 1
00432 (self.action_result.status.status,) = _struct_B.unpack(str[start:end])
00433 start = end
00434 end += 4
00435 (length,) = _struct_I.unpack(str[start:end])
00436 start = end
00437 end += length
00438 self.action_result.status.text = str[start:end]
00439 _x = self
00440 start = end
00441 end += 12
00442 (_x.action_feedback.header.seq, _x.action_feedback.header.stamp.secs, _x.action_feedback.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00443 start = end
00444 end += 4
00445 (length,) = _struct_I.unpack(str[start:end])
00446 start = end
00447 end += length
00448 self.action_feedback.header.frame_id = str[start:end]
00449 _x = self
00450 start = end
00451 end += 8
00452 (_x.action_feedback.status.goal_id.stamp.secs, _x.action_feedback.status.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00453 start = end
00454 end += 4
00455 (length,) = _struct_I.unpack(str[start:end])
00456 start = end
00457 end += length
00458 self.action_feedback.status.goal_id.id = str[start:end]
00459 start = end
00460 end += 1
00461 (self.action_feedback.status.status,) = _struct_B.unpack(str[start:end])
00462 start = end
00463 end += 4
00464 (length,) = _struct_I.unpack(str[start:end])
00465 start = end
00466 end += length
00467 self.action_feedback.status.text = str[start:end]
00468 return self
00469 except struct.error, e:
00470 raise roslib.message.DeserializationError(e)
00471
00472 _struct_I = roslib.message.struct_I
00473 _struct_3I = struct.Struct("<3I")
00474 _struct_B = struct.Struct("<B")
00475 _struct_2I = struct.Struct("<2I")