Implementation of a ThreadedStream that receives rc_visard's dynamics protobuf messages and re-publishes them as ros messages. More...
#include <protobuf2ros_stream.h>
Public Member Functions | |
Protobuf2RosStream (rc::dynamics::RemoteInterface::Ptr rcdIface, const std::string &stream, ros::NodeHandle &nh, const std::string &frame_id_prefix) | |
Public Member Functions inherited from rc::ThreadedStream | |
void | join () |
const std::string & | name () const |
const std::atomic_bool & | requested () const |
void | start () |
void | stop () |
const std::atomic_bool & | succeeded () const |
Protected Member Functions | |
virtual bool | checkRosPublishersUsed () |
virtual void | initRosPublishers () |
virtual void | publishToRos (std::shared_ptr<::google::protobuf::Message > pbMsg) |
virtual bool | startReceivingAndPublishingAsRos () override |
Protected Member Functions inherited from rc::ThreadedStream | |
ThreadedStream (rc::dynamics::RemoteInterface::Ptr rcdIface, const std::string &stream, ros::NodeHandle &nh) | |
virtual void | work () |
Protected Attributes | |
std::shared_ptr< Protobuf2RosPublisher > | _rosPublisher |
const std::string | _tfPrefix |
Protected Attributes inherited from rc::ThreadedStream | |
Manager::Ptr | _manager |
ros::NodeHandle | _nh |
rc::dynamics::RemoteInterface::Ptr | _rcdyn |
std::atomic_bool | _requested |
std::atomic_bool | _stop |
std::string | _stream |
std::atomic_bool | _success |
std::thread | _thread |
Additional Inherited Members | |
Public Types inherited from rc::ThreadedStream | |
typedef std::shared_ptr< ThreadedStream > | Ptr |
Implementation of a ThreadedStream that receives rc_visard's dynamics protobuf messages and re-publishes them as ros messages.
The ros topic is the dynamics stream name; the ros message type is determined by the protobuf message type of the dynamics stream.
Definition at line 56 of file protobuf2ros_stream.h.
|
inline |
Definition at line 59 of file protobuf2ros_stream.h.
|
protectedvirtual |
Reimplemented in rc::DynamicsStream, and rc::PoseAndTFStream.
Definition at line 199 of file protobuf2ros_stream.cc.
|
protectedvirtual |
Reimplemented in rc::DynamicsStream, and rc::PoseAndTFStream.
Definition at line 193 of file protobuf2ros_stream.cc.
|
protectedvirtual |
Reimplemented in rc::DynamicsStream, and rc::PoseAndTFStream.
Definition at line 204 of file protobuf2ros_stream.cc.
|
overrideprotectedvirtual |
Implements rc::ThreadedStream.
Definition at line 53 of file protobuf2ros_stream.cc.
|
protected |
Definition at line 72 of file protobuf2ros_stream.h.
|
protected |
Definition at line 73 of file protobuf2ros_stream.h.