Invokes the SearchFor service for testing. More...
#include "ros/ros.h"
#include "sensor_msgs/Image.h"
#include "image_transport/image_transport.h"
#include "cv_bridge/CvBridge.h"
#include "MetaFile.h"
#include <opencv/cv.h>
#include <opencv/highgui.h>
#include <std_msgs/String.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Transform.h>
#include <boost/shared_ptr.hpp>
#include "re_vision/SearchFor.h"
#include <cstdlib>
#include <string>
#include <iomanip>
Go to the source code of this file.
Classes | |
class | ImageGrabber |
Functions | |
void | createRequest (re_vision::SearchFor &srv, const cv::Mat &image) |
int | getImIdx (int idx) |
cv::Mat | loadSomeImage (int idx) |
int | main (int argc, char **argv) |
void | showResponse (const re_vision::SearchFor &srv) |
void | storeResponse (const re_vision::SearchFor &srv, const cv::Mat &image, int idx) |
Variables | |
static sensor_msgs::CvBridge | m_bridge |
static ros::Subscriber | m_camera_sub |
static ros::ServiceClient | m_client |
static ImageGrabber | m_grabber |
static ros::NodeHandle * | m_n |
static vector< string > | m_object_list |
Invokes the SearchFor service for testing.
App that calls the SearchFor service for debuggin purposes
This file is part of the RoboEarth ROS WP1 package.
It file was originally created for RoboEarth. The research leading to these results has received funding from the European Union Seventh Framework Programme FP7/2007-2013 under grant agreement no248942 RoboEarth.
Copyright (C) 2010 by Dorian Galvez-Lopez, University of Zaragoza
This program is free software: you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License as published by the Free Software Foundation, either version 3 of the License, or any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU Lesser General Public License for more details.
You should have received a copy of the GNU Lesser General Public License along with this program. If not, see <http://www.gnu.org/licenses/>.
Definition in file TestObjectDetector.cpp.
void createRequest | ( | re_vision::SearchFor & | srv, |
const cv::Mat & | image | ||
) |
Definition at line 229 of file TestObjectDetector.cpp.
int getImIdx | ( | int | idx | ) | [inline] |
Definition at line 307 of file TestObjectDetector.cpp.
cv::Mat loadSomeImage | ( | int | idx | ) |
Definition at line 311 of file TestObjectDetector.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 90 of file TestObjectDetector.cpp.
void showResponse | ( | const re_vision::SearchFor & | srv | ) |
Definition at line 251 of file TestObjectDetector.cpp.
void storeResponse | ( | const re_vision::SearchFor & | srv, |
const cv::Mat & | image, | ||
int | idx | ||
) |
Definition at line 350 of file TestObjectDetector.cpp.
sensor_msgs::CvBridge m_bridge [static] |
Definition at line 80 of file TestObjectDetector.cpp.
ros::Subscriber m_camera_sub [static] |
Definition at line 84 of file TestObjectDetector.cpp.
ros::ServiceClient m_client [static] |
Definition at line 85 of file TestObjectDetector.cpp.
ImageGrabber m_grabber [static] |
Definition at line 86 of file TestObjectDetector.cpp.
ros::NodeHandle* m_n [static] |
Definition at line 83 of file TestObjectDetector.cpp.
vector<string> m_object_list [static] |
Definition at line 79 of file TestObjectDetector.cpp.