Skip to content

Commit

Permalink
Update changelogs and merge ROS jade updates
Browse files Browse the repository at this point in the history
  • Loading branch information
Diogo Almeida committed Mar 27, 2018
2 parents 8367b4a + a0bca05 commit e107837
Show file tree
Hide file tree
Showing 10 changed files with 53 additions and 12 deletions.
11 changes: 11 additions & 0 deletions force_torque_sensor_calib/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,17 @@
Changelog for package force_torque_sensor_calib
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.2.0 (2018-03-27)
------------------
* [fix] Updated deprecated moveit headers in force_torque_sensor_calib
* [feature] Set RRT Connect as default planner
* Contributors: Diogo Almeida

1.1.0 (2016-01-25)
------------------
* [sys] Updated for jade and k-turtle eigen dependency (`#12 <https://github.com/kth-ros-pkg/force_torque_tools/pull/12>`_ and discussion `#11 <https://github.com/kth-ros-pkg/force_torque_tools/issues/11>`_)
* Contributors: Aris Synodinos

1.0.2 (2015-08-17)
------------------
* Add missing install rules
Expand Down
18 changes: 15 additions & 3 deletions force_torque_sensor_calib/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,17 @@ cmake_minimum_required(VERSION 2.8.3)
project(force_torque_sensor_calib)

find_package(catkin REQUIRED COMPONENTS cmake_modules roscpp sensor_msgs tf geometry_msgs moveit_core moveit_ros_planning moveit_ros_planning_interface tf_conversions eigen_conversions)
find_package(Eigen REQUIRED)
find_package(Eigen3)
if(NOT EIGEN3_FOUND)
# Fallback to cmake_modules
find_package(cmake_modules REQUIRED)
find_package(Eigen REQUIRED)
set(EIGEN3_INCLUDE_DIRS ${EIGEN_INCLUDE_DIRS})
set(EIGEN3_LIBRARIES ${EIGEN_LIBRARIES}) # Not strictly necessary as Eigen is head only
# Possibly map additional variables to the EIGEN3_ prefix.
else()
set(EIGEN3_INCLUDE_DIRS ${EIGEN3_INCLUDE_DIR})
endif()
find_package(Boost REQUIRED system filesystem date_time thread)

catkin_package(
Expand All @@ -18,10 +28,12 @@ include_directories(
include
${catkin_INCLUDE_DIRS}
${Boost_INCLUDE_DIRS}
${EIGEN_INCLUDE_DIRS}
${EIGEN3_INCLUDE_DIRS}
)

add_executable(ft_calib_node src/ft_calib.cpp src/ft_calib_node.cpp)
file(GLOB_RECURSE HEADERS include/${PROJECT_NAME}/*.h)

add_executable(ft_calib_node src/ft_calib.cpp src/ft_calib_node.cpp ${HEADERS})
target_link_libraries(ft_calib_node ${Boost_LIBRARIES} ${catkin_LIBRARIES})

install(TARGETS ft_calib_node
Expand Down
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,7 @@
#define FTCALIB_H_
#include <geometry_msgs/Vector3Stamped.h>
#include <geometry_msgs/WrenchStamped.h>
#include <eigen3/Eigen/Core>
#include <Eigen/Core>


// Least Squares calibration of bias of FT sensor and the mass and location of the COM of the gripper
Expand Down
6 changes: 3 additions & 3 deletions force_torque_sensor_calib/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>force_torque_sensor_calib</name>
<version>1.0.2</version>
<version>1.2.0</version>
<description>
Calibrates the offsets of F/T sensors and the mass and position of the COM of gripper attached to the F/T sensor. Uses readings from an accelerometer that has been calibrated to the robot frame.
</description>
Expand All @@ -9,7 +9,7 @@
<url type="website">http://wiki.ros.org/force_torque_sensor_calib</url>

<author email="[email protected]">Francisco Vina</author>
<maintainer email="fevb@kth.se">Francisco Vina</maintainer>
<maintainer email="diogoa@kth.se">Diogo Almeida</maintainer>

<buildtool_depend>catkin</buildtool_depend>

Expand All @@ -35,5 +35,5 @@
<run_depend>eigen</run_depend>
<run_depend>tf_conversions</run_depend>
<run_depend>eigen_conversions</run_depend>

</package>
2 changes: 1 addition & 1 deletion force_torque_sensor_calib/src/ft_calib.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -35,7 +35,7 @@

#include <ros/ros.h>
#include <force_torque_sensor_calib/ft_calib.h>
#include <eigen3/Eigen/Dense>
#include <Eigen/Dense>
#include <kdl/frameacc.hpp>
#include <kdl/frames.hpp>

Expand Down
2 changes: 1 addition & 1 deletion force_torque_sensor_calib/src/ft_calib_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -47,7 +47,7 @@
#include <sensor_msgs/Imu.h>
#include <moveit/move_group_interface/move_group_interface.h>
#include <force_torque_sensor_calib/ft_calib.h>
#include <eigen3/Eigen/Core>
#include <Eigen/Core>

using namespace Calibration;

Expand Down
11 changes: 11 additions & 0 deletions force_torque_tools/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,17 @@
Changelog for package force_torque_tools
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.2.0 (2018-03-27)
------------------
* [fix] Updated deprecated moveit headers in force_torque_sensor_calib
* [feature] Set RRT Connect as default planner
* Contributors: Diogo Almeida

1.1.0 (2016-01-25)
------------------
* [sys] Updated for jade and k-turtle eigen dependency (`#12 <https://github.com/kth-ros-pkg/force_torque_tools/pull/12>`_ and discussion `#11 <https://github.com/kth-ros-pkg/force_torque_tools/issues/11>`_)
* Contributors: Aris Synodinos

1.0.2 (2015-08-17)
------------------
* [fix] Add missing install rules
Expand Down
4 changes: 2 additions & 2 deletions force_torque_tools/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>force_torque_tools</name>
<version>1.0.2</version>
<version>1.2.0</version>
<description>
Tools for gravity compensation and force-torque sensor calibration.
</description>
Expand All @@ -9,7 +9,7 @@
<url>http://wiki.ros.org/force_torque_tools</url>

<author email="[email protected]">Francisco Vina</author>
<maintainer email="fevb@kth.se">Francisco Vina</maintainer>
<maintainer email="diogoa@kth.se">Diogo Almeida</maintainer>

<buildtool_depend>catkin</buildtool_depend>

Expand Down
7 changes: 7 additions & 0 deletions gravity_compensation/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,6 +2,13 @@
Changelog for package gravity_compensation
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

1.2.0 (2018-03-27)
------------------
* Update maintainer information

1.1.0 (2016-01-25)
------------------

1.0.2 (2015-08-17)
------------------
* [fix] Add missing install rules
Expand Down
2 changes: 1 addition & 1 deletion gravity_compensation/package.xml
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
<package>
<name>gravity_compensation</name>
<version>1.0.3</version>
<version>1.2.0</version>
<description>
Compensates gravity forces on the gripper of the robot so that force-torque signals are zeroed. Assumes previously calibrated accelerometer and F/T sensor.
</description>
Expand Down

0 comments on commit e107837

Please sign in to comment.