#include "ros/ros.h"
#include "ifm_o3mxxx/udpreceiver.h"
#include "ifm/example_results.h"
#include "ifm/example_types.h"
#include "ifm_o3mxxx/IFMO3mxxx.h"
#include "DI_CH08_1_0.h"
#include "DI_CH08_1_1.h"
#include "DI_CH08_1_2.h"
#include "DI_CH08_1_3.h"
#include "sensor_msgs/Image.h"
#include "sensor_msgs/image_encodings.h"
#include "sensor_msgs/PointCloud2.h"
#include <pcl_conversions/pcl_conversions.h>
Go to the source code of this file.
Classes | |
struct | ChannelEnd |
struct | ChannelHeader |
struct | PacketHeader |
Macros | |
#define | NUM_SENSOR_PIXELS (1024) |
#define | UDP_PACKET_BUF_LEN (2000) |
Functions | |
struct PacketHeader | __attribute__ ((packed)) |
int | copyChannel8_DIA1_1_0 (ifm_o3m_AlgoIFOutput_DIA1_1_0 *p) |
int | copyChannel8_DIA1_1_1 (ifm_o3m_AlgoIFOutput_DIA1_1_1 *p) |
int | copyChannel8_DIA1_1_2 (ifm_o3m_AlgoIFOutput_DIA1_1_2 *p) |
int | copyChannel8_DIA1_1_3 (ifm_o3m_AlgoIFOutput_DIA1_1_3 *p) |
int | main (int argc, char **argv) |
int | processChannel8 (void *buf, uint32_t size) |
int | processPacket (int8_t *currentPacketData, int currentPacketSize, int8_t *channelBuffer, uint32_t channelBufferSize, uint32_t *pos) |
Variables | |
uint32_t | ChannelID |
const uint16_t | confidence1 = 1 |
const uint16_t | confidence1024 = 1024 |
const uint16_t | confidence128 = 128 |
const uint16_t | confidence16 = 16 |
const uint16_t | confidence2 = 2 |
const uint16_t | confidence2048 = 2048 |
const uint16_t | confidence256 = 256 |
const uint16_t | confidence32 = 32 |
const uint16_t | confidence4 = 4 |
const uint16_t | confidence4096 = 4096 |
const uint16_t | confidence512 = 512 |
const uint16_t | confidence64 = 64 |
const uint16_t | confidence8 = 8 |
uint32_t | CycleCounter |
uint16_t | Device |
uint32_t | EndDelimiter |
ifm_o3mxxx::IFMO3mxxx | ifm_ros_msg |
uint16_t | IndexOfPacketInChannel |
uint16_t | IndexOfPacketInCycle |
uint32_t | LengthPayload |
uint16_t | NumberOfPacketsInChannel |
uint16_t | NumberOfPacketsInCycle |
uint32_t | PacketCounter |
uint8_t | reserved [24] |
uint32_t | StartDelimiter |
uint32_t | TotalLengthOfChannel |
uint16_t | Version |
#define NUM_SENSOR_PIXELS (1024) |
Definition at line 30 of file ifm_o3mxxx_node.cpp.
#define UDP_PACKET_BUF_LEN (2000) |
Definition at line 50 of file ifm_o3mxxx_node.cpp.
struct PacketHeader __attribute__ | ( | (packed) | ) |
int copyChannel8_DIA1_1_0 | ( | ifm_o3m_AlgoIFOutput_DIA1_1_0 * | p | ) |
Definition at line 148 of file ifm_o3mxxx_node.cpp.
int copyChannel8_DIA1_1_1 | ( | ifm_o3m_AlgoIFOutput_DIA1_1_1 * | p | ) |
Definition at line 180 of file ifm_o3mxxx_node.cpp.
int copyChannel8_DIA1_1_2 | ( | ifm_o3m_AlgoIFOutput_DIA1_1_2 * | p | ) |
Definition at line 210 of file ifm_o3mxxx_node.cpp.
int copyChannel8_DIA1_1_3 | ( | ifm_o3m_AlgoIFOutput_DIA1_1_3 * | p | ) |
Definition at line 240 of file ifm_o3mxxx_node.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 326 of file ifm_o3mxxx_node.cpp.
int processChannel8 | ( | void * | buf, |
uint32_t | size | ||
) |
Definition at line 272 of file ifm_o3mxxx_node.cpp.
int processPacket | ( | int8_t * | currentPacketData, |
int | currentPacketSize, | ||
int8_t * | channelBuffer, | ||
uint32_t | channelBufferSize, | ||
uint32_t * | pos | ||
) |
Definition at line 99 of file ifm_o3mxxx_node.cpp.
uint32_t ChannelID |
Definition at line 73 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence1 = 1 |
Definition at line 52 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence1024 = 1024 |
Definition at line 62 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence128 = 128 |
Definition at line 59 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence16 = 16 |
Definition at line 56 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence2 = 2 |
Definition at line 53 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence2048 = 2048 |
Definition at line 63 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence256 = 256 |
Definition at line 60 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence32 = 32 |
Definition at line 57 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence4 = 4 |
Definition at line 54 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence4096 = 4096 |
Definition at line 64 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence512 = 512 |
Definition at line 61 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence64 = 64 |
Definition at line 58 of file ifm_o3mxxx_node.cpp.
const uint16_t confidence8 = 8 |
Definition at line 55 of file ifm_o3mxxx_node.cpp.
uint32_t CycleCounter |
Definition at line 68 of file ifm_o3mxxx_node.cpp.
uint16_t Device |
Definition at line 66 of file ifm_o3mxxx_node.cpp.
uint32_t EndDelimiter |
Definition at line 65 of file ifm_o3mxxx_node.cpp.
ifm_o3mxxx::IFMO3mxxx ifm_ros_msg |
Definition at line 46 of file ifm_o3mxxx_node.cpp.
uint16_t IndexOfPacketInChannel |
Definition at line 72 of file ifm_o3mxxx_node.cpp.
uint16_t IndexOfPacketInCycle |
Definition at line 70 of file ifm_o3mxxx_node.cpp.
uint32_t LengthPayload |
Definition at line 75 of file ifm_o3mxxx_node.cpp.
uint16_t NumberOfPacketsInChannel |
Definition at line 71 of file ifm_o3mxxx_node.cpp.
uint16_t NumberOfPacketsInCycle |
Definition at line 69 of file ifm_o3mxxx_node.cpp.
uint32_t PacketCounter |
Definition at line 67 of file ifm_o3mxxx_node.cpp.
uint8_t reserved[24] |
Definition at line 66 of file ifm_o3mxxx_node.cpp.
uint32_t StartDelimiter |
Definition at line 65 of file ifm_o3mxxx_node.cpp.
uint32_t TotalLengthOfChannel |
Definition at line 74 of file ifm_o3mxxx_node.cpp.
uint16_t Version |
Definition at line 65 of file ifm_o3mxxx_node.cpp.