#include <iostream>#include <sstream>#include <assert.h>#include <algorithm>#include <ros/ros.h>#include <ros/package.h>#include <tf/tf.h>#include <image_transport/image_transport.h>#include <opencv/cv.h>#include <cv_bridge/CvBridge.h>#include <opencv2/imgproc/imgproc.hpp>#include <opencv2/highgui/highgui.hpp>#include <sensor_msgs/Image.h>#include <ee_cart_imped_action/ee_cart_imped_arm.hh>#include <portrait_painter/getLines.h>#include <portrait_painter/JobSubmission.h>#include <portrait_painter/Point2D.h>#include <portrait_robot_msgs/alubsc_node_instr.h>#include <portrait_robot_msgs/alubsc_status_msg.h>#include <portrait_painter/PainterUtils.h>
Go to the source code of this file.
| Functions | |
| bool | handleInstruction (portrait_robot_msgs::alubsc_node_instr::Request &req, portrait_robot_msgs::alubsc_node_instr::Response &res) | 
| int | main (int argc, char **argv) | 
| int | processImage (string filename) | 
| Variables | |
| string | jobFilename | 
| bool | jobScheduled | 
| bool handleInstruction | ( | portrait_robot_msgs::alubsc_node_instr::Request & | req, | 
| portrait_robot_msgs::alubsc_node_instr::Response & | res | ||
| ) | 
let the brige convert the image if needed
Definition at line 63 of file getLinesMain.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 38 of file getLinesMain.cpp.
| int processImage | ( | string | filename | ) | 
Definition at line 89 of file getLinesMain.cpp.
| string jobFilename | 
Definition at line 36 of file getLinesMain.cpp.
Definition at line 35 of file getLinesMain.cpp.