This is the complete list of members for gazebo::ServerFixture, including all inherited members.
CheckPointer(boost::shared_ptr< T > _ptr) | gazebo::ServerFixture | inlineprotectedstatic |
DoubleCompare(double *_scanA, double *_scanB, unsigned int _sampleCount, double &_diffMax, double &_diffSum, double &_diffAvg) | gazebo::ServerFixture | protected |
factoryPub | gazebo::ServerFixture | protected |
FloatCompare(float *_scanA, float *_scanB, unsigned int _sampleCount, float &_diffMax, float &_diffSum, float &_diffAvg) | gazebo::ServerFixture | protected |
GetEntityPose(const std::string &_name) | gazebo::ServerFixture | protected |
GetFrame(const std::string &_cameraName, unsigned char **_imgData, unsigned int &_width, unsigned int &_height) | gazebo::ServerFixture | protected |
GetMemInfo(double &_resident, double &_share) | gazebo::ServerFixture | protected |
GetModel(const std::string &_name) | gazebo::ServerFixture | protected |
GetPercentRealTime() const | gazebo::ServerFixture | protected |
GetScene(const std::string &_sceneName="default") | gazebo::ServerFixture | protected |
GetUniqueString(const std::string &_prefix) | gazebo::ServerFixture | protected |
HasEntity(const std::string &_name) | gazebo::ServerFixture | protected |
ImageCompare(unsigned char *_imageA, unsigned char *_imageB, unsigned int _width, unsigned int _height, unsigned int _depth, unsigned int &_diffMax, unsigned int &_diffSum, double &_diffAvg) | gazebo::ServerFixture | protected |
Load(const std::string &_worldFilename) | gazebo::ServerFixture | protectedvirtual |
Load(const std::string &_worldFilename, bool _paused) | gazebo::ServerFixture | protectedvirtual |
Load(const std::string &_worldFilename, bool _paused, const std::string &_physics, const std::vector< std::string > &_systemPlugins={}) | gazebo::ServerFixture | protectedvirtual |
LoadPlugin(const std::string &_filename, const std::string &_name) | gazebo::ServerFixture | protected |
node | gazebo::ServerFixture | protected |
OnPose(ConstPosesStampedPtr &_msg) | gazebo::ServerFixture | protected |
OnStats(ConstWorldStatisticsPtr &_msg) | gazebo::ServerFixture | protected |
pauseTime | gazebo::ServerFixture | protected |
poses | gazebo::ServerFixture | protected |
poseSub | gazebo::ServerFixture | protected |
PrintImage(const std::string &_name, unsigned char **_image, unsigned int _width, unsigned int _height, unsigned int _depth) | gazebo::ServerFixture | protected |
PrintScan(const std::string &_name, double *_scan, unsigned int _sampleCount) | gazebo::ServerFixture | protected |
realTime | gazebo::ServerFixture | protected |
receiveMutex | gazebo::ServerFixture | protected |
Record(const std::string &_name, const double _data) | gazebo::ServerFixture | protected |
Record(const std::string &_prefix, const math::SignalStats &_stats) | gazebo::ServerFixture | protected |
Record(const std::string &_prefix, const math::Vector3Stats &_stats) | gazebo::ServerFixture | protected |
RemoveModel(const std::string &_name) | gazebo::ServerFixture | protected |
RemovePlugin(const std::string &_name) | gazebo::ServerFixture | protected |
requestPub | gazebo::ServerFixture | protected |
RunServer(const std::string &_worldFilename) | gazebo::ServerFixture | protected |
RunServer(const std::string &_worldFilename, bool _paused, const std::string &_physics, const std::vector< std::string > &_systemPlugins={}) | gazebo::ServerFixture | protected |
server | gazebo::ServerFixture | protected |
ServerFixture() | gazebo::ServerFixture | protected |
serverThread | gazebo::ServerFixture | protected |
SetPause(bool _pause) | gazebo::ServerFixture | protected |
simTime | gazebo::ServerFixture | protected |
SpawnBox(const std::string &_name, const math::Vector3 &_size, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnCamera(const std::string &_modelName, const std::string &_cameraName, const math::Vector3 &_pos, const math::Vector3 &_rpy, unsigned int _width=320, unsigned int _height=240, double _rate=25, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0, bool _distortion=false, double _distortionK1=0.0, double _distortionK2=0.0, double _distortionK3=0.0, double _distortionP1=0.0, double _distortionP2=0.0, double _cx=0.5, double _cy=0.5) | gazebo::ServerFixture | protected |
SpawnCylinder(const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnEmptyLink(const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnGpuRaySensor(const std::string &_modelName, const std::string &_raySensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _hMinAngle=-2.0, double _hMaxAngle=2.0, double _minRange=0.08, double _maxRange=10, double _rangeResolution=0.01, unsigned int _samples=640, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0) | gazebo::ServerFixture | protected |
SpawnImuSensor(const std::string &_modelName, const std::string &_imuSensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, const std::string &_noiseType="", double _rateNoiseMean=0.0, double _rateNoiseStdDev=0.0, double _rateBiasMean=0.0, double _rateBiasStdDev=0.0, double _accelNoiseMean=0.0, double _accelNoiseStdDev=0.0, double _accelBiasMean=0.0, double _accelBiasStdDev=0.0) | gazebo::ServerFixture | protected |
SpawnLight(const std::string &_name, const std::string &_type, const math::Vector3 &_pos, const math::Vector3 &_rpy, const common::Color &_diffuse=common::Color::White, const common::Color &_specular=common::Color::White, const math::Vector3 &_direction=-math::Vector3::UnitZ, double _attenuationRange=20, double _attenuationConstant=0.5, double _attenuationLinear=0.01, double _attenuationQuadratic=0.001, double _spotInnerAngle=0, double _spotOuterAngle=0, double _spotFallOff=0, bool _castShadows=true) | gazebo::ServerFixture | protected |
SpawnModel(const msgs::Model &_msg) | gazebo::ServerFixture | protected |
SpawnModel(const std::string &_filename) | gazebo::ServerFixture | protected |
SpawnRaySensor(const std::string &_modelName, const std::string &_raySensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _hMinAngle=-2.0, double _hMaxAngle=2.0, double _vMinAngle=-1.0, double _vMaxAngle=1.0, double _minRange=0.08, double _maxRange=10, double _rangeResolution=0.01, unsigned int _samples=640, unsigned int _vSamples=1, double _hResolution=1.0, double _vResolution=1.0, const std::string &_noiseType="", double _noiseMean=0.0, double _noiseStdDev=0.0) | gazebo::ServerFixture | protected |
SpawnSDF(const std::string &_sdf) | gazebo::ServerFixture | protected |
SpawnSphere(const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _wait=true, bool _static=false) | gazebo::ServerFixture | protected |
SpawnSphere(const std::string &_name, const math::Vector3 &_pos, const math::Vector3 &_rpy, const math::Vector3 &_cog, double _radius, bool _wait=true, bool _static=false) | gazebo::ServerFixture | protected |
SpawnTrimesh(const std::string &_name, const std::string &_modelPath, const math::Vector3 &_scale, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnUnitAltimeterSensor(const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const std::string &_topic, const ignition::math::Vector3d &_pos, const ignition::math::Vector3d &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnUnitContactSensor(const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnUnitImuSensor(const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const std::string &_topic, const math::Vector3 &_pos, const math::Vector3 &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnUnitMagnetometerSensor(const std::string &_name, const std::string &_sensorName, const std::string &_collisionType, const std::string &_topic, const ignition::math::Vector3d &_pos, const ignition::math::Vector3d &_rpy, bool _static=false) | gazebo::ServerFixture | protected |
SpawnWirelessReceiverSensor(const std::string &_name, const std::string &_sensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, double _minFreq, double _maxFreq, double _power, double _gain, double _sensitivity, bool _visualize=true) | gazebo::ServerFixture | protected |
SpawnWirelessTransmitterSensor(const std::string &_name, const std::string &_sensorName, const math::Vector3 &_pos, const math::Vector3 &_rpy, const std::string &_essid, double _freq, double _power, double _gain, bool _visualize=true) | gazebo::ServerFixture | protected |
statsSub | gazebo::ServerFixture | protected |
TearDown() | gazebo::ServerFixture | protectedvirtual |
Unload() | gazebo::ServerFixture | protectedvirtual |
WaitUntilEntitySpawn(const std::string &_name, unsigned int _sleepEach, int _retries) | gazebo::ServerFixture | protected |
WaitUntilSensorSpawn(const std::string &_name, unsigned int _sleepEach, int _retries) | gazebo::ServerFixture | protected |
~ServerFixture() | gazebo::ServerFixture | protectedvirtual |