#include <image_view/ImageViewConfig.h>
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <dynamic_reconfigure/server.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/highgui/highgui.hpp>
#include <boost/format.hpp>
#include <boost/thread.hpp>
#include <boost/filesystem.hpp>
Go to the source code of this file.
Functions | |
void | imageCb (const sensor_msgs::ImageConstPtr &msg) |
int | main (int argc, char **argv) |
static void | mouseCb (int event, int x, int y, int flags, void *param) |
void | reconfigureCb (image_view::ImageViewConfig &config, uint32_t level) |
Variables | |
int | g_colormap |
int | g_count |
bool | g_do_dynamic_scaling |
boost::format | g_filename_format |
bool | g_gui |
boost::mutex | g_image_mutex |
cv::Mat | g_last_image |
double | g_max_image_value |
double | g_min_image_value |
ros::Publisher | g_pub |
std::string | g_window_name |
void imageCb | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 68 of file image_view.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 138 of file image_view.cpp.
static void mouseCb | ( | int | event, |
int | x, | ||
int | y, | ||
int | flags, | ||
void * | param | ||
) | [static] |
Definition at line 109 of file image_view.cpp.
void reconfigureCb | ( | image_view::ImageViewConfig & | config, |
uint32_t | level | ||
) |
Definition at line 59 of file image_view.cpp.
int g_colormap |
Definition at line 55 of file image_view.cpp.
int g_count |
Definition at line 47 of file image_view.cpp.
bool g_do_dynamic_scaling |
Definition at line 54 of file image_view.cpp.
boost::format g_filename_format |
Definition at line 49 of file image_view.cpp.
bool g_gui |
Definition at line 52 of file image_view.cpp.
boost::mutex g_image_mutex |
Definition at line 50 of file image_view.cpp.
cv::Mat g_last_image |
Definition at line 48 of file image_view.cpp.
double g_max_image_value |
Definition at line 57 of file image_view.cpp.
double g_min_image_value |
Definition at line 56 of file image_view.cpp.
Definition at line 53 of file image_view.cpp.
std::string g_window_name |
Definition at line 51 of file image_view.cpp.