
Go to the source code of this file.
Defines | |
| #define | DEFAULT_CFM 0 |
| #define | DEFAULT_CONTACT_MAX_CORRECTING_VEL 100 |
| #define | DEFAULT_CONTACT_SURFACE_LAYER 0.001 |
| #define | DEFAULT_ERP 0.2 |
| #define | DEFAULT_ITERS 500 |
| #define | DEFAULT_MAX_CONTACTS 20 |
| #define | DEFAULT_MAX_STEP_SIZE 0.001 |
| #define | DEFAULT_MAX_UPDATE_RATE 1000 |
| #define | DEFAULT_PRECON_ITERS 0 |
| #define | DEFAULT_RMS_ERROR_TOL 0 |
| #define | DEFAULT_W 1.3 |
Functions | |
| int | main (int argc, char **argv) |
| bool | SetPhysicsProperties (ros::NodeHandle &nh, const std::string &gazeboPhysicsServiceTopic="/gazebo/set_physics_properties") |
| #define DEFAULT_CFM 0 |
Definition at line 38 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_CONTACT_MAX_CORRECTING_VEL 100 |
Definition at line 37 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_CONTACT_SURFACE_LAYER 0.001 |
Definition at line 36 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_ERP 0.2 |
Definition at line 39 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_ITERS 500 |
Definition at line 33 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_MAX_CONTACTS 20 |
Definition at line 40 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_MAX_STEP_SIZE 0.001 |
Definition at line 30 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_MAX_UPDATE_RATE 1000 |
Definition at line 31 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_PRECON_ITERS 0 |
Definition at line 32 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_RMS_ERROR_TOL 0 |
Definition at line 35 of file SetGazeboPhysicsClient.cpp.
| #define DEFAULT_W 1.3 |
Definition at line 34 of file SetGazeboPhysicsClient.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 136 of file SetGazeboPhysicsClient.cpp.
| bool SetPhysicsProperties | ( | ros::NodeHandle & | nh, |
| const std::string & | gazeboPhysicsServiceTopic = "/gazebo/set_physics_properties" |
||
| ) |
Definition at line 42 of file SetGazeboPhysicsClient.cpp.