Go to the documentation of this file.
18 bool isBigEndianArchitecture()
20 const uint32_t i = 0x01020304;
21 return reinterpret_cast<const uint8_t *
>(&i)[0] == 1;
38 ROS_ERROR(
"[AlbReader] Unable to connect to live stream with address %s.",
ip_v4.c_str());
55 }
else if (ret == 1) {
56 Tlv::tlv_s *frame = (Tlv::tlv_s *)
buffer.get();
72 ROS_ERROR(
"[AlbReader] Error: wrong frame TLV type");
77 if (isBigEndianArchitecture()) {
78 ROS_ERROR(
"[AlbReader] Value parsing on big endian architecture is not supported");
90 ROS_ERROR(
"[AlbReader] IP and port are not defined in parameters.");
107 ROS_ERROR(
"[AlbReader] IP of the ALB not defined.");
116 ROS_WARN(
"[AlbReader] ALB not available yet (processing not started?) actively waiting "
125 ROS_WARN(
"[AlbReader] Processing restarts with the ALB already initialized. "
126 "Make sure that a reinitialization is not needed.");
int parse()
Parse data from the input stream (ROS callback).
void publish(const Tlv::tlv_s *frame)
Publish messages from the ALB frame.
bool getParam(const std::string &key, bool &b) const
constexpr const char * k_alb_ip
int connectToALB(const char *ipv4=default_ip, const uint16_t port=default_port)
AlbReader(ros::NodeHandle &nodeHandle)
bool init()
Initialize the parser.
bool isTlvParsable(const Tlv::tlv_s *frame)
Check if the TLV is parsable.
bool hasParam(const std::string &key) const
constexpr const size_t k_buffer_size
#define OSEF_TYPE_TIMESTAMPED_DATA
std::unique_ptr< uint8_t[]> buffer
int getNextFrame(uint8_t *buffer, const size_t buffer_size)
constexpr const char * k_alb_port
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.