-
 

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.5.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.5-devel
Last Updated 2020-10-16
Dev Status MAINTAINED
CI status Continuous Integration : 0 / 0
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • Mabel Zhang

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc…) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic
  • 0.5-devel:
    • ROS Noetic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.5.0 (2020-01-23)

  • Bump CMake version to avoid CMP0048 author warning (#51)
  • Contributors: Shane Loretz

0.4.2 (2019-03-19)

  • Changed FindPoco to use 'd' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnarök, William Woodall

0.4.1 (2017-02-21)

  • Add FindTinyXML2 module (#42) Signed-off-by: Dmitry Rozhkov <<dmitry.rozhkov@linux.intel.com>>
  • Add FindGflags for supporting Gflags
  • Contributors: Dave Coleman, Dmitry Rozhkov, William Woodall

0.4.0 (2014-12-25)

  • The Eigen module provided by this package has been deprecated. There is now a CMake warning to encourage people to use the Module provided by Eigen instead.
  • Contributors: William Woodall

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
apriltag_ros
ground_dds_ros_bridge
mapper
bondcpp
test_bond
class_loader
cob_mecanum_controller
cob_model_identifier
cob_twist_controller
collada_urdf
control_toolbox
dynamixel_workbench_controllers
dynamixel_workbench_operators
ecl_eigen
eigen_stl_containers
exotica_core
gazebo_ros
tf2_eigen
tf2_kdl
tf2_sensor_msgs
graft
hebi_cpp_api
hector_pose_estimation_core
depth_image_proc
image_rotate
imu_complementary_filter
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
euscollada
imagesift
jsk_perception
jsk_interactive_marker
kdl_parser
swri_geometry_util
mavros
mavros_extras
test_mavros
ros_core
microstrain_inertial_driver
move_base_swp
pilz_industrial_motion_planner
moveit_visual_tools
mrpt_ekf_slam_3d
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
neo_local_planner
nodelet
nonpersistent_voxel_layer
ntpd_driver
ov_core
ov_eval
ov_init
ov_msckf
parameter_pa
pilz_utils
pilz_control
prbt_hardware_support
prbt_support
pluginlib
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
psen_scan_v2
qt_gui_cpp
robot_localization
robot_self_filter
robotis_manipulator
roswtf
transmission_interface
ros_control_boilerplate
rosmon_core
rospack
rosparam_shortcuts
rviz
rviz_animated_view_controller
simple_grasping
slam_toolbox
srdfdom
teb_local_planner
trac_ik_lib
urdf
velo2cam_calibration
cob_fiducials
flatland_msgs
flatland_plugins
flatland_server
flatland_viz

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc…) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use 'd' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnarök, William Woodall

0.4.1 (2017-02-21)

  • Add FindTinyXML2 module (#42) Signed-off-by: Dmitry Rozhkov <<dmitry.rozhkov@linux.intel.com>>
  • Add FindGflags for supporting Gflags
  • Contributors: Dave Coleman, Dmitry Rozhkov, William Woodall

0.4.0 (2014-12-25)

  • The Eigen module provided by this package has been deprecated. There is now a CMake warning to encourage people to use the Module provided by Eigen instead.
  • Contributors: William Woodall

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc…) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use 'd' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnarök, William Woodall

0.4.1 (2017-02-21)

  • Add FindTinyXML2 module (#42) Signed-off-by: Dmitry Rozhkov <<dmitry.rozhkov@linux.intel.com>>
  • Add FindGflags for supporting Gflags
  • Contributors: Dave Coleman, Dmitry Rozhkov, William Woodall

0.4.0 (2014-12-25)

  • The Eigen module provided by this package has been deprecated. There is now a CMake warning to encourage people to use the Module provided by Eigen instead.
  • Contributors: William Woodall

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
bondcpp
class_loader
collada_urdf
control_toolbox
eigen_stl_containers
euslisp
gazebo_ros
geometric_shapes
tf2_eigen
tf2_kdl
tf2_sensor_msgs
graft
hector_pose_estimation_core
depth_image_proc
image_rotate
imu_complementary_filter
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
euscollada
imagesift
jsk_perception
jsk_interactive_marker
kdl_parser
swri_geometry_util
mav_msgs
mav_planning_msgs
mavros
mavros_extras
test_mavros
ros_core
moveit_experimental
moveit_planners_chomp
moveit_visual_tools
mrpt_ekf_slam_3d
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
nodelet
ntpd_driver
parameter_pa
pcl_ros
pluginlib
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
robot_localization
robot_self_filter
robot_state_publisher
roswtf
transmission_interface
ros_control_boilerplate
gripper_action_controller
joint_trajectory_controller
rospack
rosparam_shortcuts
rotors_comm
rotors_control
rotors_gazebo_plugins
rotors_hil_interface
rtmbuild
rviz
rviz_visual_tools
slam_karto
sparse_bundle_adjustment
srdfdom
teb_local_planner
trac_ik_lib
ecto_image_pipeline
ecto_ros
force_torque_sensor_calib
gravity_compensation
geonav_transform
grizzly_motion
grizzly_msgs
hector_elevation_visualization
hector_exploration_planner
hector_quadrotor_model
object_recognition_core
object_recognition_reconstruction
object_recognition_ros
object_recognition_tod
pcl_conversions
urdf
eigen_typekit
rtt_rosclock
rtt_rosparam
stdr_parser
stereo_slam
camera_handler
force_sensor_handler
imu_handler
manipulator_handler
quadrotor_handler
quadrotor_tk_handler
rigid_body_handler
vrep_ros_plugin
aubo_trajectory
freefloating_gazebo
libhaloc
object_recognition_tabletop
rqt_stream_manipulator_3d
stream_manipulator_3d
tf_keyboard_cal
microstrain_mips

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.3.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.3-devel
Last Updated 2014-12-23
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

Provided Modules

  1. Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.
  2. NumPy is the fundamental package for scientific computing with Python.
  3. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  4. TinyXML is a simple, small, C++ XML parser.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. [GSL] (http://www.gnu.org/software/gsl/) is a numerical library for C and C++ programmers.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find Eigen by using the following:

find_package(Eigen REQUIRED)

Lookup sheet

Eigen
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL

find_package(GSL REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
asr_descriptor_surface_based_recognition
asr_fake_object_recognition
asr_ftc_local_planner
asr_kinematic_chain_optimizer
asr_mild_calibration_tool
asr_navfn
asr_object_database
asr_robot_model_services
asr_sick_lms_400
asr_visualization_server
ati_force_torque
bondcpp
class_loader
cob_model_identifier
cob_obstacle_distance
cob_twist_controller
cob_camera_sensors
cob_obstacle_distance_moveit
collada_urdf
control_toolbox
eband_local_planner
ecl_eigen
eigen_stl_containers
euslisp
gazebo_ros
generic_control_toolbox
geometric_shapes
tf2_eigen
tf2_kdl
tf2_sensor_msgs
graft
hector_pose_estimation_core
depth_image_proc
image_rotate
imu_complementary_filter
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
euscollada
imagesift
jsk_perception
jsk_interactive_marker
kdl_parser
swri_geometry_util
mav_msgs
mav_planning_msgs
mavros
mavros_extras
test_mavros
ros_core
microstrain_mips
moveit_core
moveit_experimental
moveit_planners_chomp
moveit_ros_benchmarks_gui
moveit_ros_manipulation
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_visualization
pr2_moveit_plugins
moveit_tutorials
moveit_visual_tools
mrpt_ekf_slam_3d
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
map_organizer
safety_limiter
track_odometry
nodelet
ntpd_driver
parameter_pa
pcl_ros
pluginlib
laser_joint_projector
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
robot_localization
robot_self_filter
robot_state_publisher
roswtf
transmission_interface
ros_control_boilerplate
gripper_action_controller
joint_trajectory_controller
rospack
rosparam_shortcuts
rotors_comm
rotors_control
rotors_gazebo_plugins
rtmbuild
rviz
rviz_visual_tools
slam_karto
sparse_bundle_adjustment
srdfdom
teb_local_planner
trac_ik_lib
urdf
depth_sensor_pose
ecto_image_pipeline
ecto_ros
force_torque_sensor_calib
gravity_compensation
geonav_transform
grizzly_motion
grizzly_msgs
handle_detector
hector_elevation_visualization
hector_exploration_planner
hector_quadrotor_model
humanoid_localization
kuka_eki_hw_interface
kuka_rsi_hw_interface
object_recognition_core
object_recognition_reconstruction
object_recognition_ros
object_recognition_tod
feature_tracker
joint_tracker
lgsm
omip_common
rb_tracker
shape_reconstruction
shape_tracker
pcl_conversions
eigen_typekit
rtt_rosclock
rtt_rosparam
sophus_ros_conversions
stdr_parser
tango_ros_native
turtlebot_actions
turtlebot_arm_ikfast_plugin
turtlebot_arm_kinect_calibration
agile_grasp
apriltags
apriltags_ros
asctec_hl_gps
asctec_hl_interface
bwi_tools
descartes_core
descartes_moveit
descartes_planner
descartes_trajectory
interaction_cursor_3d
interaction_cursor_demo
libfovis
baxter_ikfast_left_arm_plugin
baxter_ikfast_right_arm_plugin
moveit_simple_grasps
ros_ethercat_model
rviz_fixed_view_controller
stereo_slam
camera_handler
force_sensor_handler
imu_handler
manipulator_handler
quadrotor_handler
quadrotor_tk_handler
rigid_body_handler
vrep_ros_plugin
aubo_trajectory
baxter_sim_hardware
baxter_sim_kinematics
camera_pose_calibration
carl_moveit
freefloating_gazebo
homer_map_manager
homer_mapnav_msgs
homer_mapping
homer_nav_libs
homer_navigation
or_libs
or_msgs
or_nodes
robot_face
point_cloud_reducer
constrained_ik
industrial_collision_detection
stomp_core
stomp_moveit
stomp_plugins
jsk_apc2016_common
drc_com_common
drc_valve_task
jsk_smart_gui
laser_odometry_core
libhaloc
object_recognition_tabletop
rgbdslam
robbie_architecture
robot_markers
romeo_moveit_actions
stepback_and_steerturn_recovery
rqt_stream_manipulator_3d
stream_manipulator_3d
surface_perception
rviz_textured_quads
tf_keyboard_cal
thingmagic_rfid
transform_graph
usv_gazebo_plugins
viodom
yumi_hw

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.3.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.3-devel
Last Updated 2014-12-23
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

Provided Modules

  1. Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.
  2. NumPy is the fundamental package for scientific computing with Python.
  3. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  4. TinyXML is a simple, small, C++ XML parser.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. [GSL] (http://www.gnu.org/software/gsl/) is a numerical library for C and C++ programmers.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find Eigen by using the following:

find_package(Eigen REQUIRED)

Lookup sheet

Eigen
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL

find_package(GSL REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
bondcpp
cob_vision_utils
eband_local_planner
eigen_stl_containers
euslisp
gazebo_ros
graft
hector_pose_estimation_core
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
imagesift
jsk_perception
jsk_interactive_marker
pr2_moveit_tutorials
moveit_visual_tools
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
nodelet
laser_joint_projector
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
robot_localization
transmission_interface
gripper_action_controller
joint_trajectory_controller
rtmbuild
rviz
rviz_animated_view_controller
slam_karto
sparse_bundle_adjustment
ecto_image_pipeline
ecto_ros
grizzly_motion
grizzly_msgs
hector_elevation_visualization
hector_exploration_planner
hector_quadrotor_model
object_recognition_core
object_recognition_reconstruction
object_recognition_ros
object_recognition_tod
collada_urdf
kdl_parser
urdf
eigen_typekit
rtt_rosclock
rtt_rosparam
stdr_parser
asctec_hl_gps
asctec_hl_interface
clasp
cob_leg_detection
cob_openni2_tracker
cob_people_detection
cob_people_tracking_filter
descartes_core
descartes_moveit
descartes_planner
descartes_trajectory
ethzasl_extrinsic_calibration
ethzasl_gridmap_2d
interaction_cursor_3d
interaction_cursor_demo
moveit_core
moveit_ros_benchmarks_gui
moveit_ros_manipulation
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_visualization
moveit_simple_grasps
ndt_costmap
ndt_feature_reg
ndt_fuser
ndt_map
ndt_map_builder
ndt_mcl
ndt_registration
ndt_rviz_visualisation
ndt_visualisation
perception_oru
sdf_tracker
read_omni_dataset
ros_ethercat_model
rviz_fixed_view_controller
sr_gazebo_plugins
sr_mechanism_controllers
sr_mechanism_model
camera_handler
force_sensor_handler
imu_handler
manipulator_handler
quadrotor_handler
quadrotor_tk_handler
rigid_body_handler
vrep_ros_plugin

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc…) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use 'd' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnarök, William Woodall

0.4.1 (2017-02-21)

  • Add FindTinyXML2 module (#42) Signed-off-by: Dmitry Rozhkov <<dmitry.rozhkov@linux.intel.com>>
  • Add FindGflags for supporting Gflags
  • Contributors: Dave Coleman, Dmitry Rozhkov, William Woodall

0.4.0 (2014-12-25)

  • The Eigen module provided by this package has been deprecated. There is now a CMake warning to encourage people to use the Module provided by Eigen instead.
  • Contributors: William Woodall

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
ar_track_alvar
asr_descriptor_surface_based_recognition
asr_direct_search_manager
asr_fake_object_recognition
asr_ftc_local_planner
asr_intermediate_object_generator
asr_ism_visualizations
asr_kinematic_chain_optimizer
asr_lib_pose_prediction_ism
asr_mild_calibration_tool
asr_navfn
asr_next_best_view
asr_object_database
asr_psm
asr_psm_visualizations
asr_recognizer_prediction_ism
asr_relation_graph_generator
asr_resources_for_psm
asr_robot_model_services
asr_sick_lms_400
asr_visualization_server
asr_world_model
ati_force_torque
bondcpp
test_bond
class_loader
cob_mecanum_controller
cob_model_identifier
cob_twist_controller
collada_urdf
control_toolbox
dynamixel_workbench_controllers
dynamixel_workbench_operators
eband_local_planner
ecl_eigen
eigen_stl_containers
exotica_core
force_torque_sensor
gazebo_ros
generic_control_toolbox
tf2_eigen
tf2_kdl
tf2_sensor_msgs
hebi_cpp_api
hector_pose_estimation_core
iirob_filters
depth_image_proc
image_rotate
imu_complementary_filter
libmodbus
ros_reflexxes
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
euscollada
imagesift
jsk_perception
jsk_interactive_marker
kdl_parser
swri_geometry_util
mav_msgs
mav_planning_msgs
mavros
mavros_extras
test_mavros
ros_core
microstrain_mips
moveit_ros_planning
pr2_moveit_plugins
moveit_visual_tools
mrpt_ekf_slam_3d
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
nodelet
nonpersistent_voxel_layer
ntpd_driver
open_manipulator_control_gui
open_manipulator_controller
open_manipulator_libs
open_manipulator_p_control_gui
open_manipulator_p_controller
open_manipulator_p_libs
parameter_pa
pcl_ros
pilz_trajectory_generation
pilz_control
pilz_utils
prbt_hardware_support
prbt_support
pluginlib
laser_joint_projector
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
qt_gui_cpp
robot_localization
robot_self_filter
rsm_rqt_plugins
rsm_rviz_plugins
robotis_manipulator
roswtf
transmission_interface
ros_control_boilerplate
gripper_action_controller
joint_trajectory_controller
rosmon_core
rospack
rosparam_shortcuts
rtmbuild
rviz
simple_grasping
slam_karto
sparse_bundle_adjustment
sr_gazebo_sim
sr_mechanism_controllers
sr_mechanism_model
srdfdom
teb_local_planner
trac_ik_lib
turtlebot3_panorama
tuw_ellipses
urdf
velo2cam_calibration
apriltag_ros
choreo_descartes_planner
depth_sensor_pose
ecto_image_pipeline
ecto_ros
force_torque_sensor_calib
gravity_compensation
geonav_transform
handle_detector
hector_elevation_visualization
hector_exploration_planner
hector_quadrotor_model
homer_robbie_architecture
humanoid_localization
iiwa_hw
iiwa_ros
jog_arm
kuka_eki_hw_interface
kuka_rsi_hw_interface
manipulator_h_base_module
manipulator_h_gui
manipulator_h_kinematics_dynamics
mas_cartesian_control
object_recognition_core
object_recognition_reconstruction
object_recognition_ros
object_recognition_tod
feature_tracker
joint_tracker
lgsm
omip_common
rb_tracker
pcl_conversions
rh_p12_rn_base_module
rh_p12_rn_manager
robotis_controller
cm_740_module
op3_balance_control
op3_base_module
op3_direct_control_module
op3_head_control_module
op3_kinematics_dynamics
op3_localization
op3_manager
op3_online_walking_module
op3_walking_module
open_cr_module
op3_demo
op3_gui_demo
eigen_typekit
rtt_rosclock
sophus_ros_conversions
stdr_parser
stomp_moveit
stomp_plugins
svenzva_drivers
tango_ros_native
ati_ft_sensor
thormang3_balance_control
thormang3_base_module
thormang3_feet_ft_module
thormang3_gripper_module
thormang3_head_control_module
thormang3_kinematics_dynamics
thormang3_manipulation_module
thormang3_walking_module
thormang3_demo
thormang3_foot_step_generator
turtlebot_actions
turtlebot_arm_kinect_calibration
wire_core
xiaoqiang_depth_image_proc
addwa_local_planner

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange

cmake_modules package from cmake_modules repo

cmake_modules

Package Summary

Tags No category tags.
Version 0.4.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/cmake_modules.git
VCS Type git
VCS Version 0.4-devel
Last Updated 2019-03-19
Dev Status MAINTAINED
CI status Continuous Integration : 0 / 0
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

Additional Links

Maintainers

  • William Woodall

Authors

  • William Woodall

cmake_modules

A common repository for CMake Modules which are not distributed with CMake but are commonly used by ROS packages.

See the CONTRIBUTING.md file in this repository before submitting pull requests for new modules.

ROS Distros

This repository has branches for minor releases (0.2-devel, 0.3-devel, 0.4-devel, etc…) and they map to specific ROS distributions like so:

  • 0.2-devel:
    • ROS Groovy
  • 0.3-devel:
    • ROS Hydro
    • ROS Indigo
  • 0.4-devel:
    • ROS Jade
    • ROS Kinetic
    • ROS Lunar
    • ROS Melodic

This mapping will be kept up-to-date in the README.md on the default branch.

In the future, new minor releases will increment by the number of ROS distros that are skipped. For example, if a custom branch is needed for ROS Lunar, then it will be 0.6-devel and not 0.5-devel, so that 0.5-devel maybe used by Kinetic in the future if necessary.

Provided Modules

  1. NumPy is the fundamental package for scientific computing with Python.
  2. TBB lets you easily write parallel C++ programs that take full advantage of multicore performance.
  3. TinyXML is a simple, small, C++ XML parser.
  4. TinyXML2 is a simple, small, C++ XML parser, continuation of TinyXML.
  5. Xenomai is a real-time development framework cooperating with the Linux kernel.
  6. GSL is a numerical library for C and C++ programmers.
  7. Gflags is a C++ library that implements commandline flags processing with the ability to define flags in the source file in which they are used.
  8. [Deprecated] Eigen is a C++ template library for linear algebra: matrices, vectors, numerical solvers, and related algorithms.

Usage

To use the CMake modules provided by this catkin package, you must <build_depend> on it in your package.xml, like so:

<?xml version="1.0"?>
<package>
  <!-- ... -->
  <build_depend>cmake_modules</build_depend>
</package>

Then you must find_package it in your CMakeLists.txt along with your other catkin build dependencies:

find_package(catkin REQUIRED COMPONENTS ... cmake_modules ...)

OR by find_package‘ing it directly:

find_package(cmake_modules REQUIRED)

After the above find_package invocations, the modules provided by cmake_modules will be available in your CMAKE_MODULE_PATH to be found. For example you can find TinyXML by using the following:

find_package(TinyXML REQUIRED)

Lookup sheet

Eigen [Deprecated]
find_package(Eigen REQUIRED)

NumPY
find_package(NUMPY REQUIRED)

TBB
find_package(TBB REQUIRED)

TinyXML
find_package(TinyXML REQUIRED)

Xenomai
find_package(Xenomai REQUIRED)

FindGSL
find_package(GSL REQUIRED)

Gflags
find_package(Gflags REQUIRED)

CHANGELOG

Changelog for package cmake_modules

0.4.2 (2019-03-19)

  • Changed FindPoco to use 'd' suffix only when debug libraries are present (#50)
    • Recent versions of Debian and Ubuntu (beginning with Stretch and Bionic respectively) do not provide separate debug library versions of Poco.
    • The refactored debug check now actually verifies that a d-suffixed library exists.
    • If not it falls back to using the non-suffixed version of the library which may or may not include debug symbols.
  • add note about ROS Lunar and future versioning schemes
  • Contributors: Steven! Ragnarök, William Woodall

0.4.1 (2017-02-21)

  • Add FindTinyXML2 module (#42) Signed-off-by: Dmitry Rozhkov <<dmitry.rozhkov@linux.intel.com>>
  • Add FindGflags for supporting Gflags
  • Contributors: Dave Coleman, Dmitry Rozhkov, William Woodall

0.4.0 (2014-12-25)

  • The Eigen module provided by this package has been deprecated. There is now a CMake warning to encourage people to use the Module provided by Eigen instead.
  • Contributors: William Woodall

0.3.3 (2014-12-23)

  • Added FindPoco.cmake, which migrated from the ros/class_loader repository.
  • Update to FindXenomai.cmake find_package_handle_standard_args generates all caps variables (XENOMAI_FOUND), while this script is expected to create Xenomai_FOUND. This changeset creates the appropriately cased variable, but does not unset the all-caps variant for backwards-compatibility reasons (I typically unset it on new modules).
  • Contributors: Adolfo Rodriguez Tsouroukdissian, Esteve Fernandez, William Woodall

0.3.2 (2014-10-27)

  • Added CMake module for finding the UUID libraries
  • Changed prepend of CMAKE_MODULE_PATH to append behaviour in order to allow prepending of external CMake modules.
  • Added CMake module for finding GSL
  • Contributors: Esteve Fernandez, Peter Lehner, William Woodall, v01d

0.3.1 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Fix extended CMAKE_MODULE_PATH variable when path contains spaces
  • Mention the sequencing reqirement with an example
  • Contributors: Dirk Thomas, Paul Mathieu, Scott K Logan, Tully Foote, William Woodall, phuicy

0.3.0 (2014-02-22)

  • Added Numpy CMake module
  • Added Eigen CMake module closed #10
  • Removed use of absolute paths in extra files fixed #9
  • Contributors: Vincent Rabaud, William Woodall

0.2.1 (2014-01-24)

  • Adding CMake module for finding Xenomai RT kernel patch build flags
  • Contributors: Jonathan Bohren, William Woodall

0.2.0 (2013-12-04)

  • Added FindTBB.cmake version r36 from the findtbb package
  • TinyXML: Add more comprehensive header documentation.

0.1.0 (2013-07-24)

  • Initial release, includes the FindTinyXML.cmake CMake module

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

Deps Name
catkin

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
apriltag_ros
ar_track_alvar
asr_descriptor_surface_based_recognition
asr_direct_search_manager
asr_fake_object_recognition
asr_ftc_local_planner
asr_intermediate_object_generator
asr_ism_visualizations
asr_kinematic_chain_optimizer
asr_lib_pose_prediction_ism
asr_mild_calibration_tool
asr_navfn
asr_next_best_view
asr_object_database
asr_psm
asr_psm_visualizations
asr_recognizer_prediction_ism
asr_relation_graph_generator
asr_resources_for_psm
asr_robot_model_services
asr_sick_lms_400
asr_visualization_server
asr_world_model
ground_dds_ros_bridge
mapper
ati_force_torque
bondcpp
test_bond
class_loader
cob_mecanum_controller
cob_model_identifier
cob_twist_controller
collada_urdf
control_toolbox
datmo
dynamixel_workbench_controllers
dynamixel_workbench_operators
eband_local_planner
ecl_eigen
eigen_stl_containers
exotica_core
force_torque_sensor
gazebo_ros
generic_control_toolbox
tf2_eigen
tf2_eigen
tf2_kdl
tf2_kdl
tf2_sensor_msgs
tf2_sensor_msgs
graft
hebi_cpp_api
hector_pose_estimation_core
iirob_filters
depth_image_proc
image_rotate
imu_complementary_filter
libmodbus
ros_reflexxes
mini_maxwell
nlopt
slic
collada_urdf_jsk_patch
laser_filters_jsk_patch
jsk_tilt_laser
eus_nlopt
eus_qp
jsk_ik_server
euscollada
imagesift
jsk_perception
jsk_interactive_marker
kdl_parser
swri_geometry_util
mav_msgs
mav_planning_msgs
mavros
mavros_extras
test_mavros
ros_core
microstrain_inertial_driver
microstrain_mips
move_base_swp
pilz_industrial_motion_planner
pr2_moveit_plugins
moveit_visual_tools
mrpt_ekf_slam_3d
base_local_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
move_base
move_slow_and_clear
navfn
rotate_recovery
neo_local_planner
nodelet
nonpersistent_voxel_layer
ntpd_driver
open_manipulator_control_gui
open_manipulator_controller
open_manipulator_libs
open_manipulator_p_control_gui
open_manipulator_p_controller
open_manipulator_p_libs
ov_core
ov_eval
ov_init
ov_msckf
parameter_pa
pilz_utils
pilz_trajectory_generation
pilz_control
prbt_hardware_support
prbt_support
pluginlib
laser_joint_projector
pr2_arm_kinematics
pr2_controller_manager
pr2_mechanism_model
psen_scan_v2
qt_gui_cpp
robot_localization
robot_self_filter
rsm_rqt_plugins
rsm_rviz_plugins
robotis_manipulator
roswtf
transmission_interface
ros_control_boilerplate
gripper_action_controller
joint_trajectory_controller
rosmon_core
rospack
rosparam_shortcuts
rotors_comm
rotors_control
rotors_gazebo_plugins
rtmbuild
rviz
rviz_animated_view_controller
simple_grasping
slam_toolbox
sr_gazebo_sim
sr_mechanism_controllers
sr_mechanism_model
sr_robot_lib
srdfdom
teb_local_planner
trac_ik_lib
turtlebot3_panorama
tuw_ellipses
urdf
velo2cam_calibration

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged cmake_modules at Robotics Stack Exchange