Functions | Variables
mock_agent.cpp File Reference

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>
Include dependency graph for mock_agent.cpp:

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

Detailed Description

A mock agent class to test the cba package.

mock_agent is a test agent class for the cba package.

Author:
Russell Toris, WPI - rctoris@wpi.edu
Date:
November 22, 2011

Definition in file mock_agent.cpp.


Function Documentation

Responds to the request for a demonstration based on the mock classifier.

Parameters:
reqthe request for the demonstration
respthe response to the demonstration
Returns:
if the demonstration was successful

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.

Parameters:
msgthe 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.

Parameters:
argcargument count that is passed to ros::init
argvarguments that are passed to ros::init
Returns:
EXIT_SUCCESS if the node runs correctly

Definition at line 98 of file mock_agent.cpp.


Variable Documentation

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.



cba
Author(s): Russell Toris
autogenerated on Thu Jan 2 2014 11:23:56