#include <geometry_msgs/Twist.h>
#include <nav_msgs/Path.h>
#include <nav_msgs/GetPlan.h>
#include <tf/LinearMath/Matrix3x3.h>
#include <tf/LinearMath/Transform.h>
#include <tf/transform_datatypes.h>
#include "SearchPlanner.h"
#include <fstream>
Go to the source code of this file.
Defines | |
#define | SCENE_ANALYZATION_COST (60) |
Functions | |
void | callbackCurrPos (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &msg) |
Variables | |
geometry_msgs::PoseWithCovarianceStamped | curr_position |
#define SCENE_ANALYZATION_COST (60) |
Definition at line 16 of file SearchPlanner.cpp.
void callbackCurrPos | ( | const geometry_msgs::PoseWithCovarianceStamped::ConstPtr & | msg | ) |
Definition at line 24 of file SearchPlanner.cpp.
geometry_msgs::PoseWithCovarianceStamped curr_position |
Definition at line 18 of file SearchPlanner.cpp.