alb_reader.cpp
Go to the documentation of this file.
1 // ROS headers
2 #include "ros/ros.h"
3 
4 // Osef headers
5 #include "osefTypes.h"
6 
7 // Local headers
8 #include "alb_common.h"
9 #include "alb_reader.h"
10 
11 // Constant definition.
12 constexpr const size_t k_buffer_size = 100000000;
13 
14 namespace
15 {
16 // Check for Little/Big endian architecture.
17 // Returns true if BigEndian.
18 bool isBigEndianArchitecture()
19 {
20  const uint32_t i = 0x01020304;
21  return reinterpret_cast<const uint8_t *>(&i)[0] == 1;
22 }
23 }; // namespace
24 
25 AlbReader::AlbReader(ros::NodeHandle &nodeHandle) : alb_publisher(nodeHandle)
26 {
27 }
28 
30 {
31  if (!areInputArgumentsValid()) {
32  return false;
33  }
34 
36 
37  if (connectToLiveStream() == -1) {
38  ROS_ERROR("[AlbReader] Unable to connect to live stream with address %s.", ip_v4.c_str());
39  return false;
40  }
41 
42  // Initialize buffer for reading data.
43  buffer = std::make_unique<uint8_t[]>(k_buffer_size);
44 
45  return true;
46 }
47 
49 {
50  int ret = 0;
52 
53  if (ret == 0) {
55  } else if (ret == 1) {
56  Tlv::tlv_s *frame = (Tlv::tlv_s *)buffer.get();
57 
58  if (!isTlvParsable(frame)) {
59  return -1;
60  }
61 
62  alb_publisher.publish(frame);
63  }
64 
65  return ret;
66 }
67 
68 bool AlbReader::isTlvParsable(const Tlv::tlv_s *frame)
69 {
70  // Check expected root TLV type.
71  if (frame->getType() != OSEF_TYPE_TIMESTAMPED_DATA) {
72  ROS_ERROR("[AlbReader] Error: wrong frame TLV type");
73  return false;
74  }
75 
76  // Value parsing on big endian architecture is not supported by this code.
77  if (isBigEndianArchitecture()) {
78  ROS_ERROR("[AlbReader] Value parsing on big endian architecture is not supported");
79  return false;
80  }
81 
82  return true;
83 }
84 
86 {
87  ros::NodeHandle private_node("~");
88 
89  if (!private_node.hasParam(ALBCommon::k_alb_ip) || !private_node.hasParam(ALBCommon::k_alb_port)) {
90  ROS_ERROR("[AlbReader] IP and port are not defined in parameters.");
91  return false;
92  }
93 
94  return true;
95 }
96 
98 {
99  ros::NodeHandle private_node("~");
100  private_node.getParam(ALBCommon::k_alb_ip, ip_v4);
101  private_node.getParam(ALBCommon::k_alb_port, port);
102 }
103 
105 {
106  if (ip_v4.empty()) {
107  ROS_ERROR("[AlbReader] IP of the ALB not defined.");
108  return -1;
109  }
110 
111  int ret = 0;
113  ret = tcp_reader.connectToALB(ip_v4.c_str(), port);
114 
115  if (ret == 0) {
116  ROS_WARN("[AlbReader] ALB not available yet (processing not started?) actively waiting "
117  "for it...");
118  while ((ret = tcp_reader.connectToALB(ip_v4.c_str(), port)) == 0)
119  ;
120  }
121 
122  if (!alb_initialized) {
123  alb_initialized = true;
124  } else {
125  ROS_WARN("[AlbReader] Processing restarts with the ALB already initialized. "
126  "Make sure that a reinitialization is not needed.");
127  }
128 
129  return ret;
130 }
AlbReader::parse
int parse()
Parse data from the input stream (ROS callback).
Definition: alb_reader.cpp:48
AlbPublisher::publish
void publish(const Tlv::tlv_s *frame)
Publish messages from the ALB frame.
Definition: alb_publisher.cpp:163
ros::NodeHandle::getParam
bool getParam(const std::string &key, bool &b) const
ros.h
ALBCommon::k_alb_ip
constexpr const char * k_alb_ip
Definition: alb_common.h:18
TcpStreamReader::connectToALB
int connectToALB(const char *ipv4=default_ip, const uint16_t port=default_port)
Definition: tcpStream.cpp:121
AlbReader::AlbReader
AlbReader(ros::NodeHandle &nodeHandle)
Definition: alb_reader.cpp:25
AlbReader::init
bool init()
Initialize the parser.
Definition: alb_reader.cpp:29
AlbReader::port
int port
Definition: alb_reader.h:52
AlbReader::isTlvParsable
bool isTlvParsable(const Tlv::tlv_s *frame)
Check if the TLV is parsable.
Definition: alb_reader.cpp:68
alb_common.h
ros::NodeHandle::hasParam
bool hasParam(const std::string &key) const
ROS_WARN
#define ROS_WARN(...)
alb_reader.h
k_buffer_size
constexpr const size_t k_buffer_size
Definition: alb_reader.cpp:12
OSEF_TYPE_TIMESTAMPED_DATA
#define OSEF_TYPE_TIMESTAMPED_DATA
Definition: osefTypes.h:102
AlbReader::buffer
std::unique_ptr< uint8_t[]> buffer
Definition: alb_reader.h:55
TcpStreamReader::getNextFrame
int getNextFrame(uint8_t *buffer, const size_t buffer_size)
Definition: tcpStream.cpp:159
ALBCommon::k_alb_port
constexpr const char * k_alb_port
Definition: alb_common.h:19
AlbReader::alb_initialized
bool alb_initialized
Definition: alb_reader.h:56
ROS_ERROR
#define ROS_ERROR(...)
AlbReader::tcp_reader
TcpStreamReader tcp_reader
Definition: alb_reader.h:50
TcpStreamReader::disconnectfromALB
int disconnectfromALB()
Definition: tcpStream.cpp:175
AlbReader::parseInputArguments
void parseInputArguments()
Parse the ROS input arguments.
Definition: alb_reader.cpp:97
AlbReader::ip_v4
std::string ip_v4
Definition: alb_reader.h:51
osefTypes.h
ros::NodeHandle
AlbReader::areInputArgumentsValid
bool areInputArgumentsValid()
Check if input arguments are valid.
Definition: alb_reader.cpp:85
AlbReader::alb_publisher
AlbPublisher alb_publisher
Definition: alb_reader.h:54
AlbReader::connectToLiveStream
int connectToLiveStream()
Connect the parser to a live stream.
Definition: alb_reader.cpp:104


outsight_alb_driver
Author(s): Outsight
autogenerated on Thu Oct 13 2022 02:21:45