34 #ifndef RC_VISARD_ROS_PROTOBUF2ROS_PUBLISHER_H 35 #define RC_VISARD_ROS_PROTOBUF2ROS_PUBLISHER_H 38 #include <google/protobuf/message.h> 52 const std::string& frame_id_prefix);
64 virtual void publish(std::shared_ptr<::google::protobuf::Message> pbMsg);
75 #endif // RC_VISARD_ROS_PROTOBUF2ROS_PUBLISHER_H Protobuf2RosPublisher & operator=(const Protobuf2RosPublisher &)
Generic implementation for publishing protobuf messages to ros.
virtual void publish(std::shared_ptr<::google::protobuf::Message > pbMsg)
Publish the generic protobuf message as a corresponding Ros Message.
Protobuf2RosPublisher(ros::NodeHandle &nh, const std::string &topic, const std::string &pbMsgType, const std::string &frame_id_prefix)
Internally creates a corresponding ros publisher.
const std::string _tfPrefix
virtual bool used()
Returns true if there are subscribers to the topic.