#include <algorithm>#include <iostream>#include <sstream>#include <stdlib.h>#include <string>#include <vector>#include <sensor_msgs/PointCloud2.h>#include <sensor_msgs/PointField.h>

Go to the source code of this file.
| Functions | |
| bool | count_data_mismatch (const sensor_msgs::PointCloud2 &expected_ground, const sensor_msgs::PointCloud2 &expected_no_ground, const sensor_msgs::PointCloud2 &tested_ground, const sensor_msgs::PointCloud2 &tested_no_ground, uint *out_false_ground_count, uint *out_false_no_ground_count) | 
| std::string | decode_chunk (const sensor_msgs::PointCloud2 &sensor_msg, uint index) | 
| bool | equals (const sensor_msgs::PointCloud2 &lhs, const sensor_msgs::PointCloud2 &rhs) | 
| std::string | find_mismatches (const sensor_msgs::PointCloud2 &expected, const sensor_msgs::PointCloud2 &tested, bool locate_first_data_disparity=false) | 
| std::string | get_first_mismatch (const std::vector< uint8_t > &expected, const std::vector< uint8_t > &tested, uint chunk_size, uint *out_index=nullptr) | 
| bool count_data_mismatch | ( | const sensor_msgs::PointCloud2 & | expected_ground, | 
| const sensor_msgs::PointCloud2 & | expected_no_ground, | ||
| const sensor_msgs::PointCloud2 & | tested_ground, | ||
| const sensor_msgs::PointCloud2 & | tested_no_ground, | ||
| uint * | out_false_ground_count, | ||
| uint * | out_false_no_ground_count | ||
| ) | 
Definition at line 313 of file sensor_msg_comparison.h.
| std::string decode_chunk | ( | const sensor_msgs::PointCloud2 & | sensor_msg, | 
| uint | index | ||
| ) | 
Definition at line 86 of file sensor_msg_comparison.h.
| bool equals | ( | const sensor_msgs::PointCloud2 & | lhs, | 
| const sensor_msgs::PointCloud2 & | rhs | ||
| ) | 
Definition at line 27 of file sensor_msg_comparison.h.
| std::string find_mismatches | ( | const sensor_msgs::PointCloud2 & | expected, | 
| const sensor_msgs::PointCloud2 & | tested, | ||
| bool | locate_first_data_disparity = false | ||
| ) | 
Definition at line 196 of file sensor_msg_comparison.h.
| std::string get_first_mismatch | ( | const std::vector< uint8_t > & | expected, | 
| const std::vector< uint8_t > & | tested, | ||
| uint | chunk_size, | ||
| uint * | out_index = nullptr | ||
| ) | 
Definition at line 159 of file sensor_msg_comparison.h.