Functions
pr2_base_trajectory_action.cpp File Reference
#include <ros/ros.h>
#include <actionlib/server/action_server.h>
#include <nav_msgs/Odometry.h>
#include <trajectory_msgs/JointTrajectory.h>
#include <pr2_controllers_msgs/JointTrajectoryAction.h>
#include <pr2_controllers_msgs/JointTrajectoryControllerState.h>
#include <pr2_base_trajectory_action/pr2_base_trajectory_action.h>
#include <sstream>
#include "angles/angles.h"
Include dependency graph for pr2_base_trajectory_action.cpp:

Go to the source code of this file.

Functions

static void generatePowers (int n, double x, double *powers)
static void getCubicSplineCoefficients (double start_pos, double start_vel, double end_pos, double end_vel, double time, std::vector< double > &coefficients)
static void getQuinticSplineCoefficients (double start_pos, double start_vel, double start_acc, double end_pos, double end_vel, double end_acc, double time, std::vector< double > &coefficients)
int main (int argc, char **argv)
static void sampleQuinticSpline (const std::vector< double > &coefficients, double time, double &position, double &velocity, double &acceleration)
 Samples a quintic spline segment at a particular time.
static bool setsEqual (const std::vector< std::string > &a, const std::vector< std::string > &b)
template<class Enclosure , class Member >
static boost::shared_ptr< Member > share_member (boost::shared_ptr< Enclosure > enclosure, Member &member)

Function Documentation

static void generatePowers ( int  n,
double  x,
double *  powers 
) [inline, static]

Definition at line 60 of file pr2_base_trajectory_action.cpp.

static void getCubicSplineCoefficients ( double  start_pos,
double  start_vel,
double  end_pos,
double  end_vel,
double  time,
std::vector< double > &  coefficients 
) [static]

Definition at line 129 of file pr2_base_trajectory_action.cpp.

static void getQuinticSplineCoefficients ( double  start_pos,
double  start_vel,
double  start_acc,
double  end_pos,
double  end_vel,
double  end_acc,
double  time,
std::vector< double > &  coefficients 
) [static]

Definition at line 69 of file pr2_base_trajectory_action.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 44 of file pr2_base_trajectory_action.cpp.

static void sampleQuinticSpline ( const std::vector< double > &  coefficients,
double  time,
double &  position,
double &  velocity,
double &  acceleration 
) [static]

Samples a quintic spline segment at a particular time.

Definition at line 103 of file pr2_base_trajectory_action.cpp.

static bool setsEqual ( const std::vector< std::string > &  a,
const std::vector< std::string > &  b 
) [static]

Definition at line 689 of file pr2_base_trajectory_action.cpp.

template<class Enclosure , class Member >
static boost::shared_ptr<Member> share_member ( boost::shared_ptr< Enclosure >  enclosure,
Member &  member 
) [static]

Definition at line 709 of file pr2_base_trajectory_action.cpp.



pr2_base_trajectory_action
Author(s): saito
autogenerated on Wed Sep 16 2015 10:31:51