#include <ros/ros.h>
#include <nav_msgs/Path.h>
#include <geometry_msgs/PoseStamped.h>
#include <tf/transform_listener.h>
#include <vector>
#include <string>
#include "init_utils.h"
Go to the source code of this file.
static geometry_msgs::PoseStamped get_current_pose |
( |
| ) |
|
|
static |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
static std::string path_topic_name |
( |
| ) |
|
|
static |
static double publishing_rate |
( |
| ) |
|
|
static |
static int subscriber_queue_size |
( |
| ) |
|
|
static |
static std::string tf_base_link_frame_id |
( |
| ) |
|
|
static |
static double tf_wait_for_transform_duration |
( |
| ) |
|
|
static |