#include <cstdio>
#include "ros/ros.h"
#include "ros/console.h"
#include "nav_msgs/Path.h"
#include "std_msgs/String.h"
#include <geometry_msgs/Quaternion.h>
#include <geometry_msgs/PoseStamped.h>
#include "tf/transform_listener.h"
#include <hector_nav_msgs/GetRobotTrajectory.h>
#include <hector_nav_msgs/GetRecoveryInfo.h>
#include <tf/tf.h>
#include <algorithm>
Go to the source code of this file.
Classes | |
class | PathContainer |
Map generation node. More... | |
Functions | |
bool | comparePoseStampedStamps (const geometry_msgs::PoseStamped &t1, const geometry_msgs::PoseStamped &t2) |
int | main (int argc, char **argv) |
bool comparePoseStampedStamps | ( | const geometry_msgs::PoseStamped & | t1, |
const geometry_msgs::PoseStamped & | t2 | ||
) |
Definition at line 50 of file hector_trajectory_server.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 255 of file hector_trajectory_server.cpp.