#include <std_msgs/Float64.h>#include <std_msgs/Int64.h>#include <std_msgs/UInt64.h>#include <std_msgs/Bool.h>#include <XmlRpcException.h>#include <stdint.h>#include <endian.h>#include <boost/format.hpp>#include <cob_bms_driver/cob_bms_driver_node.h>
Go to the source code of this file.
Classes | |
| struct | BooleanBmsParameter |
| struct | FloatBmsParameter |
| struct | IntBmsParameter |
| struct | TypedBmsParameter< T > |
| struct | UIntBmsParameter |
Functions | |
| template<int N> | |
| void | big_endian_to_host (const void *in, void *out) |
| template<> | |
| void | big_endian_to_host< 1 > (const void *in, void *out) |
| template<> | |
| void | big_endian_to_host< 2 > (const void *in, void *out) |
| template<> | |
| void | big_endian_to_host< 4 > (const void *in, void *out) |
| template<> | |
| void | big_endian_to_host< 8 > (const void *in, void *out) |
| int | main (int argc, char **argv) |
| template<typename T > | |
| T | read_value (const can::Frame &f, uint8_t offset) |
| template<typename T > | |
| bool | readTypedValue (const can::Frame &f, const BmsParameter ¶m, T &data) |
| void big_endian_to_host | ( | const void * | in, |
| void * | out | ||
| ) |
| void big_endian_to_host< 1 > | ( | const void * | in, |
| void * | out | ||
| ) |
Definition at line 34 of file cob_bms_driver_node.cpp.
| void big_endian_to_host< 2 > | ( | const void * | in, |
| void * | out | ||
| ) |
Definition at line 35 of file cob_bms_driver_node.cpp.
| void big_endian_to_host< 4 > | ( | const void * | in, |
| void * | out | ||
| ) |
Definition at line 36 of file cob_bms_driver_node.cpp.
| void big_endian_to_host< 8 > | ( | const void * | in, |
| void * | out | ||
| ) |
Definition at line 37 of file cob_bms_driver_node.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 458 of file cob_bms_driver_node.cpp.
| T read_value | ( | const can::Frame & | f, |
| uint8_t | offset | ||
| ) |
Definition at line 39 of file cob_bms_driver_node.cpp.
| bool readTypedValue | ( | const can::Frame & | f, |
| const BmsParameter & | param, | ||
| T & | data | ||
| ) |
Definition at line 44 of file cob_bms_driver_node.cpp.