Typedefs | Functions | Variables
drive2object.cpp File Reference
#include <std_srvs/SetBool.h>
#include <ros/ros.h>
#include <std_msgs/String.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <geometry_msgs/PointStamped.h>
#include <std_srvs/Trigger.h>
#include <tf/transform_listener.h>
#include <actionlib/client/simple_action_client.h>
#include <moveit/planning_scene_interface/planning_scene_interface.h>
Include dependency graph for drive2object.cpp:

Go to the source code of this file.

Typedefs

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

Functions

bool base_cmd (move_base_msgs::MoveBaseGoal goal)
bool drive_go_cb (std_srvs::Trigger::Request &req, std_srvs::Trigger::Response &res)
move_base_msgs::MoveBaseGoal get_pre_pick_pose ()
move_base_msgs::MoveBaseGoal get_pre_pick_pose (geometry_msgs::Point point)
int main (int argc, char **argv)

Variables

double base_distance_from_object = 0.55
tf::TransformListenerlistener_ptr
MoveBaseClientmoveBaseClient_ptr
bool moving = false
std::string object_name
moveit::planning_interface::PlanningSceneInterfaceplanning_scene_interface_ptr

Typedef Documentation

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

Definition at line 13 of file drive2object.cpp.


Function Documentation

bool base_cmd ( move_base_msgs::MoveBaseGoal  goal)

Definition at line 140 of file drive2object.cpp.

bool drive_go_cb ( std_srvs::Trigger::Request &  req,
std_srvs::Trigger::Response &  res 
)

Definition at line 81 of file drive2object.cpp.

move_base_msgs::MoveBaseGoal get_pre_pick_pose ( )
move_base_msgs::MoveBaseGoal get_pre_pick_pose ( geometry_msgs::Point  point)

Definition at line 29 of file drive2object.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 155 of file drive2object.cpp.


Variable Documentation

Definition at line 25 of file drive2object.cpp.

Definition at line 16 of file drive2object.cpp.

Definition at line 21 of file drive2object.cpp.

bool moving = false

Definition at line 23 of file drive2object.cpp.

std::string object_name

Definition at line 24 of file drive2object.cpp.

Definition at line 15 of file drive2object.cpp.



robotican_common
Author(s):
autogenerated on Fri Oct 27 2017 03:02:37