A compound publisher for the driver's topics. More...
#include <compound_publisher.h>
Public Member Functions | |
CompoundPublisher () | |
void | publish (const std_msgs::Header &header, visionary::SafeVisionaryData &frame_data) |
Publish once with all registered publishers. More... | |
virtual | ~CompoundPublisher () |
Private Member Functions | |
void | publishCameraInfo (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the camera information of the sensor. More... | |
void | publishDepthImage (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the raw depth image. More... | |
void | publishDeviceStatus (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the device status. More... | |
void | publishFieldInformation (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the evaluation of the configured safety fields. More... | |
void | publishIMUData (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the values of the IMU. More... | |
void | publishIntensityImage (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the raw intensity image. More... | |
void | publishIOs (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the state of the IO ports. More... | |
void | publishPointCloud (const std_msgs::Header &header, visionary::SafeVisionaryData &frame_data) |
Publishes the generated 3D Pointcloud. More... | |
void | publishROI (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the regions of interest. More... | |
void | publishStateMap (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data) |
Publishes the raw state map of each pixel. More... | |
sensor_msgs::ImagePtr | Vec16ToImage (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data, std::vector< uint16_t > vec) |
Creates an image from a data vector. More... | |
sensor_msgs::ImagePtr | Vec8ToImage (const std_msgs::Header &header, const visionary::SafeVisionaryData &frame_data, std::vector< uint8_t > vec) |
Creates an image from a data vector. More... | |
A compound publisher for the driver's topics.
This class encapsulates all necessary publishers to keep the driver's thread management nice and clear.
Definition at line 61 of file compound_publisher.h.
CompoundPublisher::CompoundPublisher | ( | ) |
Definition at line 34 of file compound_publisher.cpp.
|
inlinevirtual |
Definition at line 65 of file compound_publisher.h.
void CompoundPublisher::publish | ( | const std_msgs::Header & | header, |
visionary::SafeVisionaryData & | frame_data | ||
) |
Publish once with all registered publishers.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 53 of file compound_publisher.cpp.
|
private |
Publishes the camera information of the sensor.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 98 of file compound_publisher.cpp.
|
private |
Publishes the raw depth image.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 200 of file compound_publisher.cpp.
|
private |
Publishes the device status.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 237 of file compound_publisher.cpp.
|
private |
Publishes the evaluation of the configured safety fields.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 363 of file compound_publisher.cpp.
|
private |
Publishes the values of the IMU.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 182 of file compound_publisher.cpp.
|
private |
Publishes the raw intensity image.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 206 of file compound_publisher.cpp.
|
private |
Publishes the state of the IO ports.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 276 of file compound_publisher.cpp.
|
private |
Publishes the generated 3D Pointcloud.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 122 of file compound_publisher.cpp.
|
private |
Publishes the regions of interest.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 326 of file compound_publisher.cpp.
|
private |
Publishes the raw state map of each pixel.
header | Header for this data |
frame_data | The sensor's data to publish |
Definition at line 212 of file compound_publisher.cpp.
|
private |
Creates an image from a data vector.
header | Header for this data |
frame_data | The sensor's data to publish |
vec | The converted data vector |
Definition at line 219 of file compound_publisher.cpp.
|
private |
Creates an image from a data vector.
header | Header for this data |
frame_data | The sensor's data to publish |
vec | The converted data vector |
Definition at line 227 of file compound_publisher.cpp.
|
private |
Definition at line 178 of file compound_publisher.h.
|
private |
Definition at line 186 of file compound_publisher.h.
|
private |
Definition at line 181 of file compound_publisher.h.
|
private |
Definition at line 184 of file compound_publisher.h.
|
private |
Definition at line 180 of file compound_publisher.h.
|
private |
Definition at line 187 of file compound_publisher.h.
|
private |
Definition at line 182 of file compound_publisher.h.
|
private |
Definition at line 179 of file compound_publisher.h.
|
private |
Definition at line 189 of file compound_publisher.h.
|
private |
Definition at line 183 of file compound_publisher.h.
|
private |
Definition at line 188 of file compound_publisher.h.