32 swarmio::data::event::Notification notification;
33 notification.set_name(message->GetName());
34 notification.mutable_parameters()->insert(message->GetParameters().pairs().begin(), message->GetParameters().pairs().end());
37 if (message->GetNode().empty())
EventForwarder(ros::NodeHandle &nodeHandle, const std::string &source, const std::string &message, swarmio::Endpoint *endpoint)
Construct a new EventForwarder object.
static void Trigger(Endpoint *endpoint, const data::event::Notification &event)
Trigger an event globally.
virtual const Node * NodeForUUID(const std::string &uuid)=0
Retreive a node by its UUID.
ros::Subscriber _subscriber
ROS topic subscriber.
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void EventReceived(const EventMessage::ConstPtr &message)
Called whenever the topic is updated.
swarmio::Endpoint * _endpoint
Telemetry service.
static const MessageSerializer & MessageSerializerForType(const std::string &type, const std::string &parentPackage)
Look up or build a reader for a message type.
std::string _message
Message type.
EventMessage implements an interface with the ROS type system to send and receive events...
std::string getTopic() const
Abstract base class for Endpoint implementations.
static bool IsEventSerializer(const introspection::MessageSerializer &serializer)
Checks whether a serializer has the correct layout.
Exception thrown when the expected type of a message does not match the actual type.