Classes | Namespaces | Defines | Functions
probabilistic_planner_tools.h File Reference
#include <map>
#include <cmath>
#include <object_manipulation_msgs/Grasp.h>
#include <object_manipulation_msgs/GraspableObject.h>
#include <tf/transform_datatypes.h>
#include <ros/ros.h>
#include "probabilistic_grasp_planner/forward_decls.h"
Include dependency graph for probabilistic_planner_tools.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  probabilistic_grasp_planner::GraspWithMetadata
struct  probabilistic_grasp_planner::ObjectRepresentation
class  probabilistic_grasp_planner::ServiceWrapper< ServiceDataType >
 Wrapper class for service clients to perform initialization on first use. More...

Namespaces

namespace  probabilistic_grasp_planner
 

Forward declarations.


Defines

#define DISALLOW_COPY_AND_ASSIGN(TypeName)

Functions

bool probabilistic_grasp_planner::operator< (const GraspWithMetadata &g1, const GraspWithMetadata &g2)
template<class svcType >
ros::ServiceClient probabilistic_grasp_planner::register_service (ros::NodeHandle &nh, const std::string &service_name)
template<typename KeyType , typename ValueType >
static bool probabilistic_grasp_planner::retrieve_from_map (std::map< KeyType, ValueType > &map, KeyType &key, ValueType &value)

Define Documentation

#define DISALLOW_COPY_AND_ASSIGN (   TypeName)
Value:
TypeName(const TypeName&);               \
  void operator=(const TypeName&)

Definition at line 42 of file probabilistic_planner_tools.h.



probabilistic_grasp_planner
Author(s): Peter Brook
autogenerated on Thu Jan 2 2014 11:41:15