#include <ros/ros.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/Image.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>#include <jsk_recognition_msgs/PlotData.h>#include "one_data_stat.h"
Go to the source code of this file.
| Defines | |
| #define | BOOST_PARAMETER_MAX_ARITY 7 | 
| Visualize error of sensor_msgs/LaserScan. | |
| Functions | |
| void | callback (const sensor_msgs::LaserScan::ConstPtr &msg) | 
| callback function | |
| void | generateImage (const std::vector< OneDataStat::Ptr > &stats, cv::Mat &image, boost::function< double(OneDataStat &)> accessor) | 
| generate a float image according to accessor. | |
| int | main (int argc, char **argv) | 
| void | publishImage (const cv::Mat &image, ros::Publisher &pub) | 
| publish a float image. | |
| Variables | |
| std::vector< OneDataStat::Ptr > | g_data | 
| global variable to store stat information. | |
| ros::Publisher | pub_mean | 
| publisher for mean, variance and standard deviation images | |
| ros::Publisher | pub_stddev | 
| ros::Publisher | pub_stddev_plot | 
| ros::Publisher | pub_variance | 
| ros::Publisher | pub_variance_plot | 
| publisher for variance and standard deviation values for plotting | |
| #define BOOST_PARAMETER_MAX_ARITY 7 | 
Visualize error of sensor_msgs/LaserScan.
Definition at line 41 of file range_sensor_error_visualization.cpp.
| void callback | ( | const sensor_msgs::LaserScan::ConstPtr & | msg | ) | 
callback function
Definition at line 117 of file range_sensor_error_visualization.cpp.
| void generateImage | ( | const std::vector< OneDataStat::Ptr > & | stats, | 
| cv::Mat & | image, | ||
| boost::function< double(OneDataStat &)> | accessor | ||
| ) | 
generate a float image according to accessor.
Definition at line 58 of file range_sensor_error_visualization.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 166 of file range_sensor_error_visualization.cpp.
| void publishImage | ( | const cv::Mat & | image, | 
| ros::Publisher & | pub | ||
| ) | 
publish a float image.
Definition at line 105 of file range_sensor_error_visualization.cpp.
global variable to store stat information.
Definition at line 86 of file range_sensor_error_visualization.cpp.
publisher for mean, variance and standard deviation images
Definition at line 92 of file range_sensor_error_visualization.cpp.
Definition at line 92 of file range_sensor_error_visualization.cpp.
Definition at line 98 of file range_sensor_error_visualization.cpp.
Definition at line 92 of file range_sensor_error_visualization.cpp.
publisher for variance and standard deviation values for plotting
Definition at line 98 of file range_sensor_error_visualization.cpp.