rgbd_topics.h
Go to the documentation of this file.
1 /******************************************************************************
2  Copyright (c) 2016, Intel Corporation
3  All rights reserved.
4 
5  Redistribution and use in source and binary forms, with or without
6  modification, are permitted provided that the following conditions are met:
7 
8  1. Redistributions of source code must retain the above copyright notice, this
9  list of conditions and the following disclaimer.
10 
11  2. Redistributions in binary form must reproduce the above copyright notice,
12  this list of conditions and the following disclaimer in the documentation
13  and/or other materials provided with the distribution.
14 
15  3. Neither the name of the copyright holder nor the names of its contributors
16  may be used to endorse or promote products derived from this software without
17  specific prior written permission.
18 
19  THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS "AS IS"
20  AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE
21  IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS FOR A PARTICULAR PURPOSE ARE
22  DISCLAIMED. IN NO EVENT SHALL THE COPYRIGHT HOLDER OR CONTRIBUTORS BE LIABLE
23  FOR ANY DIRECT, INDIRECT, INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL
24  DAMAGES (INCLUDING, BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR
25  SERVICES; LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
26  CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY,
27  OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE
28  OF THIS SOFTWARE, EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
29  *******************************************************************************/
30 
31 #pragma once
32 #ifndef RGBD_TOPICS_H // NOLINT(build/header_guard)
33 #define RGBD_TOPICS_H
34 
35 #include <string>
36 
39 #include <std_msgs/String.h>
40 #include <ros/ros.h>
42 #include <gtest/gtest.h>
43 
44 static const int TOPIC_COUNT = 13;
45 
46 std::string RGB_IMAGE_MONO = "image_mono";
47 std::string RGB_IMAGE_COLOR = "image_color";
48 std::string RGB_IMAGE_RECT_MONO = "image_rect_mono";
49 std::string RGB_IMAGE_RECT_COLOR = "image_rect_color";
50 std::string DEPTH_IMAGE_RECT_RAW = "image_rect_raw";
51 std::string DEPTH_IMAGE_RECT = "image_rect";
52 std::string DEPTH_IMAGE = "image";
53 std::string DEPTH_POINTS = "points";
54 std::string IR_IMAGE_RECT_IR = "image_rect_ir";
55 std::string DEPTH_REG_SW_REG_IMAGE_RECT_RAW = "sw_registered/image_rect_raw";
56 std::string DEPTH_REG_SW_REG_CAMERA_INFO = "sw_registered/camera_info";
57 std::string DEPTH_REG_POINTS = "points";
58 std::string DEPTH_REG_SW_REG_IMAGE_RECT = "sw_registered/image_rect";
59 
60 std::string CAMERA = "camera";
61 std::string RGB = "rgb";
62 std::string DEPTH = "depth";
63 std::string IR = "ir";
64 std::string DEPTH_REGISTERED = "depth_registered";
65 
66 std::string camera;
67 std::string rgb;
68 std::string depth;
69 std::string ir;
70 std::string depth_registered;
71 
72 std::string rgb_image_mono;
73 std::string rgb_image_color;
74 std::string rgb_image_rect_mono;
77 std::string depth_image_rect;
78 std::string depth_image;
79 std::string depth_points;
80 std::string ir_image_rect_ir;
83 std::string depth_reg_points;
85 
86 bool topic_0_recv = false;
87 bool topic_1_recv = false;
88 bool topic_2_recv = false;
89 bool topic_3_recv = false;
90 bool topic_4_recv = false;
91 bool topic_5_recv = false;
92 bool topic_6_recv = false;
93 bool topic_7_recv = false;
94 bool topic_8_recv = false;
95 bool topic_9_recv = false;
96 bool topic_10_recv = false;
97 bool topic_11_recv = false;
98 bool topic_12_recv = false;
99 
101 #endif // RGBD_TOPICS_H // NOLINT(build/header_guard)
std::string ir
Definition: rgbd_topics.h:69
std::string depth_reg_sw_reg_image_rect_raw
Definition: rgbd_topics.h:81
std::string DEPTH_REG_SW_REG_IMAGE_RECT
Definition: rgbd_topics.h:58
std::string DEPTH_POINTS
Definition: rgbd_topics.h:53
static const int TOPIC_COUNT
Definition: rgbd_topics.h:44
std::string depth_points
Definition: rgbd_topics.h:79
bool topic_6_recv
Definition: rgbd_topics.h:92
std::string depth_registered
Definition: rgbd_topics.h:70
std::string ir_image_rect_ir
Definition: rgbd_topics.h:80
std::string CAMERA
Definition: rgbd_topics.h:60
ros::Subscriber subscriber[TOPIC_COUNT]
Definition: rgbd_topics.h:100
bool topic_1_recv
Definition: rgbd_topics.h:87
std::string DEPTH_REGISTERED
Definition: rgbd_topics.h:64
bool topic_2_recv
Definition: rgbd_topics.h:88
std::string depth
Definition: rgbd_topics.h:68
std::string depth_reg_sw_reg_image_rect
Definition: rgbd_topics.h:84
std::string IR
Definition: rgbd_topics.h:63
std::string DEPTH_REG_SW_REG_CAMERA_INFO
Definition: rgbd_topics.h:56
bool topic_11_recv
Definition: rgbd_topics.h:97
bool topic_5_recv
Definition: rgbd_topics.h:91
std::string depth_reg_points
Definition: rgbd_topics.h:83
std::string RGB_IMAGE_MONO
Definition: rgbd_topics.h:46
std::string DEPTH_IMAGE_RECT_RAW
Definition: rgbd_topics.h:50
std::string rgb_image_rect_mono
Definition: rgbd_topics.h:74
std::string RGB_IMAGE_RECT_COLOR
Definition: rgbd_topics.h:49
std::string rgb
Definition: rgbd_topics.h:67
std::string depth_image_rect_raw
Definition: rgbd_topics.h:76
bool topic_8_recv
Definition: rgbd_topics.h:94
std::string IR_IMAGE_RECT_IR
Definition: rgbd_topics.h:54
std::string RGB
Definition: rgbd_topics.h:61
std::string camera
Definition: rgbd_topics.h:66
std::string DEPTH_IMAGE_RECT
Definition: rgbd_topics.h:51
bool topic_9_recv
Definition: rgbd_topics.h:95
std::string depth_image
Definition: rgbd_topics.h:78
std::string DEPTH_REG_POINTS
Definition: rgbd_topics.h:57
bool topic_0_recv
Definition: rgbd_topics.h:86
bool topic_3_recv
Definition: rgbd_topics.h:89
std::string rgb_image_color
Definition: rgbd_topics.h:73
std::string RGB_IMAGE_RECT_MONO
Definition: rgbd_topics.h:48
bool topic_12_recv
Definition: rgbd_topics.h:98
bool topic_7_recv
Definition: rgbd_topics.h:93
std::string DEPTH
Definition: rgbd_topics.h:62
std::string DEPTH_IMAGE
Definition: rgbd_topics.h:52
std::string depth_reg_sw_reg_camera_info
Definition: rgbd_topics.h:82
std::string depth_image_rect
Definition: rgbd_topics.h:77
bool topic_4_recv
Definition: rgbd_topics.h:90
std::string RGB_IMAGE_COLOR
Definition: rgbd_topics.h:47
std::string rgb_image_rect_color
Definition: rgbd_topics.h:75
std::string rgb_image_mono
Definition: rgbd_topics.h:72
std::string DEPTH_REG_SW_REG_IMAGE_RECT_RAW
Definition: rgbd_topics.h:55
bool topic_10_recv
Definition: rgbd_topics.h:96


realsense_camera
Author(s): Rajvi Jingar , Reagan Lopez , Matt Hansen , Mark Horn
autogenerated on Mon Jun 10 2019 14:40:37