#include <choreo_execution_gatekeeper_service.h>
Public Member Functions | |
void | executionCallback (const choreo_msgs::ProcessExecutionGoalConstPtr &goal) |
ExecutionGatekeeper (ros::NodeHandle &nh) | |
bool | simulateProcess (const choreo_msgs::ProcessExecutionGoalConstPtr &goal) |
Private Attributes | |
ros::NodeHandle | nh_ |
actionlib::SimpleActionServer< choreo_msgs::ProcessExecutionAction > | process_exe_action_server_ |
ros::ServiceClient | sim_client_ |
Definition at line 18 of file choreo_execution_gatekeeper_service.h.
choreo_execution_gatekeeper::ExecutionGatekeeper::ExecutionGatekeeper | ( | ros::NodeHandle & | nh | ) |
Definition at line 17 of file choreo_execution_gatekeeper_service.cpp.
void choreo_execution_gatekeeper::ExecutionGatekeeper::executionCallback | ( | const choreo_msgs::ProcessExecutionGoalConstPtr & | goal | ) |
Definition at line 31 of file choreo_execution_gatekeeper_service.cpp.
bool choreo_execution_gatekeeper::ExecutionGatekeeper::simulateProcess | ( | const choreo_msgs::ProcessExecutionGoalConstPtr & | goal | ) |
Definition at line 43 of file choreo_execution_gatekeeper_service.cpp.
|
private |
Definition at line 30 of file choreo_execution_gatekeeper_service.h.
|
private |
Definition at line 33 of file choreo_execution_gatekeeper_service.h.
|
private |
Definition at line 32 of file choreo_execution_gatekeeper_service.h.