image.h
Go to the documentation of this file.
00001 /* +------------------------------------------------------------------------+
00002    |                     Mobile Robot Programming Toolkit (MRPT)            |
00003    |                          http://www.mrpt.org/                          |
00004    |                                                                        |
00005    | Copyright (c) 2005-2017, Individual contributors, see AUTHORS file     |
00006    | See: http://www.mrpt.org/Authors - All rights reserved.                |
00007    | Released under BSD License. See details in http://www.mrpt.org/License |
00008    +------------------------------------------------------------------------+ */
00009 
00010 /*---------------------------------------------------------------
00011         APPLICATION: mrpt_ros bridge
00012         FILE: image.h
00013         AUTHOR: Raghavender Sahdev <raghavendersahdev@gmail.com>
00014   ---------------------------------------------------------------*/
00015 
00016 #ifndef MRPT_BRIDGE_IMAGE_H
00017 #define MRPT_BRIDGE_IMAGE_H
00018 
00019 #include <cstring> // size_t
00020 #include <sensor_msgs/Image.h>
00021 #include <mrpt/obs/CObservationImage.h>
00022 
00023 using namespace mrpt::obs;
00024 
00025 
00026 namespace mrpt_bridge
00027 {
00028     namespace image
00029     {
00030         bool ros2mrpt(const sensor_msgs::Image &msg,  CObservationImage &obj);
00031         bool mrpt2ros(const CObservationImage &obj,const std_msgs::Header &msg_header, sensor_msgs::Image &msg);
00032     }
00033 }
00034 
00035 
00036 #endif //MRPT_BRIDGE_IMAGE_H


mrpt_bridge
Author(s): Markus Bader , Raphael Zack
autogenerated on Fri Apr 27 2018 05:10:54