Go to the documentation of this file. 1 #ifndef _ALB_PUBLISHER_H
2 #define _ALB_PUBLISHER_H
5 #include "geometry_msgs/PoseStamped.h"
6 #include "nav_msgs/Odometry.h"
16 #include "outsight_alb_driver/Zones.h"
24 void publish(
const Tlv::tlv_s *frame);
109 #endif // _ALB_PUBLISHER_H
void publish(const Tlv::tlv_s *frame)
Publish messages from the ALB frame.
void publishOdometry(const Tlv::tlv_s *frame)
Publish odometry message.
geometry_msgs::Pose first_pose
ros::Publisher pose_publisher
void publishZones()
Publish the zones message.
void publishTimeReference(const Tlv::tlv_s *frame)
Publish TimeReference message.
void initPublishers(ros::NodeHandle &nodeHandle)
Initialize the ROS publishers.
ros::Time current_timestamp
void updatePose(const Tlv::tlv_s *frame)
Update current position as the last position.
void publishAugmentedCloud(const Tlv::tlv_s *frame)
Publish the augmented cloud message.
void updateTimeStamp(const Tlv::tlv_s *frame)
Update used time stamp with the ALB time stamp.
tf2::Transform base_to_lidar_tf
void publishPointCloud(const Tlv::tlv_s *frame)
Publish pointCloud message.
geometry_msgs::Pose current_pose
ros::Publisher egomotion_publisher
bool transform_broadcaster
void broadcastMapTransform(const geometry_msgs::Pose &pose)
Broadcast the ALB map to fixed frame transform.
ros::Publisher point_cloud_publisher
void broadcastAlbTransform(const geometry_msgs::Pose &pose)
Broadcast the ALB fixed frame to sensor frame transform.
std::string fixed_frame_id
ros::Publisher odometry_publisher
outsight_alb_driver::Zones zones_msg
ros::Publisher augmented_cloud_publisher
void publishTrackedObjects(const Tlv::tlv_s *frame)
Publish tracked objects message.
void initTransforms()
Initialize the transform frames.
ros::Publisher time_reference_publisher
void publishEgomotion(const Tlv::tlv_s *frame)
Publish egomotion message.
Class to publish ROS messages from the ALB.
AlbPublisher(ros::NodeHandle &nodeHandle)
void publishPose(const Tlv::tlv_s *frame)
Publish pose message.
std::string base_frame_id
std::string sensor_frame_id
void buildZones()
Build ALB zones when the processing starts.
nav_msgs::Odometry odom_msg
ros::Publisher zones_publisher
ros::Publisher tracked_objects_publisher
geometry_msgs::Pose last_pose