This is the complete list of members for World, including all inherited members.
_AddDirty(Entity *_entity) | World | |
_SetSensorsInitialized(const bool _init) | World | |
Clear() | World | |
ClearModels() | World | |
DisableAllModels() | World | |
EnableAllModels() | World | |
EnablePhysicsEngine(bool _enable) | World | |
Fini() | World | |
GetByName(const std::string &_name) | World | |
GetEnablePhysicsEngine() | World | |
GetEntity(const std::string &_name) | World | |
GetEntityBelowPoint(const math::Vector3 &_pt) | World | |
GetIterations() const | World | |
GetModel(unsigned int _index) const | World | |
GetModel(const std::string &_name) | World | |
GetModelBelowPoint(const math::Vector3 &_pt) | World | |
GetModelCount() const | World | |
GetModels() const | World | |
GetName() const | World | |
GetPauseTime() const | World | |
GetPhysicsEngine() const | World | |
GetPresetManager() const | World | |
GetRealTime() const | World | |
GetRunning() const | World | |
GetSceneMsg() const | World | |
GetSetWorldPoseMutex() const | World | |
GetSimTime() const | World | |
GetSphericalCoordinates() const | World | |
GetStartTime() const | World | |
Gravity() const | World | |
Init() | World | |
InsertModelFile(const std::string &_sdfFilename) | World | |
InsertModelSDF(const sdf::SDF &_sdf) | World | |
InsertModelString(const std::string &_sdfString) | World | |
IsLoaded() const | World | |
IsPaused() const | World | |
Light(const std::string &_name) | World | |
LightCount() const | World | |
Lights() const | World | |
Load(sdf::ElementPtr _sdf) | World | |
LoadPlugin(const std::string &_filename, const std::string &_name, sdf::ElementPtr _sdf) | World | |
MagneticField() const | World | virtual |
PrintEntityTree() | World | |
PublishLightPose(const physics::LightPtr _light) | World | |
PublishModelPose(physics::ModelPtr _model) | World | |
PublishModelScale(physics::ModelPtr _model) | World | |
RemoveModel(ModelPtr _model) | World | |
RemoveModel(const std::string &_name) | World | |
RemovePlugin(const std::string &_name) | World | |
Reset() | World | |
ResetEntities(Base::EntityType _type=Base::BASE) | World | |
ResetPhysicsStates() | World | |
ResetTime() | World | |
Run(unsigned int _iterations=0) | World | |
RunBlocking(unsigned int _iterations=0) | World | |
Save(const std::string &_filename) | World | |
SensorsInitialized() const | World | |
SetGravity(const ignition::math::Vector3d &_gravity) | World | |
SetGravitySDF(const ignition::math::Vector3d &_gravity) | World | |
SetMagneticField(const ignition::math::Vector3d &_mag) | World | |
SetPaused(bool _p) | World | |
SetSimTime(const common::Time &_t) | World | |
SetState(const WorldState &_state) | World | |
Step(unsigned int _steps) | World | |
Stop() | World | |
StripWorldName(const std::string &_name) const | World | |
UniqueModelName(const std::string &_name) | World | |
UpdateStateSDF() | World | |
World(const std::string &_name="") | World | explicit |
~World() | World |