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 ros::Publisher point_cloud_publisher
void buildZones()
Build ALB zones when the processing starts.
ros::Publisher augmented_cloud_publisher
tf2::Transform base_to_lidar_tf
void broadcastMapTransform(const geometry_msgs::Pose &pose)
Broadcast the ALB map to fixed frame transform.
ros::Time current_timestamp
void publishEgomotion(const Tlv::tlv_s *frame)
Publish egomotion message.
Class to publish ROS messages from the ALB.
void publishPose(const Tlv::tlv_s *frame)
Publish pose message.
bool transform_broadcaster
ros::Publisher pose_publisher
std::string sensor_frame_id
std::string base_frame_id
AlbPublisher(ros::NodeHandle &nodeHandle)
geometry_msgs::Pose current_pose
nav_msgs::Odometry odom_msg
ros::Publisher tracked_objects_publisher
void publishZones()
Publish the zones message.
void broadcastAlbTransform(const geometry_msgs::Pose &pose)
Broadcast the ALB fixed frame to sensor frame transform.
void publishTimeReference(const Tlv::tlv_s *frame)
Publish TimeReference message.
void updateTimeStamp(const Tlv::tlv_s *frame)
Update used time stamp with the ALB time stamp.
void publishOdometry(const Tlv::tlv_s *frame)
Publish odometry message.
void publish(const Tlv::tlv_s *frame)
Publish messages from the ALB frame.
geometry_msgs::Pose last_pose
outsight_alb_driver::Zones zones_msg
ros::Publisher odometry_publisher
void publishPointCloud(const Tlv::tlv_s *frame)
Publish pointCloud message.
ros::Publisher zones_publisher
void updatePose(const Tlv::tlv_s *frame)
Update current position as the last position.
void initTransforms()
Initialize the transform frames.
ros::Publisher time_reference_publisher
std::string fixed_frame_id
geometry_msgs::Pose first_pose
ros::Publisher egomotion_publisher
void initPublishers(ros::NodeHandle &nodeHandle)
Initialize the ROS publishers.
void publishAugmentedCloud(const Tlv::tlv_s *frame)
Publish the augmented cloud message.
void publishTrackedObjects(const Tlv::tlv_s *frame)
Publish tracked objects message.