Classes | Typedefs | Functions
move_basic.cpp File Reference
#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <tf2/LinearMath/Transform.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/Vector3.h>
#include <nav_msgs/Path.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Bool.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/server/simple_action_server.h>
#include <dynamic_reconfigure/server.h>
#include "move_basic/collision_checker.h"
#include "move_basic/queued_action_server.h"
#include <move_basic/MovebasicConfig.h>
#include <string>
Include dependency graph for move_basic.cpp:

Go to the source code of this file.

Classes

class  MoveBasic
 

Typedefs

typedef actionlib::QueuedActionServer< move_base_msgs::MoveBaseAction > MoveBaseActionServer
 

Functions

static void getPose (const tf2::Transform &tf, double &x, double &y, double &yaw)
 
int main (int argc, char **argv)
 
static void normalizeAngle (double &angle)
 
static double rad2deg (double rad)
 
static int sign (double n)
 

Typedef Documentation

typedef actionlib::QueuedActionServer<move_base_msgs::MoveBaseAction> MoveBaseActionServer

Definition at line 54 of file move_basic.cpp.

Function Documentation

static void getPose ( const tf2::Transform tf,
double &  x,
double &  y,
double &  yaw 
)
static

Definition at line 166 of file move_basic.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 767 of file move_basic.cpp.

static void normalizeAngle ( double &  angle)
static

Definition at line 153 of file move_basic.cpp.

static double rad2deg ( double  rad)
static

Definition at line 139 of file move_basic.cpp.

static int sign ( double  n)
static

Definition at line 146 of file move_basic.cpp.



move_basic
Author(s): Jim Vaughan
autogenerated on Fri Mar 26 2021 02:46:58