Template Class Republish

Class Documentation

template<typename MsgType>
class Republish

Public Functions

inline explicit Republish(const ros::NodeHandle &nh)
Republish(const Republish&) = delete
Republish &operator=(const Republish&) = delete
inline void decode(const EventPacket::ConstPtr &msg)
inline void eventMsg(EventPacket::ConstPtr msg)
inline explicit Republish(rclcpp::Node *node)
Republish(const Republish&) = delete
Republish &operator=(const Republish&) = delete
inline void decode(const EventPacket::ConstSharedPtr &msg)
inline void eventMsg(EventPacket::ConstSharedPtr msg)

Public Members

ros::NodeHandle nh_
ros::Subscriber sub_
ros::Publisher eventPub_
ros::Publisher triggerPub_
event_camera_codecs::DecoderFactory<EventPacket, MessageMaker<MsgType>> decoderFactory_
MessageMaker<MsgType> messageMaker_
rclcpp::Node *nh_
rclcpp::Subscription<EventPacket>::SharedPtr sub_
rclcpp::Publisher<MsgType>::SharedPtr eventPub_
rclcpp::Publisher<MsgType>::SharedPtr triggerPub_