#include "geometry_msgs/PointStamped.h"#include "geometry_msgs/TransformStamped.h"#include "sensor_msgs/TimeReference.h"#include "tf2/convert.h"#include "tf2_geometry_msgs/tf2_geometry_msgs.h"#include "tf2_ros/static_transform_broadcaster.h"#include "tf2_ros/transform_broadcaster.h"#include "tf2_ros/transform_listener.h"#include "osefTypes.h"#include "typeCaster.h"#include "alb_common.h"#include "alb_curl_helper.h"#include "alb_helper.h"#include "alb_publisher.h"#include "outsight_alb_driver/AugmentedCloud.h"#include "outsight_alb_driver/ObjectData.h"#include "outsight_alb_driver/TrackedObjects.h"
Go to the source code of this file.
Variables | |
| constexpr const char * | k_default_fixed_frame_id = "alb_fixed_frame" |
| constexpr const char * | k_default_sensor_frame_id = "alb_sensor_frame" |
| constexpr const uint32_t | k_queue_size = 1000 |
| constexpr const char* k_default_fixed_frame_id = "alb_fixed_frame" |
Definition at line 26 of file alb_publisher.cpp.
| constexpr const char* k_default_sensor_frame_id = "alb_sensor_frame" |
Definition at line 27 of file alb_publisher.cpp.
| constexpr const uint32_t k_queue_size = 1000 |
Definition at line 28 of file alb_publisher.cpp.