#include <ros/ros.h>
#include <rl_msgs/RLStateReward.h>
#include <rl_msgs/RLEnvDescription.h>
#include <rl_msgs/RLAction.h>
#include <rl_msgs/RLExperimentInfo.h>
#include <rl_msgs/RLEnvSeedExperience.h>
#include <ros/callback_queue.h>
#include <rl_common/core.hh>
#include <rl_common/Random.h>
#include <rl_common/ExperienceFile.hh>
#include <rl_agent/DiscretizationAgent.hh>
#include <rl_agent/QLearner.hh>
#include <rl_agent/ModelBasedAgent.hh>
#include <rl_agent/SavedPolicy.hh>
#include <rl_agent/Dyna.hh>
#include <rl_agent/Sarsa.hh>
#include "std_msgs/String.h"
#include <getopt.h>
#include <stdlib.h>
Go to the source code of this file.
Define Documentation
Function Documentation
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
Main method to start up agent node.
Definition at line 237 of file agent.cpp.
Process the env description message from the environment
Definition at line 157 of file agent.cpp.
void processSeed |
( |
const rl_msgs::RLEnvSeedExperience::ConstPtr & |
seedIn | ) |
|
Process seeds for initializing model
Definition at line 136 of file agent.cpp.
void processState |
( |
const rl_msgs::RLStateReward::ConstPtr & |
stateIn | ) |
|
Process the state/reward message from the environment
Definition at line 97 of file agent.cpp.
Variable Documentation
rl_msgs::RLExperimentInfo info |