![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |
System Dependencies
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged mujoco_ros_py at Robotics Stack Exchange
![]() |
mujoco_ros_py package from mujoco_ros repomujoco_ros_py |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | A ROS 2 package for launching MuJoCo simulation instances that interface with ROS 2. |
Checkout URI | https://github.com/peterdavidfagan/mujoco_ros.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2024-05-30 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | still-under-development |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- peter
Authors
mujoco_ros
MuJoCo simulation instances that are compatible with the ROS 2 ecosystem. For environment generation see mujoco_robot_environments; for example use cases of this package see ros2_robotics_research_toolkit.
Example Usage
import os
import time
import mujoco
import mujoco.viewer
import mujoco_ros
from mujoco_ros.franka_env import FrankaBase
model_filepath = os.path.join(os.path.dirname(os.path.abspath(__file__)), 'models', 'base.mjb')
if __name__=="__main__":
m = mujoco.MjModel.from_binary_path(model_filepath)
d = mujoco.MjData(m)
env = FrankaBase(
m,
d,
command_interface="effort",
control_steps=5,
control_timer_freq=1e-2,
)
env.reset()
with mujoco.viewer.launch_passive(
model=m,
data=d,
show_left_ui=False,
show_right_ui=False,
) as viewer:
# run interactive viewer application
while viewer.is_running():
time.sleep(0.05)
env.is_syncing = True
viewer.sync()
env.is_syncing = False
ROS 2 Control Joint Trajectory Controller + MoveIt 2
Please note that the controller isn’t perfectly tuned for the simulation but this is provided as an example of the interactivity you can accomplish with this package.
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
std_msgs | |
geometry_msgs | |
sensor_msgs | |
rosgraph_msgs | |
rosidl_default_generators |