Skip to content
Merged
Show file tree
Hide file tree
Changes from all commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
5 changes: 5 additions & 0 deletions include/mujoco_ros2_simulation/mujoco_system_interface.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -185,6 +185,8 @@ class MujocoSystemInterface : public hardware_interface::SystemInterface
*/
void publish_clock();

rclcpp::Logger get_logger() const;

// System information
std::string model_path_;

Expand All @@ -200,6 +202,9 @@ class MujocoSystemInterface : public hardware_interface::SystemInterface
mjvOption opt_;
mjvPerturb pert_;

// Logger
rclcpp::Logger logger_ = rclcpp::get_logger("MujocoSystemInterface");
Copy link
Collaborator

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Oh I did not realize this got constructed every time! Nice change!

Copy link
Member Author

Choose a reason for hiding this comment

The reason will be displayed to describe this comment to others. Learn more.

Yup!


// Speed scaling parameter. if set to >0 then we ignore the value set in the simulate app and instead
// attempt to loop at whatever this is set to. If this is <0, then we use the value from the app.
double sim_speed_factor_;
Expand Down
Loading
Loading