Public Member Functions | Protected Attributes | Private Attributes
RosMsgTrajectory< P, outType > Class Template Reference

#include <RosMsgTrajectory.h>

Inheritance diagram for RosMsgTrajectory< P, outType >:
Inheritance graph
[legend]

List of all members.

Public Member Functions

const actionlib_msgs::GoalID & getGoalId ()
 RosMsgTrajectory ()
void setGoalId (const actionlib_msgs::GoalID &goalId_in)
void setGoalId (const ros::Time &stamp, const std::string &id)
void setTrajectory (boost::shared_ptr< Trajectory< P > > traj_in)
virtual ~RosMsgTrajectory ()

Protected Attributes

boost::shared_ptr< Trajectory
< P > > 
trajectory

Private Attributes

actionlib_msgs::GoalID goalId

Detailed Description

template<class P, class outType>
class RosMsgTrajectory< P, outType >

Definition at line 18 of file RosMsgTrajectory.h.


Constructor & Destructor Documentation

template<class P, class outType>
RosMsgTrajectory< P, outType >::RosMsgTrajectory ( ) [inline]

Definition at line 21 of file RosMsgTrajectory.h.

template<class P, class outType>
virtual RosMsgTrajectory< P, outType >::~RosMsgTrajectory ( ) [inline, virtual]

Definition at line 22 of file RosMsgTrajectory.h.


Member Function Documentation

template<class P, class outType>
const actionlib_msgs::GoalID& RosMsgTrajectory< P, outType >::getGoalId ( ) [inline]

Definition at line 30 of file RosMsgTrajectory.h.

template<class P, class outType>
void RosMsgTrajectory< P, outType >::setGoalId ( const actionlib_msgs::GoalID &  goalId_in) [inline]

Definition at line 32 of file RosMsgTrajectory.h.

template<class P, class outType>
void RosMsgTrajectory< P, outType >::setGoalId ( const ros::Time stamp,
const std::string &  id 
) [inline]

Definition at line 33 of file RosMsgTrajectory.h.

template<class P, class outType>
void RosMsgTrajectory< P, outType >::setTrajectory ( boost::shared_ptr< Trajectory< P > >  traj_in) [inline]

Definition at line 24 of file RosMsgTrajectory.h.


Member Data Documentation

template<class P, class outType>
actionlib_msgs::GoalID RosMsgTrajectory< P, outType >::goalId [private]

Definition at line 43 of file RosMsgTrajectory.h.

template<class P, class outType>
boost::shared_ptr<Trajectory<P> > RosMsgTrajectory< P, outType >::trajectory [protected]

Definition at line 40 of file RosMsgTrajectory.h.


The documentation for this class was generated from the following file:


robodyn_controllers
Author(s):
autogenerated on Sat Jun 8 2019 20:20:54