Classes | Functions
ImageRecognizer.h File Reference
#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>
Include dependency graph for ImageRecognizer.h:
This graph shows which files directly or indirectly include this file:

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)

Function Documentation

int main ( int  argc,
char **  argv 
)

Creates and runs the imagerecogniter node.

Parameters:
argcargument count that is passed to ros::init
argvarguments that are passed to ros::init
Returns:
EXIT_SUCCESS if the node runs correctly

Creates and runs the test_image_recognizer node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly.

Creates and runs the metric_trainer node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly or EXIT_FAILURE if an error occurs.

Creates and runs the model_generator node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly or EXIT_FAILURE if an error occurs.

Creates and runs the object_recognition_listener node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly or EXIT_FAILURE if an error occurs.

Creates and runs the object_recognizer node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly or EXIT_FAILURE if an error occurs.

Creates and runs the rail_grasp_model_retriever node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly or EXIT_FAILURE if an error occurs.

Creates and runs the train_image_recognizer node.

Parameters:
argcargument count that is passed to ros::init.
argvarguments that are passed to ros::init.
Returns:
EXIT_SUCCESS if the node runs correctly.

Definition at line 21 of file collect_images.cpp.



rail_recognition
Author(s): David Kent , Russell Toris , bhetherman
autogenerated on Sun Mar 6 2016 11:39:13