Typedefs | Functions | Variables
GoToStartPos.cpp File Reference
#include <ros/ros.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/client/simple_action_client.h>
#include <tf/transform_broadcaster.h>
#include <geometry_msgs/Twist.h>
#include "patrolling_sim/GoToStartPosSrv.h"
Include dependency graph for GoToStartPos.cpp:

Go to the source code of this file.

Typedefs

typedef
actionlib::SimpleActionClient
< move_base_msgs::MoveBaseAction > 
MoveBaseClient

Functions

void cmd_velCB (const geometry_msgs::Twist::ConstPtr &msg)
bool GotoStartPosSrvCallback (patrolling_sim::GoToStartPosSrv::Request &Req, patrolling_sim::GoToStartPosSrv::Response &Rep)
int main (int argc, char **argv)

Variables

double last_cmd_vel_time
ros::NodeHandlen_ptr
int teamsize

Typedef Documentation

typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient

Definition at line 9 of file GoToStartPos.cpp.


Function Documentation

void cmd_velCB ( const geometry_msgs::Twist::ConstPtr &  msg)

Definition at line 18 of file GoToStartPos.cpp.

bool GotoStartPosSrvCallback ( patrolling_sim::GoToStartPosSrv::Request &  Req,
patrolling_sim::GoToStartPosSrv::Response &  Rep 
)

Definition at line 24 of file GoToStartPos.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 117 of file GoToStartPos.cpp.


Variable Documentation

Definition at line 15 of file GoToStartPos.cpp.

Definition at line 13 of file GoToStartPos.cpp.

int teamsize

Definition at line 14 of file GoToStartPos.cpp.



patrolling_sim
Author(s):
autogenerated on Thu Jun 6 2019 20:27:09