Public Member Functions | Private Types | Private Member Functions | Private Attributes
play_motion::PlayMotionServer Class Reference

#include <play_motion_server.h>

List of all members.

Public Member Functions

 PlayMotionServer (const ros::NodeHandle &nh, const PlayMotionPtr &pm)
virtual ~PlayMotionServer ()

Private Types

typedef
actionlib::ActionServer
< play_motion_msgs::PlayMotionAction > 
AlServer
typedef boost::shared_ptr
< PlayMotion
PlayMotionPtr

Private Member Functions

void alCancelCb (AlServer::GoalHandle gh)
void alGoalCb (AlServer::GoalHandle gh)
bool findGoalId (AlServer::GoalHandle gh, PlayMotion::GoalHandle &goal_id)
bool listMotions (play_motion_msgs::ListMotions::Request &req, play_motion_msgs::ListMotions::Response &resp)
void playMotionCb (const PlayMotion::GoalHandle &goal_hdl)

Private Attributes

std::map
< PlayMotion::GoalHandle,
AlServer::GoalHandle
al_goals_
AlServer al_server_
std::vector< std::string > clist_
ros::ServiceServer list_motions_srv_
ros::NodeHandle nh_
PlayMotionPtr pm_

Detailed Description

Definition at line 54 of file play_motion_server.h.


Member Typedef Documentation

typedef actionlib::ActionServer<play_motion_msgs::PlayMotionAction> play_motion::PlayMotionServer::AlServer [private]

Definition at line 57 of file play_motion_server.h.

typedef boost::shared_ptr<PlayMotion> play_motion::PlayMotionServer::PlayMotionPtr [private]

Definition at line 58 of file play_motion_server.h.


Constructor & Destructor Documentation

Definition at line 49 of file play_motion_server.cpp.

Definition at line 63 of file play_motion_server.cpp.


Member Function Documentation

Definition at line 98 of file play_motion_server.cpp.

Definition at line 110 of file play_motion_server.cpp.

Definition at line 66 of file play_motion_server.cpp.

bool play_motion::PlayMotionServer::listMotions ( play_motion_msgs::ListMotions::Request &  req,
play_motion_msgs::ListMotions::Response &  resp 
) [private]

Definition at line 133 of file play_motion_server.cpp.

Definition at line 76 of file play_motion_server.cpp.


Member Data Documentation

Definition at line 76 of file play_motion_server.h.

Definition at line 75 of file play_motion_server.h.

std::vector<std::string> play_motion::PlayMotionServer::clist_ [private]

Definition at line 73 of file play_motion_server.h.

Definition at line 77 of file play_motion_server.h.

Definition at line 72 of file play_motion_server.h.

Definition at line 74 of file play_motion_server.h.


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


play_motion
Author(s): Paul Mathieu
autogenerated on Wed Aug 26 2015 15:29:25