1 #ifndef PAL_STATISTICS_MSG_H 2 #define PAL_STATISTICS_MSG_H 10 #include <std_msgs/Header.h> 37 namespace serialization
42 template <
typename Stream,
typename T>
45 stream.next(m.header);
47 stream.next(m.names_version);
55 template <
typename Stream,
typename T>
58 stream.next(m.header);
59 stream.next(m.values);
60 stream.next(m.names_version);
86 std::string values_topic_name = _topic_name;
87 values_topic_name.replace(values_topic_name.find(
"names"), 5,
"values");
111 double header_stamp = pal_msg.
header.stamp.toSec();
112 timestamp = (_config.use_header_stamp && header_stamp > 0) ? header_stamp : timestamp;
116 if (names_it == statistics_map.end())
120 const auto&
names = names_it->second;
140 std::unordered_map<uint32_t, std::vector<PJ::PlotData*>>
_data;
143 #endif // PAL_STATISTICS_MSG_H PalStatisticsNamesParser(const std::string &topic_name, PJ::PlotDataMapRef &plot_data)
std::unordered_map< uint32_t, std::vector< PJ::PlotData * > > _data
std::unordered_map< uint32_t, std::vector< std::string > > TopicStatistics
std::vector< double > values
#define ROS_DECLARE_ALLINONE_SERIALIZER
virtual bool parseMessage(MessageRef msg, double ×tamp) override
std::vector< std::string > names
static void allInOne(Stream &stream, T m)
static std::unordered_map< std::string, TopicStatistics > _stored_pal_statistics_names
std::vector< double > values
FMT_INLINE std::basic_string< Char > format(const S &format_str, Args &&... args)
PalStatisticsValuesParser(const std::string &topic_name, PJ::PlotDataMapRef &plot_data)
const uint8_t * data() const
virtual bool parseMessage(MessageRef msg, double ×tamp) override
void deserialize(Stream &stream, T &t)
static void allInOne(Stream &stream, T m)