#include <ros/ros.h>
#include "std_msgs/String.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 <tf/transform_broadcaster.h>
#include <rl_common/core.hh>
#include <rl_common/Random.h>
#include <rl_env/RobotCarVel.hh>
#include <rl_env/fourrooms.hh>
#include <rl_env/tworooms.hh>
#include <rl_env/taxi.hh>
#include <rl_env/FuelRooms.hh>
#include <rl_env/stocks.hh>
#include <rl_env/energyrooms.hh>
#include <rl_env/MountainCar.hh>
#include <rl_env/CartPole.hh>
#include <rl_env/LightWorld.hh>
#include <getopt.h>
#include <stdlib.h>
Go to the source code of this file.
Define Documentation
#define NODE "RLEnvironment" |
Function Documentation
init the environment, publish a description.
Definition at line 103 of file env.cpp.
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
Main function to start the env node.
Definition at line 233 of file env.cpp.
void processAction |
( |
const rl_msgs::RLAction::ConstPtr & |
actionIn | ) |
|
process action from the agent
Definition at line 70 of file env.cpp.
Process end-of-episode reward info. Mostly to start new episode.
Definition at line 88 of file env.cpp.
Variable Documentation