![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |
Launch files
Messages
Services
Plugins
Recent questions tagged manta_v2_moveit_config at Robotics Stack Exchange
![]() |
manta_v2_moveit_config package from manta_v2 repomanta_v2_bringup manta_v2_controller manta_v2_description manta_v2_gazebo_ros2_control manta_v2_moveit_config manta_v2_run_move_group |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache License 2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | ROS2 package suite of manta_v2. |
Checkout URI | https://github.com/tasada038/manta_v2.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-11-14 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | gazebo underwater-robotics ros2 moveit2 ros2-control |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Takumi Asada
Authors
manta_v2_moveit_config
This package contains manta_v2 configuration files (yaml, srdf) to use MoveIt2 package in ROS2 environment.
Install
If you have not installed the following packages, run the following command to install the packages.
sudo apt install ros-$ROS_DISTRO-robot-state-publisher
sudo apt-get install ros-$ROS_DISTRO-ros2-control*
sudo apt-get install ros-$ROS_DISTRO-moveit*
Run MoveIt
Without a robot
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Once launching the demo, you should see the robot in MoveIt2! GUI like this:
On a real robot
First, connect the robot and PC with a tether cable and connect to Jetson Nano on the robot side by SSH.
ssh jetson@192.168.13.26
(* default IP of Jetson Nano is 192.168.13.26)
And, run the control launch file.
ros2 launch manta_v2_controller robot_control.launch.py
In addition, in the second shell on the robot side(Jetson Nano), run the servo node.
ros2 run manta_v2_controller servo_node
Second, run the moveit demo launch file(Laptop PC).
ros2 launch manta_v2_moveit_config moveit_demo.launch.py
Package Dependencies
Deps | Name |
---|---|
ament_cmake | |
ament_lint_auto | |
ament_lint_common | |
moveit | |
robot_state_publisher | |
rviz2 | |
tf2_ros | |
xacro |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
manta_v2_run_move_group |