#include "rgbd_topics.h"
Go to the source code of this file.
Functions | |
void | getParams () |
int | main (int argc, char **argv) |
void | setTopics () |
TEST (RealsenseTests, rgb_image_mono) | |
TEST (RealsenseTests, rgb_image_color) | |
TEST (RealsenseTests, rgb_image_rect_mono) | |
TEST (RealsenseTests, rgb_image_rect_color) | |
TEST (RealsenseTests, depth_image_rect_raw) | |
TEST (RealsenseTests, depth_image_rect) | |
TEST (RealsenseTests, depth_image) | |
TEST (RealsenseTests, depth_points) | |
TEST (RealsenseTests, ir_image_rect_ir) | |
TEST (RealsenseTests, depth_reg_sw_reg_image_rect_raw) | |
TEST (RealsenseTests, depth_reg_sw_reg_camera_info) | |
TEST (RealsenseTests, depth_reg_points) | |
TEST (RealsenseTests, depth_reg_sw_reg_image_rect) | |
void | topic0Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic10Callback (const sensor_msgs::CameraInfoConstPtr msg) |
void | topic11Callback (const sensor_msgs::PointCloud2ConstPtr msg) |
void | topic12Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic1Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic2Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic3Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic4Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic5Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic6Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic7Callback (const sensor_msgs::PointCloud2ConstPtr msg) |
void | topic8Callback (const sensor_msgs::ImageConstPtr msg) |
void | topic9Callback (const sensor_msgs::ImageConstPtr msg) |
void getParams | ( | ) |
Definition at line 202 of file rgbd_topics.cpp.
Definition at line 229 of file rgbd_topics.cpp.
void setTopics | ( | ) |
Definition at line 212 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
rgb_image_mono | |||
) |
Definition at line 137 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
rgb_image_color | |||
) |
Definition at line 142 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
rgb_image_rect_mono | |||
) |
Definition at line 147 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
rgb_image_rect_color | |||
) |
Definition at line 152 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_image_rect_raw | |||
) |
Definition at line 157 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_image_rect | |||
) |
Definition at line 162 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_image | |||
) |
Definition at line 167 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_points | |||
) |
Definition at line 172 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
ir_image_rect_ir | |||
) |
Definition at line 177 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_reg_sw_reg_image_rect_raw | |||
) |
Definition at line 182 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_reg_sw_reg_camera_info | |||
) |
Definition at line 187 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_reg_points | |||
) |
Definition at line 192 of file rgbd_topics.cpp.
TEST | ( | RealsenseTests | , |
depth_reg_sw_reg_image_rect | |||
) |
Definition at line 197 of file rgbd_topics.cpp.
void topic0Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 33 of file rgbd_topics.cpp.
void topic10Callback | ( | const sensor_msgs::CameraInfoConstPtr | msg | ) |
Definition at line 113 of file rgbd_topics.cpp.
void topic11Callback | ( | const sensor_msgs::PointCloud2ConstPtr | msg | ) |
Definition at line 121 of file rgbd_topics.cpp.
void topic12Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 129 of file rgbd_topics.cpp.
void topic1Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 41 of file rgbd_topics.cpp.
void topic2Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 49 of file rgbd_topics.cpp.
void topic3Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 57 of file rgbd_topics.cpp.
void topic4Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 65 of file rgbd_topics.cpp.
void topic5Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 73 of file rgbd_topics.cpp.
void topic6Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 81 of file rgbd_topics.cpp.
void topic7Callback | ( | const sensor_msgs::PointCloud2ConstPtr | msg | ) |
Definition at line 89 of file rgbd_topics.cpp.
void topic8Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 97 of file rgbd_topics.cpp.
void topic9Callback | ( | const sensor_msgs::ImageConstPtr | msg | ) |
Definition at line 105 of file rgbd_topics.cpp.