#include <iostream>
#include <fstream>
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <sensor_msgs/LaserScan.h>
Go to the source code of this file.
◆ DEG_TO_RAD
const double DEG_TO_RAD = 3.14159 / 180.0 |
◆ leftLaserFrame_
const std::string leftLaserFrame_ = "laser_left" |
◆ odomFrame_
const std::string odomFrame_ = "odom" |
◆ RANGE_MAX
const double RANGE_MAX = 50.0 |
◆ RANGE_MIN
const double RANGE_MIN = 0.20 |
◆ rightLaserFrame_
const std::string rightLaserFrame_ = "laser_right" |
◆ worldFrame_
const std::string worldFrame_ = "map" |