Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv
Plugins
Recent questions tagged ktmpb at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | GPLv2 |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | Collection of resorces avaiable for mobile manipulator planning |
Checkout URI | https://github.com/sandakalum/mobile-manipulator-planning.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-01-16 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Institute of Industrial and Control Engineering (IOC-UPC)
Authors
ROS client for Flexibly configuring task and motion planning problems
A planning framework for both levels of planning that includes an easy way to configure their interconnection. Motion planning is done using The Kautham Project, which is equipped with the Open Motion Planning Library suite of sampling-based motion planners,and task planning is done using the Fast Forward task planner. Both planning levels are acessible through Robotic Operating System interfaces using services. A client program then uses these task and motion planning services and an XML configuration file that defines the linkage between symbolic actions and geometric values, to compute the sequence of feasible robot motions that allow to successfully execute a manipulation task.
Requirements
- ROS Melodic with Python 3
- The Kautham Project (tamp branch)
- FF Planner
- GraspIt
Installing
ROS Melodic Python 3
Guide to install ROS Melodic can be found here
Installing the basic libraries for Python 3
Run the following commands in a terminal window Installing Python 3 files:
$ sudo apt install -y python3 python3-dev python3-pip build-essential python3-yaml
$ sudo install rosdep rospkg rosinstall_generator rosinstall wstool vcstools catkin_tools catkin_pkg
Initializing it
$ sudo rosdep init
$ rosdep update
Setting up workspace for ROS
Create workspcace
$ sudo mkdir <workspace-name>
$ cd <workspace-name>
$ sudo mkdir src
The Kautham Project
Clone the tamp branch of The Kautham Project in the src
directory of your workspace
$ git clone --single-branch --branch=tamp https://gitioc.upc.edu/kautham/kautham.git
Build Kautham
$ mkdir build
$ cd build
$ cmake ..
$ make
Task and motion planning repository
Clone the meta respository in the src
directory of your workspace
$ git clone https://gitioc.upc.edu/rostutorials/task_and_motion_planning.git
$ cd task_and_motion_planning
$ git checkout python-branch
$ git submodule init
$ git submodule update
$ git submodule status
Tiago arm kinematics
Clone the respository in the src
directory of your workspace
git clone -single-branch --branch=python-branch https://gitioc.upc.edu/robots/kinenik.git
Intalling GraspIt-Ros
Dependencies
$ sudo apt-get install libqt4-dev
$ sudo apt-get install libqt4-opengl-dev
$ sudo apt-get install libqt4-sql-psql
$ sudo apt-get install libcoin80-dev
$ sudo apt-get install libsoqt4-dev
$ sudo apt-get install libblas-dev
$ sudo apt-get install liblapack-dev
$ sudo apt-get install libqhull-dev
$ sudo apt-get install libeigen3-dev
Graspit Installation
``` $ git clone git@github.com:graspit-simulator/graspit.git $ cd graspit
File truncated at 100 lines see the full file
Launch files
- launch/ff_client.launch
-
- ffconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/ffconfig.xml]
- launch/kautham-gui.launch
- launch/kautham_client.launch
-
- kthconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/kthconfig.xml]
- launch/table_rooms_a.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a.xml]
- launch/table_rooms_a2.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_a2.xml]
- launch/table_rooms_ab.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ab.xml]
- launch/table_rooms_b.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_b.xml]
- launch/table_rooms_ba.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Table_Rooms_R2/tampconfig_ba.xml]
- launch/tiago_kitchen_no_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_no_pose.xml]
- launch/tiago_kitchen_pose.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose.xml]
- launch/tiago_kitchen_pose_no_graspit.launch
-
- tampconfigfile [default: /demos/OMPL_geo_demos/Tiago-kitchen/tampconfig_pose_no_graspit.xml]
Messages
Services
- srv/AddObstacle.srv
- srv/AddRobot.srv
- srv/AttachObstacle2RobotLink.srv
- srv/CheckCollision.srv
- srv/ClearSampleSet.srv
- srv/CloseProblem.srv
- srv/Connect.srv
- srv/DetachObstacle.srv
- srv/FindIK.srv
- srv/GetLastPlanComputationTime.srv
- srv/GetNumEdges.srv
- srv/GetNumVertices.srv
- srv/GetPath.srv
- srv/GraspPlanning.srv
- srv/ObsPos.srv
- srv/OpenProblem.srv
- srv/OpenProblemStream.srv
- srv/Plan.srv
- srv/ProblemOpened.srv
- srv/RemoveObstacle.srv
- srv/RemoveRobot.srv
- srv/SetDefaultRobControls.srv
- srv/SetFixedObsControls.srv
- srv/SetGoal.srv
- srv/SetInit.srv
- srv/SetInitObs.srv
- srv/SetObsControls.srv
- srv/SetObsControlsStream.srv
- srv/SetObstaclesConfig.srv
- srv/SetPlanner.srv
- srv/SetPlannerByName.srv
- srv/SetPlannerParameter.srv
- srv/SetPlannerStream.srv
- srv/SetQuery.srv
- srv/SetRobControls.srv
- srv/SetRobControlsNoQuery.srv
- srv/SetRobControlsStream.srv
- srv/SetRobotsConfig.srv
- srv/Solve.srv
- srv/TiagoIk.srv