#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <object_config.h>#include <asr_fake_object_recognition/GetRecognizer.h>#include <asr_fake_object_recognition/ReleaseRecognizer.h>#include <asr_fake_object_recognition/GetAllRecognizers.h>#include <asr_fake_object_recognition/ClearAllRecognizers.h>#include <tf/tf.h>#include <tf/transform_listener.h>#include <asr_msgs/AsrObject.h>#include <visualization_msgs/Marker.h>#include <dynamic_reconfigure/server.h>#include <asr_fake_object_recognition/FakeObjectRecognitionConfig.h>#include <error_simulation.h>#include <std_msgs/ColorRGBA.h>#include <geometry_msgs/Point.h>#include <Eigen/Geometry>#include <visualization_msgs/MarkerArray.h>

Go to the source code of this file.
Classes | |
| class | fake_object_recognition::FakeObjectRecognition |
| The central class of the recognition system used for managing the ros subscriptions, configuration changes, loading of the objects, the recognition itself and the visualisation of the results. More... | |
Namespaces | |
| namespace | fake_object_recognition |
Functions | |
| static const std::string | fake_object_recognition::CLEAR_ALL_RECOGNIZERS_SERVICE_NAME ("clear_all_recognizers") |
| static const std::string | fake_object_recognition::GET_ALL_RECOGNIZERS_SERVICE_NAME ("get_all_recognizers") |
| static const std::string | fake_object_recognition::GET_RECOGNIZER_SERVICE_NAME ("get_recognizer") |
| static const std::string | fake_object_recognition::NODE_NAME ("asr_fake_object_recognition") |
| static const std::string | fake_object_recognition::RELEASE_RECOGNIZER_SERVICE_NAME ("release_recognizer") |