Defines | Functions | Variables
env.cpp File Reference
#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>
Include dependency graph for env.cpp:

Go to the source code of this file.

Defines

#define NODE   "RLEnvironment"

Functions

void displayHelp ()
void initEnvironment ()
int main (int argc, char *argv[])
void processAction (const rl_msgs::RLAction::ConstPtr &actionIn)
void processEpisodeInfo (const rl_msgs::RLExperimentInfo::ConstPtr &infoIn)

Variables

int delay = 0
Environmente
char * envType
bool highvar = false
bool lag = false
int nsectors = 3
int nstocks = 3
static ros::Publisher out_env_desc
static ros::Publisher out_env_sr
static ros::Publisher out_seed
bool PRINTS = false
Random rng
int seed = 1
bool stochastic = true

Define Documentation

#define NODE   "RLEnvironment"

Definition at line 30 of file env.cpp.


Function Documentation

void displayHelp ( )

Definition at line 50 of file env.cpp.

void initEnvironment ( )

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.

void processEpisodeInfo ( const rl_msgs::RLExperimentInfo::ConstPtr &  infoIn)

Process end-of-episode reward info. Mostly to start new episode.

Definition at line 88 of file env.cpp.


Variable Documentation

int delay = 0

Definition at line 46 of file env.cpp.

Definition at line 36 of file env.cpp.

char* envType

Definition at line 40 of file env.cpp.

bool highvar = false

Definition at line 48 of file env.cpp.

bool lag = false

Definition at line 47 of file env.cpp.

int nsectors = 3

Definition at line 45 of file env.cpp.

int nstocks = 3

Definition at line 44 of file env.cpp.

Definition at line 32 of file env.cpp.

Definition at line 33 of file env.cpp.

Definition at line 34 of file env.cpp.

bool PRINTS = false

Definition at line 38 of file env.cpp.

Definition at line 37 of file env.cpp.

int seed = 1

Definition at line 39 of file env.cpp.

bool stochastic = true

Definition at line 43 of file env.cpp.



rl_env
Author(s):
autogenerated on Thu Jun 6 2019 22:00:24