#include <ros/ros.h>#include <ros/node_handle.h>#include <sensor_msgs/image_encodings.h>#include <image_transport/image_transport.h>#include <cv_bridge/CvBridge.h>#include <opencv/cv.h>#include <opencv2/legacy/legacy.hpp>#include <opencv/highgui.h>#include <string.h>#include <iostream>#include "ccd/auto_init.h"#include <ccd/bspline.h>#include <ccd/ccd.h>#include <geometry_msgs/PolygonStamped.h>
Go to the source code of this file.
Classes | |
| class | CCDNode |
Functions | |
| int | main (int argc, char **argv) |
| void | on_mouse (int event, int x, int y, int flags, void *param) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 227 of file ccd_node.cpp.
| void on_mouse | ( | int | event, |
| int | x, | ||
| int | y, | ||
| int | flags, | ||
| void * | param | ||
| ) |
Definition at line 202 of file ccd_node.cpp.