Classes | Functions | Variables
objects_database_node_simple.cpp File Reference
#include <vector>
#include <boost/shared_ptr.hpp>
#include <ros/ros.h>
#include <actionlib/server/simple_action_server.h>
#include "moveit/robot_model/robot_model.h"
#include <moveit/robot_model/joint_model_group.h>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <visualization_msgs/MarkerArray.h>
#include <manipulation_msgs/GraspPlanning.h>
#include <manipulation_msgs/GraspPlanningAction.h>
#include "household_objects_database/objects_database.h"
#include <household_objects_database_msgs/TranslateRecognitionId.h>
#include <household_objects_database_msgs/GetModelList.h>
#include <tf/transform_datatypes.h>
Include dependency graph for objects_database_node_simple.cpp:

Go to the source code of this file.

Classes

class  ObjectsDatabaseNode
 Wraps around database connection to provide database-related services through ROS. More...

Functions

bool greaterScaledQuality (const boost::shared_ptr< DatabaseGrasp > &grasp1, const boost::shared_ptr< DatabaseGrasp > &grasp2)
int main (int argc, char **argv)
geometry_msgs::Vector3 negate (const geometry_msgs::Vector3 &vec)

Variables

const std::string GET_MODELS_SERVICE_NAME = "get_model_list"
const std::string GRASP_PLANNING_SERVICE_NAME = "database_grasp_planning"
const std::string VISUALIZE_GRASPS = "visualize_grasps"

Function Documentation

bool greaterScaledQuality ( const boost::shared_ptr< DatabaseGrasp > &  grasp1,
const boost::shared_ptr< DatabaseGrasp > &  grasp2 
)

Definition at line 79 of file objects_database_node_simple.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 536 of file objects_database_node_simple.cpp.

geometry_msgs::Vector3 negate ( const geometry_msgs::Vector3 &  vec)

Definition at line 70 of file objects_database_node_simple.cpp.


Variable Documentation

const std::string GET_MODELS_SERVICE_NAME = "get_model_list"

Definition at line 63 of file objects_database_node_simple.cpp.

const std::string GRASP_PLANNING_SERVICE_NAME = "database_grasp_planning"

Wraps around the most common functionality of the objects database and offers it as ROS services

Definition at line 62 of file objects_database_node_simple.cpp.

const std::string VISUALIZE_GRASPS = "visualize_grasps"

Definition at line 64 of file objects_database_node_simple.cpp.



household_objects_database
Author(s): Matei Ciocarlie, except for source files individually marked otherwise
autogenerated on Thu Aug 27 2015 13:24:24