31 #ifndef POLAR_SCAN_MATCHER_PSM_NODE_H 32 #define POLAR_SCAN_MATCHER_PSM_NODE_H 39 #include <sensor_msgs/LaserScan.h> 40 #include <sensor_msgs/Imu.h> 41 #include <geometry_msgs/Pose2D.h> 94 bool initialize(
const sensor_msgs::LaserScan& scan);
103 void rosToPMScan(
const sensor_msgs::LaserScan& scan,
109 const sensor_msgs::LaserScan& scanMsg);
117 #endif // POLAR_SCAN_MATCHER_PSM_NODE_H ros::Subscriber scanSubscriber_
tf::Transform baseToLaser_
void tfToPose2D(const tf::Transform &t, geometry_msgs::Pose2D &pose)
void rosToPMScan(const sensor_msgs::LaserScan &scan, const tf::Transform &change, PMScan *pmScan)
tf::TransformBroadcaster tfBroadcaster_
tf::Transform prevWorldToBase_
void pose2DToTf(const geometry_msgs::Pose2D &pose, tf::Transform &t)
ros::Publisher posePublisher_
void publishTf(const tf::Transform &transform, const ros::Time &time)
tf::TransformListener tfListener_
tf::Transform laserToBase_
const std::string scanTopic_
void scanCallback(const sensor_msgs::LaserScan &scan)
const std::string poseTopic_
void publishPose(const tf::Transform &transform)
void getCurrentEstimatedPose(tf::Transform &worldToBase, const sensor_msgs::LaserScan &scanMsg)
void imuCallback(const sensor_msgs::Imu &imuMsg)
bool initialize(const sensor_msgs::LaserScan &scan)
ros::Subscriber imuSubscriber_
const std::string imuTopic_