#include "ros/ros.h"
#include "nav_msgs/Odometry.h"
#include "opencv2/highgui/highgui.hpp"
#include "opencv2/imgproc/imgproc.hpp"
#include "sensor_msgs/image_encodings.h"
#include "tf/transform_broadcaster.h"
#include "cirkit_waypoint_navigator/TeleportAbsolute.h"
#include <stdio.h>
Go to the source code of this file.
Classes | |
class | RemoteMonitorServer |
Enumerations | |
enum | MAP_COORD { INDEX_X, INDEX_Y, INDEX_Z } |
enum | RESULT { OK, NG } |
enum | WAIT_KEY_MODE { CURR_POSITON, HISTORY_POSITION, QUIT } |
Functions | |
int | fillPolygonAndShow () |
int | humanDrawAndShow () |
int | main (int argc, char **argv) |
Variables | |
static const int | ARROW_LENGTH = 10 |
static const cv::Scalar | BLUE = cv::Scalar(255, 0, 0) |
static const int | CV_WAIT_KEY_RATE = 50 |
static const std::string | DEFAULT_MAP_NAME = "201510240538.pgm" |
static const double | DEFAULT_MAP_RESOLUTION = 0.1 |
static const double | DEFAULT_RESIZE_RATIO = 0.2 |
static const cv::Scalar | GREEN = cv::Scalar(0, 128, 0) |
static const std::string | MAP_PATH = "/map/" |
static const std::string | MAP_WINDOW_NAME = "Map Monitor" |
static const std::string | PARAM_NAME_MAP_NAME = "/image" |
static const std::string | PARAM_NAME_MAP_ORIGIN = "/origin" |
static const std::string | PARAM_NAME_MAP_RESOLUTION = "/resolution" |
static const std::string | PARAM_NAME_RATIO_PARAM = "/ratio" |
static const cv::Scalar | RED = cv::Scalar(0, 0, 255) |
static const int | ROS_SPIN_RATE = 100 |
enum MAP_COORD |
Definition at line 42 of file monitor_server.cpp.
enum RESULT |
Definition at line 36 of file monitor_server.cpp.
enum WAIT_KEY_MODE |
Definition at line 29 of file monitor_server.cpp.
int fillPolygonAndShow | ( | ) |
Create some points
Definition at line 366 of file monitor_server.cpp.
int humanDrawAndShow | ( | ) |
Create some points
Definition at line 394 of file monitor_server.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 423 of file monitor_server.cpp.
const int ARROW_LENGTH = 10 [static] |
Definition at line 22 of file monitor_server.cpp.
const cv::Scalar BLUE = cv::Scalar(255, 0, 0) [static] |
Definition at line 21 of file monitor_server.cpp.
const int CV_WAIT_KEY_RATE = 50 [static] |
Definition at line 18 of file monitor_server.cpp.
const std::string DEFAULT_MAP_NAME = "201510240538.pgm" [static] |
Definition at line 25 of file monitor_server.cpp.
const double DEFAULT_MAP_RESOLUTION = 0.1 [static] |
Definition at line 26 of file monitor_server.cpp.
const double DEFAULT_RESIZE_RATIO = 0.2 [static] |
Definition at line 27 of file monitor_server.cpp.
const cv::Scalar GREEN = cv::Scalar(0, 128, 0) [static] |
Definition at line 20 of file monitor_server.cpp.
const std::string MAP_PATH = "/map/" [static] |
Definition at line 12 of file monitor_server.cpp.
const std::string MAP_WINDOW_NAME = "Map Monitor" [static] |
Definition at line 16 of file monitor_server.cpp.
const std::string PARAM_NAME_MAP_NAME = "/image" [static] |
Definition at line 13 of file monitor_server.cpp.
const std::string PARAM_NAME_MAP_ORIGIN = "/origin" [static] |
Definition at line 15 of file monitor_server.cpp.
const std::string PARAM_NAME_MAP_RESOLUTION = "/resolution" [static] |
Definition at line 14 of file monitor_server.cpp.
const std::string PARAM_NAME_RATIO_PARAM = "/ratio" [static] |
Definition at line 11 of file monitor_server.cpp.
const cv::Scalar RED = cv::Scalar(0, 0, 255) [static] |
Definition at line 19 of file monitor_server.cpp.
const int ROS_SPIN_RATE = 100 [static] |
Definition at line 17 of file monitor_server.cpp.