Go to the documentation of this file.
34 #ifndef MULTISENSE_ROS_LASER_H
35 #define MULTISENSE_ROS_LASER_H
40 #include <sensor_msgs/LaserScan.h>
41 #include <sensor_msgs/JointState.h>
42 #include <sensor_msgs/PointCloud2.h>
47 #include <multisense_lib/MultiSenseChannel.hh>
54 const std::string& tf_prefix);
tf2::Transform getSpindleTransform(float spindle_angle)
tf2::Transform motor_to_camera_
ros::Publisher raw_lidar_data_pub_
sensor_msgs::LaserScan laser_msg_
void scanCallback(const crl::multisense::lidar::Header &header)
void pointCloudCallback(const crl::multisense::lidar::Header &header)
Laser(crl::multisense::Channel *driver, const std::string &tf_prefix)
tf2::Transform laser_to_spindle_
ros::Publisher raw_lidar_cal_pub_
crl::multisense::Channel * driver_
ros::Publisher point_cloud_pub_
ros::Time previous_scan_time_
ros::Publisher joint_states_pub_
void defaultTfPublisher(const ros::TimerEvent &event)
sensor_msgs::JointState joint_states_
crl::multisense::lidar::Calibration lidar_cal_
std::string left_camera_optical_
void publishStaticTransforms(const ros::Time &time)
static const float EXPECTED_RATE
sensor_msgs::PointCloud2 point_cloud_
tf2_ros::StaticTransformBroadcaster static_tf_broadcaster_
void publishSpindleTransform(const float spindle_angle, const float velocity, const ros::Time &time)