int parse()
Parse data from the input stream (ROS callback).
AlbReader(ros::NodeHandle &nodeHandle)
bool init()
Initialize the parser.
Class to read data from the ALB live stream.
bool isTlvParsable(const Tlv::tlv_s *frame)
Check if the TLV is parsable.
std::unique_ptr< uint8_t[]> buffer
Class to publish ROS messages from the ALB.
TcpStreamReader tcp_reader
void parseInputArguments()
Parse the ROS input arguments.
bool areInputArgumentsValid()
Check if input arguments are valid.
AlbPublisher alb_publisher
int connectToLiveStream()
Connect the parser to a live stream.