-
 
No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

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

No version for distro galactic. Known supported distros are highlighted in the buttons above.

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