#include <sys/time.h>
#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <sensor_msgs/LaserScan.h>
#include <sensor_msgs/Imu.h>
#include <geometry_msgs/Pose2D.h>
#include "polar_scan_matcher/polar_match.h"
Go to the source code of this file.
Classes | |
class | PSMNode |
Variables | |
const std::string | imuTopic_ = "imu" |
const std::string | poseTopic_ = "pose2D" |
const double | ROS_TO_PM = 100.0 |
const std::string | scanTopic_ = "scan" |
const std::string imuTopic_ = "imu" |
Definition at line 45 of file psm_node.h.
const std::string poseTopic_ = "pose2D" |
Definition at line 47 of file psm_node.h.
const double ROS_TO_PM = 100.0 |
Definition at line 49 of file psm_node.h.
const std::string scanTopic_ = "scan" |
Definition at line 46 of file psm_node.h.