Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016 #ifndef MRPT_BRIDGE_STEREO_IMAGE_H
00017 #define MRPT_BRIDGE_STEREO_IMAGE_H
00018
00019 #include <cstring>
00020 #include <sensor_msgs/Image.h>
00021 #include <mrpt/obs/CObservationStereoImages.h>
00022 #include <stereo_msgs/DisparityImage.h>
00023
00024 using namespace mrpt::obs;
00025
00026
00027 namespace mrpt_bridge
00028 {
00029 namespace stereo_image
00030 {
00031 bool mrpt2ros(const CObservationStereoImages &obj,const std_msgs::Header &msg_header,
00032 sensor_msgs::Image &left, sensor_msgs::Image &right,
00033 stereo_msgs::DisparityImage &disparity);
00034 }
00035 }
00036
00037
00038 #endif //MRPT_BRIDGE_STEREO_IMAGE_H