00001 """autogenerated by genmsg_py from ConfigActionGoal.msg. Do not edit."""
00002 import roslib.message
00003 import struct
00004
00005 import roslib.rostime
00006 import actionlib_msgs.msg
00007 import laser_cb_detector.msg
00008 import std_msgs.msg
00009
00010 class ConfigActionGoal(roslib.message.Message):
00011 _md5sum = "f6f8cb46e4d9ad5f8de5944ff7521a06"
00012 _type = "laser_cb_detector/ConfigActionGoal"
00013 _has_header = True
00014 _full_text = """
00015 Header header
00016 actionlib_msgs/GoalID goal_id
00017 ConfigGoal goal
00018
00019 ================================================================================
00020 MSG: std_msgs/Header
00021 # Standard metadata for higher-level stamped data types.
00022 # This is generally used to communicate timestamped data
00023 # in a particular coordinate frame.
00024 #
00025 # sequence ID: consecutively increasing ID
00026 uint32 seq
00027 #Two-integer timestamp that is expressed as:
00028 # * stamp.secs: seconds (stamp_secs) since epoch
00029 # * stamp.nsecs: nanoseconds since stamp_secs
00030 # time-handling sugar is provided by the client library
00031 time stamp
00032 #Frame this data is associated with
00033 # 0: no frame
00034 # 1: global frame
00035 string frame_id
00036
00037 ================================================================================
00038 MSG: actionlib_msgs/GoalID
00039 # The stamp should store the time at which this goal was requested.
00040 # It is used by an action server when it tries to preempt all
00041 # goals that were requested before a certain time
00042 time stamp
00043
00044 # The id provides a way to associate feedback and
00045 # result message with specific goal requests. The id
00046 # specified must be unique.
00047 string id
00048
00049
00050 ================================================================================
00051 MSG: laser_cb_detector/ConfigGoal
00052 uint32 num_x # Number of checkerboard corners in the X direction
00053 uint32 num_y # Number of corners in the Y direction
00054 float32 spacing_x # Spacing between corners in the X direction (meters)
00055 float32 spacing_y # Spacing between corners in the Y direction (meters)
00056
00057 # Specify how many times we want to upsample the image.
00058 # This is often useful for detecting small checkerboards far away
00059 float32 width_scaling
00060 float32 height_scaling
00061
00062 # Specifiy how intensity maps into a uint8. A specified window of
00063 # intensities is linearly scaled to 0-255
00064 float32 min_intensity
00065 float32 max_intensity
00066
00067 # Configure openCV's subpixel corner detector
00068 uint32 subpixel_window
00069 int32 subpixel_zero_zone
00070
00071 # Specify if we need to flip snapshot image model. This is usually necessary
00072 # when the laser scans from right to left, since this is the opposite of images,
00073 # which are normally indexed left to right
00074 uint8 flip_horizontal
00075
00076
00077 """
00078 __slots__ = ['header','goal_id','goal']
00079 _slot_types = ['Header','actionlib_msgs/GoalID','laser_cb_detector/ConfigGoal']
00080
00081 def __init__(self, *args, **kwds):
00082 """
00083 Constructor. Any message fields that are implicitly/explicitly
00084 set to None will be assigned a default value. The recommend
00085 use is keyword arguments as this is more robust to future message
00086 changes. You cannot mix in-order arguments and keyword arguments.
00087
00088 The available fields are:
00089 header,goal_id,goal
00090
00091 @param args: complete set of field values, in .msg order
00092 @param kwds: use keyword arguments corresponding to message field names
00093 to set specific fields.
00094 """
00095 if args or kwds:
00096 super(ConfigActionGoal, self).__init__(*args, **kwds)
00097
00098 if self.header is None:
00099 self.header = std_msgs.msg._Header.Header()
00100 if self.goal_id is None:
00101 self.goal_id = actionlib_msgs.msg.GoalID()
00102 if self.goal is None:
00103 self.goal = laser_cb_detector.msg.ConfigGoal()
00104 else:
00105 self.header = std_msgs.msg._Header.Header()
00106 self.goal_id = actionlib_msgs.msg.GoalID()
00107 self.goal = laser_cb_detector.msg.ConfigGoal()
00108
00109 def _get_types(self):
00110 """
00111 internal API method
00112 """
00113 return self._slot_types
00114
00115 def serialize(self, buff):
00116 """
00117 serialize message into buffer
00118 @param buff: buffer
00119 @type buff: StringIO
00120 """
00121 try:
00122 _x = self
00123 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00124 _x = self.header.frame_id
00125 length = len(_x)
00126 buff.write(struct.pack('<I%ss'%length, length, _x))
00127 _x = self
00128 buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00129 _x = self.goal_id.id
00130 length = len(_x)
00131 buff.write(struct.pack('<I%ss'%length, length, _x))
00132 _x = self
00133 buff.write(_struct_2I6fIiB.pack(_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.min_intensity, _x.goal.max_intensity, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone, _x.goal.flip_horizontal))
00134 except struct.error, se: self._check_types(se)
00135 except TypeError, te: self._check_types(te)
00136
00137 def deserialize(self, str):
00138 """
00139 unpack serialized message in str into this message instance
00140 @param str: byte array of serialized message
00141 @type str: str
00142 """
00143 try:
00144 if self.header is None:
00145 self.header = std_msgs.msg._Header.Header()
00146 if self.goal_id is None:
00147 self.goal_id = actionlib_msgs.msg.GoalID()
00148 if self.goal is None:
00149 self.goal = laser_cb_detector.msg.ConfigGoal()
00150 end = 0
00151 _x = self
00152 start = end
00153 end += 12
00154 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00155 start = end
00156 end += 4
00157 (length,) = _struct_I.unpack(str[start:end])
00158 start = end
00159 end += length
00160 self.header.frame_id = str[start:end]
00161 _x = self
00162 start = end
00163 end += 8
00164 (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00165 start = end
00166 end += 4
00167 (length,) = _struct_I.unpack(str[start:end])
00168 start = end
00169 end += length
00170 self.goal_id.id = str[start:end]
00171 _x = self
00172 start = end
00173 end += 41
00174 (_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.min_intensity, _x.goal.max_intensity, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone, _x.goal.flip_horizontal,) = _struct_2I6fIiB.unpack(str[start:end])
00175 return self
00176 except struct.error, e:
00177 raise roslib.message.DeserializationError(e)
00178
00179
00180 def serialize_numpy(self, buff, numpy):
00181 """
00182 serialize message with numpy array types into buffer
00183 @param buff: buffer
00184 @type buff: StringIO
00185 @param numpy: numpy python module
00186 @type numpy module
00187 """
00188 try:
00189 _x = self
00190 buff.write(_struct_3I.pack(_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs))
00191 _x = self.header.frame_id
00192 length = len(_x)
00193 buff.write(struct.pack('<I%ss'%length, length, _x))
00194 _x = self
00195 buff.write(_struct_2I.pack(_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs))
00196 _x = self.goal_id.id
00197 length = len(_x)
00198 buff.write(struct.pack('<I%ss'%length, length, _x))
00199 _x = self
00200 buff.write(_struct_2I6fIiB.pack(_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.min_intensity, _x.goal.max_intensity, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone, _x.goal.flip_horizontal))
00201 except struct.error, se: self._check_types(se)
00202 except TypeError, te: self._check_types(te)
00203
00204 def deserialize_numpy(self, str, numpy):
00205 """
00206 unpack serialized message in str into this message instance using numpy for array types
00207 @param str: byte array of serialized message
00208 @type str: str
00209 @param numpy: numpy python module
00210 @type numpy: module
00211 """
00212 try:
00213 if self.header is None:
00214 self.header = std_msgs.msg._Header.Header()
00215 if self.goal_id is None:
00216 self.goal_id = actionlib_msgs.msg.GoalID()
00217 if self.goal is None:
00218 self.goal = laser_cb_detector.msg.ConfigGoal()
00219 end = 0
00220 _x = self
00221 start = end
00222 end += 12
00223 (_x.header.seq, _x.header.stamp.secs, _x.header.stamp.nsecs,) = _struct_3I.unpack(str[start:end])
00224 start = end
00225 end += 4
00226 (length,) = _struct_I.unpack(str[start:end])
00227 start = end
00228 end += length
00229 self.header.frame_id = str[start:end]
00230 _x = self
00231 start = end
00232 end += 8
00233 (_x.goal_id.stamp.secs, _x.goal_id.stamp.nsecs,) = _struct_2I.unpack(str[start:end])
00234 start = end
00235 end += 4
00236 (length,) = _struct_I.unpack(str[start:end])
00237 start = end
00238 end += length
00239 self.goal_id.id = str[start:end]
00240 _x = self
00241 start = end
00242 end += 41
00243 (_x.goal.num_x, _x.goal.num_y, _x.goal.spacing_x, _x.goal.spacing_y, _x.goal.width_scaling, _x.goal.height_scaling, _x.goal.min_intensity, _x.goal.max_intensity, _x.goal.subpixel_window, _x.goal.subpixel_zero_zone, _x.goal.flip_horizontal,) = _struct_2I6fIiB.unpack(str[start:end])
00244 return self
00245 except struct.error, e:
00246 raise roslib.message.DeserializationError(e)
00247
00248 _struct_I = roslib.message.struct_I
00249 _struct_3I = struct.Struct("<3I")
00250 _struct_2I = struct.Struct("<2I")
00251 _struct_2I6fIiB = struct.Struct("<2I6fIiB")