#include <ros/ros.h>
#include <ros/package.h>
#include <time.h>
#include <stdio.h>
#include <sensor_msgs/JointState.h>
#include <iostream>
#include <fstream>
#include <string>
#include <dirent.h>
#include <std_srvs/Empty.h>
#include <sys/stat.h>
#include <map>
#include <rail_manipulation_msgs/SegmentedObjectList.h>
#include <sensor_msgs/Image.h>
#include <opencv2/opencv.hpp>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv2/core/core.hpp>
#include <opencv2/features2d/features2d.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <opencv2/ml/ml.hpp>
#include <boost/filesystem.hpp>
Go to the source code of this file.
Classes | |
class | ImageRecognizer |
provides a framework to train and test an ANN for image recognition More... | |
Functions | |
int | main (int argc, char **argv) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Creates and runs the imagerecogniter node.
argc | argument count that is passed to ros::init |
argv | arguments that are passed to ros::init |
Creates and runs the test_image_recognizer node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the metric_trainer node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the model_generator node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the object_recognition_listener node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the object_recognizer node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the rail_grasp_model_retriever node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Creates and runs the train_image_recognizer node.
argc | argument count that is passed to ros::init. |
argv | arguments that are passed to ros::init. |
Definition at line 21 of file collect_images.cpp.