#include <simulation_execution_service.h>
Public Member Functions | |
bool | executionCallback (choreo_msgs::TrajectoryExecution::Request &req, choreo_msgs::TrajectoryExecution::Response &res) |
SimulationExecutionService (ros::NodeHandle &nh) | |
Private Attributes | |
actionlib::SimpleActionClient< control_msgs::FollowJointTrajectoryAction > | ac_ |
std::string | name_ |
ros::ServiceServer | server_ |
Definition at line 20 of file simulation_execution_service.h.
choreo_simulation_execution::SimulationExecutionService::SimulationExecutionService | ( | ros::NodeHandle & | nh | ) |
Definition at line 19 of file simulation_execution_service.cpp.
bool choreo_simulation_execution::SimulationExecutionService::executionCallback | ( | choreo_msgs::TrajectoryExecution::Request & | req, |
choreo_msgs::TrajectoryExecution::Response & | res | ||
) |
Definition at line 34 of file simulation_execution_service.cpp.
|
private |
Definition at line 30 of file simulation_execution_service.h.
|
private |
Definition at line 31 of file simulation_execution_service.h.
|
private |
Definition at line 29 of file simulation_execution_service.h.