#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <diagnostic_updater/publisher.h>#include <stdio.h>#include <limits.h>
Go to the source code of this file.
Defines | |
| #define | BASESIZE 1000000 |
| #define | NUMSKIP 400 |
Functions | |
| int | bound (int x, int min, int max) |
| void | callback (const sensor_msgs::ImageConstPtr &msg) |
| void | callback2 (const sensor_msgs::ImageConstPtr &msg) |
| void | insert (int *max, int val) |
| int | main (int argc, char **argv) |
Variables | |
| uint8_t | base [BASESIZE] |
| int | endx |
| int | endy |
| FILE * | gnuplotfile |
| int | oldheight = 0 |
| int | oldwidth = 0 |
| int | startx |
| int | starty |
| FILE* gnuplotfile |