#include "sensor_stream.hpp"
#include <sys/socket.h>
#include <netinet/in.h>
#include <netdb.h>
#include <stdio.h>
#include <string.h>
#include <arpa/inet.h>
#include <stdint.h>
#include <unistd.h>
#include <pthread.h>
#include <thread>
#include "sensor_msgs/PointCloud2.h"
#include <sensor_msgs/PointField.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <libL3Cam.h>
#include <beamagine.h>
#include <beamErrors.h>
Go to the source code of this file.
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ PointCloudThread()
◆ g_listening