Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018 #ifndef PUBLISHER_LOG_HPP
00019 #define PUBLISHER_LOG_HPP
00020
00021
00022
00023
00024 #include "basic.hpp"
00025
00026
00027
00028
00029 #include <ros/ros.h>
00030 #include <rosgraph_msgs/Log.h>
00031 #include <ros/serialization.h>
00032 #include <std_msgs/String.h>
00033
00034
00035
00036
00037 #include <boost/algorithm/string.hpp>
00038 #include <boost/thread/mutex.hpp>
00039
00040
00041
00042
00043 #include <qi/anyobject.hpp>
00044 #include <qicore/logmessage.hpp>
00045 #include <qicore/logmanager.hpp>
00046 #include <qicore/loglistener.hpp>
00047
00048 namespace naoqi
00049 {
00050 namespace publisher
00051 {
00052
00053 class LogPublisher : public BasicPublisher<rosgraph_msgs::Log>
00054 {
00055 public:
00056 LogPublisher(const std::string& topic);
00057
00058
00059
00060
00061 inline bool isSubscribed() const
00062 {
00063
00064 return true;
00065 }
00066
00067 private:
00068 ros::Publisher pub_;
00069
00070 };
00071
00072 }
00073 }
00074
00075 #endif