#include <RosMsgTrajectory.h>

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 |
Definition at line 18 of file RosMsgTrajectory.h.
| RosMsgTrajectory< P, outType >::RosMsgTrajectory | ( | ) | [inline] |
Definition at line 21 of file RosMsgTrajectory.h.
| virtual RosMsgTrajectory< P, outType >::~RosMsgTrajectory | ( | ) | [inline, virtual] |
Definition at line 22 of file RosMsgTrajectory.h.
| const actionlib_msgs::GoalID& RosMsgTrajectory< P, outType >::getGoalId | ( | ) | [inline] |
Definition at line 30 of file RosMsgTrajectory.h.
| void RosMsgTrajectory< P, outType >::setGoalId | ( | const actionlib_msgs::GoalID & | goalId_in | ) | [inline] |
Definition at line 32 of file RosMsgTrajectory.h.
| void RosMsgTrajectory< P, outType >::setGoalId | ( | const ros::Time & | stamp, |
| const std::string & | id | ||
| ) | [inline] |
Definition at line 33 of file RosMsgTrajectory.h.
| void RosMsgTrajectory< P, outType >::setTrajectory | ( | boost::shared_ptr< Trajectory< P > > | traj_in | ) | [inline] |
Definition at line 24 of file RosMsgTrajectory.h.
actionlib_msgs::GoalID RosMsgTrajectory< P, outType >::goalId [private] |
Definition at line 43 of file RosMsgTrajectory.h.
boost::shared_ptr<Trajectory<P> > RosMsgTrajectory< P, outType >::trajectory [protected] |
Definition at line 40 of file RosMsgTrajectory.h.