A mock agent class to test the cba package. More...
#include <iostream>#include <lfd_common/demonstration.h>#include <lfd_common/action_complete.h>#include <std_msgs/Int32.h>#include <ros/ros.h>#include <time.h>
Go to the source code of this file.
Functions | |
| bool | demonstration_callback (lfd_common::demonstration::Request &req, lfd_common::demonstration::Response &resp) |
| void | execute_callback (const std_msgs::Int32::ConstPtr &msg) |
| int | main (int argc, char **argv) |
Variables | |
| ros::ServiceClient | a_complete |
| bool | dem |
A mock agent class to test the cba package.
mock_agent is a test agent class for the cba package.
Definition in file mock_agent.cpp.
| bool demonstration_callback | ( | lfd_common::demonstration::Request & | req, |
| lfd_common::demonstration::Response & | resp | ||
| ) |
Responds to the request for a demonstration based on the mock classifier.
| req | the request for the demonstration |
| resp | the response to the demonstration |
Definition at line 64 of file mock_agent.cpp.
| void execute_callback | ( | const std_msgs::Int32::ConstPtr & | msg | ) |
Execute the commands in the given message by sleeping.
| msg | the command to execute |
Definition at line 28 of file mock_agent.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Creates and runs the mock_agent node.
| argc | argument count that is passed to ros::init |
| argv | arguments that are passed to ros::init |
Definition at line 98 of file mock_agent.cpp.
the a_complete service
Definition at line 21 of file mock_agent.cpp.
| bool dem |
if a demonstration should be given
Definition at line 20 of file mock_agent.cpp.