/opt/ros/diamondback/stacks/wg_robots_gazebo/pr2_plugs_gazebo_demo/src/ik_test.cpp File Reference

#include <stdio.h>
#include <stdlib.h>
#include <time.h>
#include <ros/ros.h>
#include <kinematics_msgs/GetKinematicTreeInfo.h>
#include <kinematics_msgs/GetPositionIK.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "ros/service_traits.h"
#include "geometry_msgs/PoseStamped.h"
#include "std_msgs/Header.h"
#include "geometry_msgs/Pose.h"
#include "motion_planning_msgs/RobotState.h"
#include "motion_planning_msgs/ArmNavigationErrorCodes.h"
Include dependency graph for ik_test.cpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  TestIKandFK

Defines

#define IK_NEAR   1e-4
#define IK_NEAR_TRANSLATE   1e-5

Functions

double gen_rand (double min, double max)
int main (int argc, char **argv)
bool NOT_NEAR (const double &v1, const double &v2, const double &NEAR)

Variables

static const std::string ARM_FK_NAME = "/pr2_ik_right_arm/get_fk"
static const std::string ARM_IK_NAME = "/pr2_ik_right_arm/get_ik"
static const std::string ARM_QUERY_NAME = "/pr2_ik_right_arm/get_kinematic_tree_info"

Define Documentation

#define IK_NEAR   1e-4

Definition at line 10 of file ik_test.cpp.

#define IK_NEAR_TRANSLATE   1e-5

Definition at line 11 of file ik_test.cpp.


Function Documentation

double gen_rand ( double  min,
double  max 
)

Definition at line 18 of file ik_test.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 223 of file ik_test.cpp.

bool NOT_NEAR ( const double &  v1,
const double &  v2,
const double &  NEAR 
)

Definition at line 25 of file ik_test.cpp.


Variable Documentation

const std::string ARM_FK_NAME = "/pr2_ik_right_arm/get_fk" [static]

Definition at line 13 of file ik_test.cpp.

const std::string ARM_IK_NAME = "/pr2_ik_right_arm/get_ik" [static]

Definition at line 14 of file ik_test.cpp.

const std::string ARM_QUERY_NAME = "/pr2_ik_right_arm/get_kinematic_tree_info" [static]

Definition at line 15 of file ik_test.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Defines


pr2_plugs_gazebo_demo
Author(s): John Hsu
autogenerated on Wed Aug 17 09:09:40 2011