Classes | Functions | Variables
server.cpp File Reference
#include <LinearMath/btTransform.h>
#include <ros/ros.h>
#include <geometry_msgs/PoseStamped.h>
#include "manipulation_transforms/manipulation_transforms_ros.h"
#include <argp.h>
Include dependency graph for server.cpp:

Go to the source code of this file.

Classes

struct  arguments

Functions

int main (int argc, char **argv)
static error_t parse_opt (int key, char *arg, struct argp_state *state)

Variables

static struct argp argp = { options, parse_opt, args_doc, doc, NULL, NULL, NULL }
const char * argp_program_bug_address = "<jscholz@willowgarage.com>"
const char * argp_program_version = "manipulation_transforms_server 0.1"
static char args_doc [] = "[--load=NAMESPACE]"
static char doc [] = "\'SetGraspTransforms\' before issuing queries. "
unsigned int nargs_max = 3
unsigned int nargs_required = 0
static struct argp_option options []

Detailed Description

Uses tf and ManipulationTransforms to provide a service interface to ManipulationTransforms's query methods

Date:
Jun 28, 2010
Author:
jscholz

Definition in file server.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 136 of file server.cpp.

static error_t parse_opt ( int  key,
char *  arg,
struct argp_state *  state 
) [static]

Definition at line 90 of file server.cpp.


Variable Documentation

struct argp argp = { options, parse_opt, args_doc, doc, NULL, NULL, NULL } [static]

Definition at line 131 of file server.cpp.

const char* argp_program_bug_address = "<jscholz@willowgarage.com>"

Definition at line 54 of file server.cpp.

const char* argp_program_version = "manipulation_transforms_server 0.1"

Definition at line 53 of file server.cpp.

char args_doc[] = "[--load=NAMESPACE]" [static]

Definition at line 67 of file server.cpp.

char doc[] = "\'SetGraspTransforms\' before issuing queries. " [static]

Definition at line 57 of file server.cpp.

unsigned int nargs_max = 3

Definition at line 87 of file server.cpp.

unsigned int nargs_required = 0

Definition at line 86 of file server.cpp.

struct argp_option options[] [static]
Initial value:
 {
   {"load",  'l', 0, 0,  "Attempt to load the rigid transforms from parameter server (see doxy for naming convention)", 0},
   {"namespace",  'n', "NAMESPACE", 0,  "Use NAMESPACE as the top-level namespace when loading rigid transforms" , 0},
   {"frame",  'f', "FRAME", 0,  "Set the reference frame in which all initial and query transforms must be defined" , 0},
   {0,0,0,0,0,0}
 }

Definition at line 70 of file server.cpp.



manipulation_transforms
Author(s): Jonathan Scholz
autogenerated on Tue Jan 7 2014 11:10:08