range.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: range.h
00013         AUTHOR: Raghavender Sahdev <raghavendersahdev@gmail.com>
00014   ---------------------------------------------------------------*/
00015 
00016 #ifndef MRPT_BRIDGE_RANGE_H
00017 #define MRPT_BRIDGE_RANGE_H
00018 
00019 #include <sensor_msgs/Range.h>
00020 #include <mrpt/obs/CObservationRange.h>
00021 
00022 using namespace mrpt::obs;
00023 
00024 
00027 
00028 namespace mrpt_bridge
00029 {
00030     namespace range
00031     {
00036         bool ros2mrpt(const sensor_msgs::Range &msg,
00037                       CObservationRange &obj);
00038 
00045         bool mrpt2ros(const CObservationRange &obj,
00046                       const std_msgs::Header &msg_header,
00047                       sensor_msgs::Range *msg);
00048     }
00049 }
00050 
00051 #endif //MRPT_BRIDGE_RANGE_H


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