$search

simple_pick_and_place_test.cpp File Reference

#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <actionlib/client/simple_action_client.h>
#include <tabletop_object_detector/TabletopDetection.h>
#include <tabletop_collision_map_processing/TabletopCollisionMapProcessing.h>
#include <object_manipulation_msgs/PickupAction.h>
#include <object_manipulation_msgs/PlaceAction.h>
#include <arm_navigation_msgs/MoveArmAction.h>
#include <std_srvs/Empty.h>
Include dependency graph for simple_pick_and_place_test.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
bool move_to_joint_goal (std::vector< arm_navigation_msgs::JointConstraint > joint_constraints, actionlib::SimpleActionClient< arm_navigation_msgs::MoveArmAction > &move_arm)
bool nearest_object (std::vector< object_manipulation_msgs::GraspableObject > &objects, geometry_msgs::PointStamped &reference_point, int &object_ind)

Variables

static const size_t NUM_JOINTS = 5
static const double TABLE_HEIGHT = 0.28
tf::TransformListenertf_listener

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 108 of file simple_pick_and_place_test.cpp.

bool move_to_joint_goal ( std::vector< arm_navigation_msgs::JointConstraint joint_constraints,
actionlib::SimpleActionClient< arm_navigation_msgs::MoveArmAction > &  move_arm 
)

Definition at line 19 of file simple_pick_and_place_test.cpp.

bool nearest_object ( std::vector< object_manipulation_msgs::GraspableObject > &  objects,
geometry_msgs::PointStamped reference_point,
int &  object_ind 
)

return nearest object to point

Definition at line 60 of file simple_pick_and_place_test.cpp.


Variable Documentation

const size_t NUM_JOINTS = 5 [static]

Definition at line 17 of file simple_pick_and_place_test.cpp.

const double TABLE_HEIGHT = 0.28 [static]

Definition at line 12 of file simple_pick_and_place_test.cpp.

Definition at line 14 of file simple_pick_and_place_test.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


katana_manipulation_tutorials
Author(s): Martin Günther
autogenerated on Wed Jan 9 12:28:17 2013