BatteryState.h
Go to the documentation of this file.
1 #include "sick_scan/sick_scan_base.h" /* Base definitions included in all header files, added by add_sick_scan_base_header.py. Do not edit this line. */
2 // Generated by gencpp from file sensor_msgs/BatteryState.msg
3 // DO NOT EDIT!
4 
5 
6 #ifndef SENSOR_MSGS_MESSAGE_BATTERYSTATE_H
7 #define SENSOR_MSGS_MESSAGE_BATTERYSTATE_H
8 
9 
10 #include <string>
11 #include <vector>
12 #include <map>
13 
14 #include <ros/types.h>
15 #include <ros/serialization.h>
16 #include <ros/builtin_message_traits.h>
17 #include <ros/message_operations.h>
18 
19 #include <std_msgs/Header.h>
20 
21 namespace sensor_msgs
22 {
23 template <class ContainerAllocator>
25 {
27 
29  : header()
30  , voltage(0.0)
31  , current(0.0)
32  , charge(0.0)
33  , capacity(0.0)
34  , design_capacity(0.0)
35  , percentage(0.0)
39  , present(false)
40  , cell_voltage()
41  , location()
42  , serial_number() {
43  }
44  BatteryState_(const ContainerAllocator& _alloc)
45  : header(_alloc)
46  , voltage(0.0)
47  , current(0.0)
48  , charge(0.0)
49  , capacity(0.0)
50  , design_capacity(0.0)
51  , percentage(0.0)
55  , present(false)
56  , cell_voltage(_alloc)
57  , location(_alloc)
58  , serial_number(_alloc) {
59  (void)_alloc;
60  }
61 
62 
63 
64  typedef ::std_msgs::Header_<ContainerAllocator> _header_type;
66 
67  typedef float _voltage_type;
69 
70  typedef float _current_type;
72 
73  typedef float _charge_type;
75 
76  typedef float _capacity_type;
78 
79  typedef float _design_capacity_type;
81 
82  typedef float _percentage_type;
84 
85  typedef uint8_t _power_supply_status_type;
87 
88  typedef uint8_t _power_supply_health_type;
90 
93 
94  typedef uint8_t _present_type;
96 
97  typedef std::vector<float, typename ContainerAllocator::template rebind<float>::other > _cell_voltage_type;
99 
100  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _location_type;
102 
103  typedef std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > _serial_number_type;
105 
106 
128 
129 
130  typedef std::shared_ptr< ::sensor_msgs::BatteryState_<ContainerAllocator> > Ptr;
131  typedef std::shared_ptr< ::sensor_msgs::BatteryState_<ContainerAllocator> const> ConstPtr;
132 
133 }; // struct BatteryState_
134 
135 typedef ::sensor_msgs::BatteryState_<std::allocator<void> > BatteryState;
136 
137 typedef std::shared_ptr< ::sensor_msgs::BatteryState > BatteryStatePtr;
138 typedef std::shared_ptr< ::sensor_msgs::BatteryState const> BatteryStateConstPtr;
139 
140 // constants requiring out of line definition
141 
142 
143 
144 
145 
146 
147 
148 
149 
150 
151 
152 
153 
154 
155 
156 
157 
158 
159 
160 
161 
162 
163 
164 
165 
166 
167 
168 
169 
170 
171 
172 
173 
174 
175 
176 
177 
178 
179 
180 
181 
182 
183 
184 
185 
186 template<typename ContainerAllocator>
187 std::ostream& operator<<(std::ostream& s, const ::sensor_msgs::BatteryState_<ContainerAllocator> & v)
188 {
190 return s;
191 }
192 
193 } // namespace sensor_msgs
194 
195 namespace roswrap
196 {
197 namespace message_traits
198 {
199 
200 
201 
202 // BOOLTRAITS {'IsFixedSize': False, 'IsMessage': True, 'HasHeader': True}
203 // {'std_msgs': ['/opt/ros/kinetic/share/std_msgs/cmake/../msg'], 'geometry_msgs': ['/opt/ros/kinetic/share/geometry_msgs/cmake/../msg'], 'sensor_msgs': ['/tmp/binarydeb/ros-kinetic-sensor-msgs-1.12.5/msg']}
204 
205 // !!!!!!!!!!! ['__class__', '__delattr__', '__dict__', '__doc__', '__eq__', '__format__', '__getattribute__', '__hash__', '__init__', '__module__', '__ne__', '__new__', '__reduce__', '__reduce_ex__', '__repr__', '__setattr__', '__sizeof__', '__str__', '__subclasshook__', '__weakref__', '_parsed_fields', 'constants', 'fields', 'full_name', 'has_header', 'header_present', 'names', 'package', 'parsed_fields', 'short_name', 'text', 'types']
206 
207 
208 
209 
210 template <class ContainerAllocator>
211 struct IsFixedSize< ::sensor_msgs::BatteryState_<ContainerAllocator> >
212  : FalseType
213  { };
214 
215 template <class ContainerAllocator>
216 struct IsFixedSize< ::sensor_msgs::BatteryState_<ContainerAllocator> const>
217  : FalseType
218  { };
219 
220 template <class ContainerAllocator>
221 struct IsMessage< ::sensor_msgs::BatteryState_<ContainerAllocator> >
222  : TrueType
223  { };
224 
225 template <class ContainerAllocator>
226 struct IsMessage< ::sensor_msgs::BatteryState_<ContainerAllocator> const>
227  : TrueType
228  { };
229 
230 template <class ContainerAllocator>
231 struct HasHeader< ::sensor_msgs::BatteryState_<ContainerAllocator> >
232  : TrueType
233  { };
234 
235 template <class ContainerAllocator>
236 struct HasHeader< ::sensor_msgs::BatteryState_<ContainerAllocator> const>
237  : TrueType
238  { };
239 
240 
241 template<class ContainerAllocator>
242 struct MD5Sum< ::sensor_msgs::BatteryState_<ContainerAllocator> >
243 {
244  static const char* value()
245  {
246  return "476f837fa6771f6e16e3bf4ef96f8770";
247  }
248 
249  static const char* value(const ::sensor_msgs::BatteryState_<ContainerAllocator>&) { return value(); }
250  static const uint64_t static_value1 = 0x476f837fa6771f6eULL;
251  static const uint64_t static_value2 = 0x16e3bf4ef96f8770ULL;
252 };
253 
254 template<class ContainerAllocator>
255 struct DataType< ::sensor_msgs::BatteryState_<ContainerAllocator> >
256 {
257  static const char* value()
258  {
259  return "sensor_msgs/BatteryState";
260  }
261 
262  static const char* value(const ::sensor_msgs::BatteryState_<ContainerAllocator>&) { return value(); }
263 };
264 
265 template<class ContainerAllocator>
266 struct Definition< ::sensor_msgs::BatteryState_<ContainerAllocator> >
267 {
268  static const char* value()
269  {
270  return "\n\
271 # Constants are chosen to match the enums in the linux kernel\n\
272 # defined in include/linux/power_supply.h as of version 3.7\n\
273 # The one difference is for style reasons the constants are\n\
274 # all uppercase not mixed case.\n\
275 \n\
276 # Power supply status constants\n\
277 uint8 POWER_SUPPLY_STATUS_UNKNOWN = 0\n\
278 uint8 POWER_SUPPLY_STATUS_CHARGING = 1\n\
279 uint8 POWER_SUPPLY_STATUS_DISCHARGING = 2\n\
280 uint8 POWER_SUPPLY_STATUS_NOT_CHARGING = 3\n\
281 uint8 POWER_SUPPLY_STATUS_FULL = 4\n\
282 \n\
283 # Power supply health constants\n\
284 uint8 POWER_SUPPLY_HEALTH_UNKNOWN = 0\n\
285 uint8 POWER_SUPPLY_HEALTH_GOOD = 1\n\
286 uint8 POWER_SUPPLY_HEALTH_OVERHEAT = 2\n\
287 uint8 POWER_SUPPLY_HEALTH_DEAD = 3\n\
288 uint8 POWER_SUPPLY_HEALTH_OVERVOLTAGE = 4\n\
289 uint8 POWER_SUPPLY_HEALTH_UNSPEC_FAILURE = 5\n\
290 uint8 POWER_SUPPLY_HEALTH_COLD = 6\n\
291 uint8 POWER_SUPPLY_HEALTH_WATCHDOG_TIMER_EXPIRE = 7\n\
292 uint8 POWER_SUPPLY_HEALTH_SAFETY_TIMER_EXPIRE = 8\n\
293 \n\
294 # Power supply technology (chemistry) constants\n\
295 uint8 POWER_SUPPLY_TECHNOLOGY_UNKNOWN = 0\n\
296 uint8 POWER_SUPPLY_TECHNOLOGY_NIMH = 1\n\
297 uint8 POWER_SUPPLY_TECHNOLOGY_LION = 2\n\
298 uint8 POWER_SUPPLY_TECHNOLOGY_LIPO = 3\n\
299 uint8 POWER_SUPPLY_TECHNOLOGY_LIFE = 4\n\
300 uint8 POWER_SUPPLY_TECHNOLOGY_NICD = 5\n\
301 uint8 POWER_SUPPLY_TECHNOLOGY_LIMN = 6\n\
302 \n\
303 Header header\n\
304 float32 voltage # Voltage in Volts (Mandatory)\n\
305 float32 current # Negative when discharging (A) (If unmeasured NaN)\n\
306 float32 charge # Current charge in Ah (If unmeasured NaN)\n\
307 float32 capacity # Capacity in Ah (last full capacity) (If unmeasured NaN)\n\
308 float32 design_capacity # Capacity in Ah (design capacity) (If unmeasured NaN)\n\
309 float32 percentage # Charge percentage on 0 to 1 range (If unmeasured NaN)\n\
310 uint8 power_supply_status # The charging status as reported. Values defined above\n\
311 uint8 power_supply_health # The battery health metric. Values defined above\n\
312 uint8 power_supply_technology # The battery chemistry. Values defined above\n\
313 bool present # True if the battery is present\n\
314 \n\
315 float32[] cell_voltage # An array of individual cell voltages for each cell in the pack\n\
316  # If individual voltages unknown but number of cells known set each to NaN\n\
317 string location # The location into which the battery is inserted. (slot number or plug)\n\
318 string serial_number # The best approximation of the battery serial number\n\
319 \n\
320 ================================================================================\n\
321 MSG: std_msgs/Header\n\
322 # Standard metadata for higher-level stamped data types.\n\
323 # This is generally used to communicate timestamped data \n\
324 # in a particular coordinate frame.\n\
325 # \n\
326 # sequence ID: consecutively increasing ID \n\
327 uint32 seq\n\
328 #Two-integer timestamp that is expressed as:\n\
329 # * stamp.sec: seconds (stamp_secs) since epoch (in Python the variable is called 'secs')\n\
330 # * stamp.nsec: nanoseconds since stamp_secs (in Python the variable is called 'nsecs')\n\
331 # time-handling sugar is provided by the client library\n\
332 time stamp\n\
333 #Frame this data is associated with\n\
334 # 0: no frame\n\
335 # 1: global frame\n\
336 string frame_id\n\
337 ";
338  }
339 
340  static const char* value(const ::sensor_msgs::BatteryState_<ContainerAllocator>&) { return value(); }
341 };
342 
343 } // namespace message_traits
344 } // namespace roswrap
345 
346 namespace roswrap
347 {
348 namespace serialization
349 {
350 
351  template<class ContainerAllocator> struct Serializer< ::sensor_msgs::BatteryState_<ContainerAllocator> >
352  {
353  template<typename Stream, typename T> inline static void allInOne(Stream& stream, T m)
354  {
355  stream.next(m.header);
356  stream.next(m.voltage);
357  stream.next(m.current);
358  stream.next(m.charge);
359  stream.next(m.capacity);
360  stream.next(m.design_capacity);
361  stream.next(m.percentage);
362  stream.next(m.power_supply_status);
363  stream.next(m.power_supply_health);
364  stream.next(m.power_supply_technology);
365  stream.next(m.present);
366  stream.next(m.cell_voltage);
367  stream.next(m.location);
368  stream.next(m.serial_number);
369  }
370 
372  }; // struct BatteryState_
373 
374 } // namespace serialization
375 } // namespace roswrap
376 
377 namespace roswrap
378 {
379 namespace message_operations
380 {
381 
382 template<class ContainerAllocator>
383 struct Printer< ::sensor_msgs::BatteryState_<ContainerAllocator> >
384 {
385  template<typename Stream> static void stream(Stream& s, const std::string& indent, const ::sensor_msgs::BatteryState_<ContainerAllocator>& v)
386  {
387  s << indent << "header: ";
388  s << std::endl;
390  s << indent << "voltage: ";
391  Printer<float>::stream(s, indent + " ", v.voltage);
392  s << indent << "current: ";
393  Printer<float>::stream(s, indent + " ", v.current);
394  s << indent << "charge: ";
395  Printer<float>::stream(s, indent + " ", v.charge);
396  s << indent << "capacity: ";
397  Printer<float>::stream(s, indent + " ", v.capacity);
398  s << indent << "design_capacity: ";
399  Printer<float>::stream(s, indent + " ", v.design_capacity);
400  s << indent << "percentage: ";
401  Printer<float>::stream(s, indent + " ", v.percentage);
402  s << indent << "power_supply_status: ";
403  Printer<uint8_t>::stream(s, indent + " ", v.power_supply_status);
404  s << indent << "power_supply_health: ";
405  Printer<uint8_t>::stream(s, indent + " ", v.power_supply_health);
406  s << indent << "power_supply_technology: ";
407  Printer<uint8_t>::stream(s, indent + " ", v.power_supply_technology);
408  s << indent << "present: ";
409  Printer<uint8_t>::stream(s, indent + " ", v.present);
410  s << indent << "cell_voltage[]" << std::endl;
411  for (size_t i = 0; i < v.cell_voltage.size(); ++i)
412  {
413  s << indent << " cell_voltage[" << i << "]: ";
414  Printer<float>::stream(s, indent + " ", v.cell_voltage[i]);
415  }
416  s << indent << "location: ";
417  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.location);
418  s << indent << "serial_number: ";
419  Printer<std::basic_string<char, std::char_traits<char>, typename ContainerAllocator::template rebind<char>::other > >::stream(s, indent + " ", v.serial_number);
420  }
421 };
422 
423 } // namespace message_operations
424 } // namespace roswrap
425 
426 #endif // SENSOR_MSGS_MESSAGE_BATTERYSTATE_H
roswrap::message_traits::FalseType
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Definition: message_traits.h:89
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_SAFETY_TIMER_EXPIRE
@ POWER_SUPPLY_HEALTH_SAFETY_TIMER_EXPIRE
Definition: BatteryState.h:120
sensor_msgs::BatteryStateConstPtr
std::shared_ptr< ::sensor_msgs::BatteryState const > BatteryStateConstPtr
Definition: BatteryState.h:138
sensor_msgs::BatteryState_::cell_voltage
_cell_voltage_type cell_voltage
Definition: BatteryState.h:98
sensor_msgs::BatteryState_::Type
BatteryState_< ContainerAllocator > Type
Definition: BatteryState.h:26
sensor_msgs::BatteryState_::_charge_type
float _charge_type
Definition: BatteryState.h:73
multiscan_pcap_player.indent
indent
Definition: multiscan_pcap_player.py:252
roswrap::serialization::Serializer
Templated serialization class. Default implementation provides backwards compatibility with old messa...
Definition: serialization.h:120
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_UNKNOWN
@ POWER_SUPPLY_HEALTH_UNKNOWN
Definition: BatteryState.h:112
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_LIMN
@ POWER_SUPPLY_TECHNOLOGY_LIMN
Definition: BatteryState.h:127
sensor_msgs::BatteryState_::current
_current_type current
Definition: BatteryState.h:71
roswrap::message_traits::HasHeader
HasHeader informs whether or not there is a header that gets serialized as the first thing in the mes...
Definition: message_traits.h:107
sensor_msgs::BatteryState_::_power_supply_technology_type
uint8_t _power_supply_technology_type
Definition: BatteryState.h:91
sensor_msgs::BatteryState_::_power_supply_status_type
uint8_t _power_supply_status_type
Definition: BatteryState.h:85
const
#define const
Definition: getopt.c:38
sensor_msgs::BatteryState_::_serial_number_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _serial_number_type
Definition: BatteryState.h:103
sensor_msgs::BatteryState_::power_supply_status
_power_supply_status_type power_supply_status
Definition: BatteryState.h:86
s
XmlRpcServer s
sensor_msgs::BatteryState_::_design_capacity_type
float _design_capacity_type
Definition: BatteryState.h:79
sensor_msgs::BatteryState_::_current_type
float _current_type
Definition: BatteryState.h:70
sensor_msgs::BatteryState_::_header_type
::std_msgs::Header_< ContainerAllocator > _header_type
Definition: BatteryState.h:64
sensor_msgs::BatteryState_::ConstPtr
std::shared_ptr< ::sensor_msgs::BatteryState_< ContainerAllocator > const > ConstPtr
Definition: BatteryState.h:131
sensor_msgs::BatteryState_::_power_supply_health_type
uint8_t _power_supply_health_type
Definition: BatteryState.h:88
sensor_msgs::BatteryState_::_capacity_type
float _capacity_type
Definition: BatteryState.h:76
roswrap::message_operations::Printer::stream
static void stream(Stream &s, const std::string &indent, const M &value)
Definition: message_operations.h:43
roswrap::message_traits::IsFixedSize
A fixed-size datatype is one whose size is constant, i.e. it has no variable-length arrays or strings...
Definition: message_traits.h:103
sensor_msgs::BatteryState_::POWER_SUPPLY_STATUS_UNKNOWN
@ POWER_SUPPLY_STATUS_UNKNOWN
Definition: BatteryState.h:107
sensor_msgs::BatteryState_::serial_number
_serial_number_type serial_number
Definition: BatteryState.h:104
sensor_msgs::BatteryState_::voltage
_voltage_type voltage
Definition: BatteryState.h:68
ros::message_operations::Printer
ROS_DECLARE_ALLINONE_SERIALIZER
#define ROS_DECLARE_ALLINONE_SERIALIZER
Declare your serializer to use an allInOne member instead of requiring 3 different serialization func...
Definition: serialization.h:74
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_NIMH
@ POWER_SUPPLY_TECHNOLOGY_NIMH
Definition: BatteryState.h:122
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_DEAD
@ POWER_SUPPLY_HEALTH_DEAD
Definition: BatteryState.h:115
roswrap::serialization::Serializer< ::sensor_msgs::BatteryState_< ContainerAllocator > >::allInOne
static void allInOne(Stream &stream, T m)
Definition: BatteryState.h:353
sensor_msgs::BatteryState_::BatteryState_
BatteryState_()
Definition: BatteryState.h:28
sensor_msgs::BatteryState_::header
_header_type header
Definition: BatteryState.h:65
sensor_msgs::BatteryState_::present
_present_type present
Definition: BatteryState.h:95
roswrap::message_traits::DataType
Specialize to provide the datatype for a message.
Definition: message_traits.h:135
sensor_msgs::BatteryState_::_percentage_type
float _percentage_type
Definition: BatteryState.h:82
roswrap::message_traits::MD5Sum< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value()
Definition: BatteryState.h:244
roswrap::message_traits::Definition
Specialize to provide the definition for a message.
Definition: message_traits.h:152
sensor_msgs::BatteryState_::capacity
_capacity_type capacity
Definition: BatteryState.h:77
roswrap::message_traits::Definition< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value()
Definition: BatteryState.h:268
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_UNSPEC_FAILURE
@ POWER_SUPPLY_HEALTH_UNSPEC_FAILURE
Definition: BatteryState.h:117
sensor_msgs::BatteryState_::charge
_charge_type charge
Definition: BatteryState.h:74
sensor_msgs::operator<<
std::ostream & operator<<(std::ostream &s, const ::sensor_msgs::BatteryState_< ContainerAllocator > &v)
Definition: BatteryState.h:187
sensor_msgs::BatteryState_::POWER_SUPPLY_STATUS_DISCHARGING
@ POWER_SUPPLY_STATUS_DISCHARGING
Definition: BatteryState.h:109
roswrap::message_traits::Definition< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value(const ::sensor_msgs::BatteryState_< ContainerAllocator > &)
Definition: BatteryState.h:340
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_OVERHEAT
@ POWER_SUPPLY_HEALTH_OVERHEAT
Definition: BatteryState.h:114
sensor_msgs::BatteryState_
Definition: BatteryState.h:24
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_NICD
@ POWER_SUPPLY_TECHNOLOGY_NICD
Definition: BatteryState.h:126
sensor_msgs::BatteryState_::_location_type
std::basic_string< char, std::char_traits< char >, typename ContainerAllocator::template rebind< char >::other > _location_type
Definition: BatteryState.h:100
roswrap::message_traits::DataType< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value()
Definition: BatteryState.h:257
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_LIPO
@ POWER_SUPPLY_TECHNOLOGY_LIPO
Definition: BatteryState.h:124
sensor_msgs::BatteryState_::power_supply_technology
_power_supply_technology_type power_supply_technology
Definition: BatteryState.h:92
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_OVERVOLTAGE
@ POWER_SUPPLY_HEALTH_OVERVOLTAGE
Definition: BatteryState.h:116
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_GOOD
@ POWER_SUPPLY_HEALTH_GOOD
Definition: BatteryState.h:113
roswrap::message_operations::Printer< ::sensor_msgs::BatteryState_< ContainerAllocator > >::stream
static void stream(Stream &s, const std::string &indent, const ::sensor_msgs::BatteryState_< ContainerAllocator > &v)
Definition: BatteryState.h:385
roswrap
Definition: param_modi.cpp:41
sensor_msgs::BatteryState_::_present_type
uint8_t _present_type
Definition: BatteryState.h:94
sensor_msgs::BatteryState_::Ptr
std::shared_ptr< ::sensor_msgs::BatteryState_< ContainerAllocator > > Ptr
Definition: BatteryState.h:130
roswrap::message_operations::Printer
Definition: message_operations.h:40
sensor_msgs::BatteryState_::design_capacity
_design_capacity_type design_capacity
Definition: BatteryState.h:80
std_msgs::Header_
Definition: Header.h:23
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_WATCHDOG_TIMER_EXPIRE
@ POWER_SUPPLY_HEALTH_WATCHDOG_TIMER_EXPIRE
Definition: BatteryState.h:119
sensor_msgs::BatteryState_::location
_location_type location
Definition: BatteryState.h:101
sensor_msgs::BatteryState_::POWER_SUPPLY_STATUS_CHARGING
@ POWER_SUPPLY_STATUS_CHARGING
Definition: BatteryState.h:108
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_LIFE
@ POWER_SUPPLY_TECHNOLOGY_LIFE
Definition: BatteryState.h:125
sensor_msgs::BatteryState
::sensor_msgs::BatteryState_< std::allocator< void > > BatteryState
Definition: BatteryState.h:135
sensor_msgs::BatteryState_::_cell_voltage_type
std::vector< float, typename ContainerAllocator::template rebind< float >::other > _cell_voltage_type
Definition: BatteryState.h:97
roswrap::message_traits::TrueType
Base type for compile-type true/false tests. Compatible with Boost.MPL. classes inheriting from this ...
Definition: message_traits.h:79
roswrap::message_traits::MD5Sum
Specialize to provide the md5sum for a message.
Definition: message_traits.h:118
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_UNKNOWN
@ POWER_SUPPLY_TECHNOLOGY_UNKNOWN
Definition: BatteryState.h:121
sensor_msgs::BatteryState_::power_supply_health
_power_supply_health_type power_supply_health
Definition: BatteryState.h:89
roswrap::message_traits::IsMessage
Am I message or not.
Definition: message_traits.h:112
sensor_msgs::BatteryState_::POWER_SUPPLY_HEALTH_COLD
@ POWER_SUPPLY_HEALTH_COLD
Definition: BatteryState.h:118
roswrap::message_traits::DataType< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value(const ::sensor_msgs::BatteryState_< ContainerAllocator > &)
Definition: BatteryState.h:262
sick_scan_base.h
roswrap::serialization::Stream
Stream base-class, provides common functionality for IStream and OStream.
Definition: serialization.h:705
sensor_msgs::BatteryState_::_voltage_type
float _voltage_type
Definition: BatteryState.h:67
sensor_msgs::BatteryState_::POWER_SUPPLY_STATUS_NOT_CHARGING
@ POWER_SUPPLY_STATUS_NOT_CHARGING
Definition: BatteryState.h:110
sensor_msgs::BatteryStatePtr
std::shared_ptr< ::sensor_msgs::BatteryState > BatteryStatePtr
Definition: BatteryState.h:137
roswrap::message_traits::MD5Sum< ::sensor_msgs::BatteryState_< ContainerAllocator > >::value
static const char * value(const ::sensor_msgs::BatteryState_< ContainerAllocator > &)
Definition: BatteryState.h:249
sensor_msgs::BatteryState_::POWER_SUPPLY_TECHNOLOGY_LION
@ POWER_SUPPLY_TECHNOLOGY_LION
Definition: BatteryState.h:123
sensor_msgs
Tools for manipulating sensor_msgs.
Header.h
sensor_msgs::BatteryState_::POWER_SUPPLY_STATUS_FULL
@ POWER_SUPPLY_STATUS_FULL
Definition: BatteryState.h:111
sensor_msgs::BatteryState_::BatteryState_
BatteryState_(const ContainerAllocator &_alloc)
Definition: BatteryState.h:44
sensor_msgs::BatteryState_::percentage
_percentage_type percentage
Definition: BatteryState.h:83


sick_scan_xd
Author(s): Michael Lehning , Jochen Sprickerhof , Martin Günther
autogenerated on Fri Oct 25 2024 02:47:07